[Documentation] [TitleIndex] [WordIndex

  Show EOL distros: 

EOL distros:  
robot_model: collada_parser | collada_urdf | colladadom | convex_decomposition | ivcon | kdl_parser | resource_retriever | robot_state_publisher | simmechanics_to_urdf | srdf | urdf | urdf_interface | urdf_parser

Package Summary

This package allows you to publish the state of a robot to tf. Once the state gets published, it is available to all components in the system that also use tf. The package takes the joint angles of the robot as input and publishes the 3D poses of the robot links, using a kinematic tree model of the robot. The package can both be used as a library and as a ROS node. This package has been well tested and the code is stable. No major changes are planned in the near future

frames4.png

Overview

robot_state_publisher uses the URDF specified by the parameter robot_description and the joint positions from the topic joint_states to calculate the forward kinematics of the robot and publish the results via tf.

Please see the tutorial on using the robot state publisher on your own robot. It will explain how you can publish the state of your robot to tf, using the robot state publisher.

Note: All fixed transforms are future dated by 0.5s.

state_publisher node

ROS API

Subscribed topics

joint_states (sensor_msgs/JointState)

Parameters

robot_description (urdf map)

tf_prefix (string)

publish_frequency (double)


2022-05-28 12:56