ros / robot_state_publisher

Allows you to publish the state of a robot (i.e the position of its base and all joints) via the "tf" transform library
http://www.ros.org/wiki/robot_state_publisher
BSD 3-Clause "New" or "Revised" License
86 stars 169 forks source link

Robot State Publisher

This package contains the Robot State Publisher, a node and a class to publish the state of a robot to tf2. At startup time, Robot State Publisher is supplied with a kinematic tree model (URDF) of the robot. It then subscribes to the joint_states topic (of type sensor_msgs/msg/JointState) to get individual joint states. These joint states are used to update the kinematic tree model, and the resulting 3D poses are then published to tf2.

Robot State Publisher deals with two different "classes" of joint types: fixed and movable. Fixed joints (with the type "fixed") are published to the transient_local /tf_static topic once on startup (transient_local topics keep a history of what they published, so a later subscription can always get the latest state of the world). Movable joints are published to the regular /tf topic any time the appropriate joint is updated in the joint_states message.

Examples showing how to pass the robot_description parameter using a launch file are available in the 'launch' subdirectory.

Published Topics

Subscribed Topics

Parameters