快捷导航
ROS官方urdf教程:http://wiki.ros.org/urdf/Tutorials
常用指令
tf部分
发布static transform
1 | rosrun tf2_ros static_transform_publisher x y z yaw pitch roll frame_id child_frame_id |
例如:
1 | rosrun tf2_ros static_transform_publisher 0 0 0 0 1 0 world a1 |
可以看到:
1 | ddh@LAPTOP-DDH:~/catkin_ws$ rostopic list |
以及:
1 | ddh@LAPTOP-DDH:~/catkin_ws$ rostopic echo /tf_static |
使用launch文件发布的方式: 1
2
3
4<launch>
<node pkg="tf2_ros" type="static_transform_publisher" name="link1_broadcaster"
args="1 0 0 0 0 0 1 link1_parent link1" />
</launch>