先前笔者不知道catkin到底是个什么东东,后来终于在官方网站上找到了答案,原来catkin是ROS的一个官方的编译构建系统,是原本的ROS的编译构建系统rosbuild的后继者。catkin的来源有点复杂,我们可以慢慢的讲一下其中的渊源。ROS来源于Willow Garage这个公司,他们希望借助...
分类:
其他好文 时间:
2014-12-25 21:55:52
阅读次数:
406
在官网上本节的题目是Creating a workspace for catkin。 其中的catkin不知道是什么意思,在网上找到的结果是:(1)卡婷是一个广告公司,(2)柳絮。 这两种翻译显然都不太合适,不过不知道也没关系,影响不大。知道catkin是一个ROS中的工具就行了。 本节的主要目的是...
分类:
其他好文 时间:
2014-12-25 20:23:23
阅读次数:
167
#include "ros/ros.h"
#include "std_msgs/Float32.h"
#include
#include
#include "std_msgs/UInt8MultiArray.h"
#include "std_msgs/MultiArrayDimension.h"
using namespace std;
int main(int argc, char **ar...
分类:
编程语言 时间:
2014-12-25 16:28:08
阅读次数:
1269
一. 主机Master设置1.安装ssh客服端和服务器(ubuntu已默认安装了)2.机器名与ip绑定由于/etc/hosts中需要将计算机名和IP绑定,所有最好设置IP地址为静态地址 sudo nano /etc/hosts 添加Master的ip地址和机器名 eg:192.168.3.155 w...
分类:
其他好文 时间:
2014-12-17 18:16:29
阅读次数:
519
1./etc/hosts3.155 wang3.150 wool3.151 wooa3.156 hanLongLongAgo 123export ROS_MASTER_URI="http://wang:11311"登陆 ssh woolhostname2.
分类:
其他好文 时间:
2014-12-11 13:55:12
阅读次数:
229
TargetTabletopSrv.srv
string Object
string TargetTabletop
---
bool FeedBackFlag
FeedBackFlag.msg
bool FeedBackFlag
TargetTabletop.msg
string Object
string TargetTabletop
创建msg 和srv
------------...
分类:
其他好文 时间:
2014-12-05 12:49:23
阅读次数:
139
主机: export ROS_HOSTNAME=hello(主机名称).local
roscore
客机:export ROS_HOSTNAME=fine(客机名称).local
export ROS_MASTER_URI=http://hello(主机名称).local:11311
rostopic list -v...
分类:
其他好文 时间:
2014-11-27 12:48:04
阅读次数:
329
#include "ros/ros.h"
#include "std_msgs/Int16.h"
#include
#include
#include "std_srvs/Empty.h"
#include
int main(int argc, char **argv)
{
ros::init(argc, argv, "robot_global_localization");
ro...
分类:
其他好文 时间:
2014-11-02 09:27:27
阅读次数:
265
一.创建工作空间mkdir -p ~/openni_ws/srccd ~/openni_wscatkin_make //在catkin工作空间(openni_ws)下catkin_make,结果产生build和devel文件夹source devel/setup.bash二.创建package(包)...
分类:
其他好文 时间:
2014-10-23 19:02:31
阅读次数:
155
原文:blog.csdn.net/u013243710/article/details/35795841ROS中的CMakeLists.txt 在ROS的编程过程中,如果CMakeLists.txt如果写不好,编译就很难成功。如果看不懂CMakeLists.txt那么很多错误你也不知道时什么回事。所...
分类:
其他好文 时间:
2014-10-11 17:22:15
阅读次数:
443