Public Member Functions | |
| OdomMsgToTF () | |
| void | odomReceivedCallback (const nav_msgs::OdometryConstPtr &msg) |
| virtual | ~OdomMsgToTF () |
Private Attributes | |
| std::string | frameId_ |
| std::string | odomFrameId_ |
| ros::Subscriber | odomTopic_ |
| tf::TransformBroadcaster | tfBroadcaster_ |
Definition at line 34 of file OdomMsgToTFNode.cpp.
| OdomMsgToTF::OdomMsgToTF | ( | ) | [inline] |
Definition at line 38 of file OdomMsgToTFNode.cpp.
| virtual OdomMsgToTF::~OdomMsgToTF | ( | ) | [inline, virtual] |
Definition at line 50 of file OdomMsgToTFNode.cpp.
| void OdomMsgToTF::odomReceivedCallback | ( | const nav_msgs::OdometryConstPtr & | msg | ) | [inline] |
Definition at line 52 of file OdomMsgToTFNode.cpp.
std::string OdomMsgToTF::frameId_ [private] |
Definition at line 76 of file OdomMsgToTFNode.cpp.
std::string OdomMsgToTF::odomFrameId_ [private] |
Definition at line 77 of file OdomMsgToTFNode.cpp.
ros::Subscriber OdomMsgToTF::odomTopic_ [private] |
Definition at line 79 of file OdomMsgToTFNode.cpp.
Definition at line 80 of file OdomMsgToTFNode.cpp.