之前都是使用键盘控制turtlebot的行走,于是想写段代码可以让turtlebot自己动起来,毕竟今后的工作是想让机器人在地图上可以实现自行路径规划到达指定的目的地。
启动turtlebot后在命令行敲入rostopic list我们可以看到当前所有的topic,如下图
我们在使用键盘控制turtlebot的时候用到的时候cmd_vel这一个topic,然而在上图中我们并没有发现它。经过一番查阅和对比,在官方代码 kobuki_keyop/launch/keyop.launch文件中可以看到
分析正确后实现起来就简单多了。
首先创建程序包
catkin_create_pkg turtle_move roscpp geometry_msgs tf
roscpp is a C++ implementation of ROS. It provides a client library that enables C++ programmers to quickly interface with ROS Topics, Services, and Parameters. roscpp is the most widely used ROS client library and is designed to be the high-performance library for ROS.
下面是代码部分,在turtle_move/src中创建move_turtle_goforward.cpp程序,附上让机器人直行的代码
#include
#include
#include
ros::Publisher cmdVelPub;
void shutdown(int sig)
{
cmdVelPub.publish(geometry_msgs::Twist());//使机器人停止运动
ROS_INFO("move_turtle_goforward ended!");
ros::shutdown();
}
int main(int argc, char** argv)
{
ros::init(argc, argv, "move_turtle_goforward");//初始化ROS,它允许ROS通过命令行进行名称重映射
ros::NodeHandle node;//为这个进程的节点创建一个句柄
cmdVelPub = node.advertise(/mobile_base/commands/velocity, 1);//在/mobile_base/commands/velocity topic上发布一个geometry_msgs/Twist的消息
ros::Rate loopRate(10);//ros::Rate对象可以允许你指定自循环的频率
signal(SIGINT, shutdown);
ROS_INFO("move_turtle_goforward cpp start...");
geometry_msgs::Twist speed; // 控制信号载体 Twist message
while (ros::ok())
{
speed.linear.x = 0.1; // 设置线速度为0.1m/s,正为前进,负为后退
speed.angular.z = 0; // 设置角速度为0rad/s,正为左转,负为右转
cmdVelPub.publish(speed); // 将刚才设置的指令发送给机器人
loopRate.sleep();//休眠直到一个频率周期的时间
}
return 0;
}
回到上层,在CMakeList.txt文件的末尾加上两句:
add_executable(move_turtle_goforward src/move_turtle_goforward.cpp)
target_link_libraries(move_turtle_goforward ${catkin_LIBRARIES})
编译一下敲入
catkin_make
启动机器人,这里我用的是kobuki
roslaunch kobuki_node minimal.launch
再运行我们写好的move_turtle_goforward程序
rosrun turtle_move move_turtle_goforward
搞定!就可以看到turtlebot直行了,键盘按CTRL+C结束程序让turtlebot停下。
最后感谢腾哥的指导!