#include <ros/ros.h>#include <tf/transform_broadcaster.h>#include <nav_msgs/Odometry.h>#include <string>
Go to the source code of this file.
Defines | |
| #define | RATE 30 |
Functions | |
| int | main (int argc, char **argv) |
| void | odom_cb (const nav_msgs::Odometry::ConstPtr &msg) |
| void | time_cb (tf::TransformBroadcaster &odom_broadcast, const ros::TimerEvent &tm) |
Variables | |
| ros::Time | last_time |
| std::string | odom_frame_id = "/odom" |
| geometry_msgs::Quaternion | odom_quat |
| std::string | odom_subcribe_topic = "odom" |
| double | pos_x = 0 |
| double | pos_y = 0 |
| std::string | tf_prefix |
| #define RATE 30 |
Definition at line 7 of file odom_tf_broadcaster.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 36 of file odom_tf_broadcaster.cpp.
| void odom_cb | ( | const nav_msgs::Odometry::ConstPtr & | msg | ) |
Definition at line 18 of file odom_tf_broadcaster.cpp.
| void time_cb | ( | tf::TransformBroadcaster & | odom_broadcast, |
| const ros::TimerEvent & | tm | ||
| ) |
Definition at line 24 of file odom_tf_broadcaster.cpp.
Definition at line 13 of file odom_tf_broadcaster.cpp.
| std::string odom_frame_id = "/odom" |
Definition at line 14 of file odom_tf_broadcaster.cpp.
| geometry_msgs::Quaternion odom_quat |
Definition at line 12 of file odom_tf_broadcaster.cpp.
| std::string odom_subcribe_topic = "odom" |
Definition at line 15 of file odom_tf_broadcaster.cpp.
| double pos_x = 0 |
Definition at line 10 of file odom_tf_broadcaster.cpp.
| double pos_y = 0 |
Definition at line 11 of file odom_tf_broadcaster.cpp.
| std::string tf_prefix |
Definition at line 9 of file odom_tf_broadcaster.cpp.