#include <ros/ros.h>#include <geometry_msgs/PoseStamped.h>#include <sensor_msgs/Imu.h>#include <tf/transform_broadcaster.h>#include <tf/transform_datatypes.h>#include "mav_msgs/Height.h"
Go to the source code of this file.
Namespaces | |
| namespace | tf |
Typedefs | |
| typedef btMatrix3x3 | tf::Matrix3x3 |
| typedef btScalar | tfScalar |
Functions | |
| void | addTransform (std::vector< geometry_msgs::TransformStamped > &transforms, const tf::StampedTransform &tf) |
| void | heightCallback (const mav_msgs::Height &msg) |
| void | imuCallback (sensor_msgs::Imu const &imu) |
| int | main (int argc, char **argv) |
Variables | |
| std::string | base_frame_id |
| std::string | footprint_frame_id |
| tf::TransformBroadcaster * | g_transform_broadcaster |
| std::string | global_frame_id |
| std::string | height_topic |
| std::string | imu_topic |
| std::string | odom_frame_id |
| std::string | stabilized_frame_id |
| typedef btScalar tfScalar |
Definition at line 21 of file message_pub_tf.cpp.
| void addTransform | ( | std::vector< geometry_msgs::TransformStamped > & | transforms, |
| const tf::StampedTransform & | tf | ||
| ) |
Definition at line 25 of file message_pub_tf.cpp.
| void heightCallback | ( | const mav_msgs::Height & | msg | ) |
Definition at line 91 of file message_pub_tf.cpp.
| void imuCallback | ( | sensor_msgs::Imu const & | imu | ) |
Definition at line 105 of file message_pub_tf.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 133 of file message_pub_tf.cpp.
| std::string base_frame_id |
Definition at line 11 of file message_pub_tf.cpp.
| std::string footprint_frame_id |
Definition at line 9 of file message_pub_tf.cpp.
Definition at line 17 of file message_pub_tf.cpp.
| std::string global_frame_id |
Definition at line 8 of file message_pub_tf.cpp.
| std::string height_topic |
Definition at line 15 of file message_pub_tf.cpp.
| std::string imu_topic |
Definition at line 14 of file message_pub_tf.cpp.
| std::string odom_frame_id |
Definition at line 12 of file message_pub_tf.cpp.
| std::string stabilized_frame_id |
Definition at line 10 of file message_pub_tf.cpp.