Go to the documentation of this file. 1 #ifndef DYNAMIC_ROBOT_STATE_PUBLISHER_ROBOT_STATE_PUBLISHER_H
2 #define DYNAMIC_ROBOT_STATE_PUBLISHER_ROBOT_STATE_PUBLISHER_H
4 #include <robot_state_publisher/robot_state_publisher.h>
12 #if ROS_VERSION_MINIMUM(1, 15, 0)
23 #if ROS_VERSION_MINIMUM(1, 15, 0)
40 virtual void updateTree(
const KDL::Tree& tree);
59 const std::map<std::string, SegmentPair>&
getSegments()
const;
64 #if !ROS_VERSION_MINIMUM(1, 15, 0)
65 virtual void addChildren(
const KDL::SegmentMap::const_iterator segment);
73 #endif //DYNAMIC_ROBOT_STATE_PUBLISHER_ROBOT_STATE_PUBLISHER_H
RobotStatePublisher * publisher
The underlying (hacked) publisher.
DynamicRobotStatePublisher(RobotStatePublisher *publisher)
Create the publisher.
virtual size_t getNumFixedJoints() const
Return the number of fixed joints in the currently represented model.
virtual void addChildren(const KDL::SegmentMap::const_iterator segment)
An alternative RobotStatePublisher with update option.
tf2_ros::StaticTransformBroadcaster & getStaticTfBroadcaster()
std::map< std::string, SegmentPair > & getSegments()
const std::string DELETED_STATIC_TFS_FRAME
The TF frame name of the virtual frame that's parent of all deleted static TF frames.
virtual void updateTree(const KDL::Tree &tree)
Sets the robot model.
virtual size_t getNumMovingJoints() const
Return the number of moving joints in the currently represented model.
std::map< std::string, SegmentPair > & getFixedSegments()