This class provides an easy way to publish coordinate frame transform information. It will handle all the messaging and stuffing of messages. And the function prototypes lay out all the necessary data needed for each message. More...
#include <transform_broadcaster.h>
Public Member Functions | |
void | sendTransform (const std::vector< geometry_msgs::TransformStamped > &transforms) |
Send a vector of TransformStamped messages The stamped data structure includes frame_id, and time, and parent_id already. | |
void | sendTransform (const geometry_msgs::TransformStamped &transform) |
Send a StampedTransform The stamped data structure includes frame_id, and time, and parent_id already. | |
TransformBroadcaster () | |
Constructor (needs a ros::Node reference). | |
Private Attributes | |
ros::NodeHandle | node_ |
Internal reference to ros::Node. | |
ros::Publisher | publisher_ |
This class provides an easy way to publish coordinate frame transform information. It will handle all the messaging and stuffing of messages. And the function prototypes lay out all the necessary data needed for each message.
Definition at line 48 of file transform_broadcaster.h.
tf2::TransformBroadcaster::TransformBroadcaster | ( | ) |
Constructor (needs a ros::Node reference).
Definition at line 39 of file transform_broadcaster.cpp.
void tf2::TransformBroadcaster::sendTransform | ( | const std::vector< geometry_msgs::TransformStamped > & | transforms | ) |
Send a vector of TransformStamped messages The stamped data structure includes frame_id, and time, and parent_id already.
Definition at line 52 of file transform_broadcaster.cpp.
void tf2::TransformBroadcaster::sendTransform | ( | const geometry_msgs::TransformStamped & | transform | ) |
Send a StampedTransform The stamped data structure includes frame_id, and time, and parent_id already.
Send a vector of StampedTransforms The stamped data structure includes frame_id, and time, and parent_id already. Send a TransformStamped message The stamped data structure includes frame_id, and time, and parent_id already.
Definition at line 44 of file transform_broadcaster.cpp.
ros::NodeHandle tf2::TransformBroadcaster::node_ [private] |
Internal reference to ros::Node.
Definition at line 71 of file transform_broadcaster.h.
ros::Publisher tf2::TransformBroadcaster::publisher_ [private] |
Definition at line 72 of file transform_broadcaster.h.