#include <ros/ros.h>#include <tf/transform_broadcaster.h>#include <tf/transform_listener.h>#include <nav_msgs/Odometry.h>
Go to the source code of this file.
Functions | |
| void | groundTruePosCallback (const nav_msgs::Odometry::ConstPtr &msg) |
| int | main (int argc, char **argv) |
Variables | |
| tf::Vector3 | base2odom_pos (0, 0, 0) |
| tf::Quaternion | base2odom_quad (0, 0, 0, 1) |
| tf::TransformBroadcaster * | broadcaster |
| tf::TransformListener * | listener |
| void groundTruePosCallback | ( | const nav_msgs::Odometry::ConstPtr & | msg | ) |
Definition at line 10 of file tf_broadcaster.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 27 of file tf_broadcaster.cpp.
| tf::Vector3 base2odom_pos(0, 0, 0) |
| tf::Quaternion base2odom_quad(0, 0, 0, 1) |
Definition at line 8 of file tf_broadcaster.cpp.
Definition at line 9 of file tf_broadcaster.cpp.