Public Member Functions | |
ApplyTF2Odom () | |
void | callback (const nav_msgs::Odometry::ConstPtr &odom_msg) |
Private Attributes | |
ros::NodeHandle | nh_ |
ros::NodeHandle | nh_private_ |
ros::Publisher | odom_pub_ |
ros::Subscriber | odom_sub_ |
tf::Transform | trans_ |
Definition at line 7 of file apply_tf_to_odom_msg.cpp.
ApplyTF2Odom::ApplyTF2Odom | ( | ) | [inline] |
Definition at line 18 of file apply_tf_to_odom_msg.cpp.
void ApplyTF2Odom::callback | ( | const nav_msgs::Odometry::ConstPtr & | odom_msg | ) | [inline] |
Definition at line 41 of file apply_tf_to_odom_msg.cpp.
ros::NodeHandle ApplyTF2Odom::nh_ [private] |
Definition at line 9 of file apply_tf_to_odom_msg.cpp.
ros::NodeHandle ApplyTF2Odom::nh_private_ [private] |
Definition at line 10 of file apply_tf_to_odom_msg.cpp.
ros::Publisher ApplyTF2Odom::odom_pub_ [private] |
Definition at line 13 of file apply_tf_to_odom_msg.cpp.
ros::Subscriber ApplyTF2Odom::odom_sub_ [private] |
Definition at line 12 of file apply_tf_to_odom_msg.cpp.
tf::Transform ApplyTF2Odom::trans_ [private] |
Definition at line 15 of file apply_tf_to_odom_msg.cpp.