Namespaces | Typedefs | Functions | Variables
message_to_tf.cpp File Reference
#include <ros/ros.h>
#include <nav_msgs/Odometry.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/Vector3Stamped.h>
#include <sensor_msgs/Imu.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_listener.h>
#include <tf/transform_datatypes.h>
#include <topic_tools/shape_shifter.h>
Include dependency graph for message_to_tf.cpp:

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 imuCallback (sensor_msgs::Imu const &imu)
int main (int argc, char **argv)
void multiCallback (topic_tools::ShapeShifter const &input)
void odomCallback (nav_msgs::Odometry const &odometry)
void poseCallback (geometry_msgs::PoseStamped const &pose)
void sendTransform (geometry_msgs::Pose const &pose, const std_msgs::Header &header, std::string child_frame_id="")

Variables

std::string g_child_frame_id
ros::Publisher g_euler_publisher
std::string g_footprint_frame_id
std::string g_frame_id
std::string g_imu_topic
std::string g_odometry_topic
ros::Publisher g_pose_publisher
std::string g_pose_topic
std::string g_position_frame_id
bool g_publish_roll_pitch
std::string g_stabilized_frame_id
std::string g_tf_prefix
std::string g_topic
tf::TransformBroadcasterg_transform_broadcaster

Typedef Documentation

typedef btScalar tfScalar

Definition at line 31 of file message_to_tf.cpp.


Function Documentation

void addTransform ( std::vector< geometry_msgs::TransformStamped > &  transforms,
const tf::StampedTransform tf 
)

Definition at line 35 of file message_to_tf.cpp.

void imuCallback ( sensor_msgs::Imu const &  imu)

Definition at line 131 of file message_to_tf.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 190 of file message_to_tf.cpp.

void multiCallback ( topic_tools::ShapeShifter const &  input)

Definition at line 168 of file message_to_tf.cpp.

void odomCallback ( nav_msgs::Odometry const &  odometry)

Definition at line 123 of file message_to_tf.cpp.

void poseCallback ( geometry_msgs::PoseStamped const &  pose)

Definition at line 127 of file message_to_tf.cpp.

void sendTransform ( geometry_msgs::Pose const &  pose,
const std_msgs::Header header,
std::string  child_frame_id = "" 
)

Definition at line 41 of file message_to_tf.cpp.


Variable Documentation

std::string g_child_frame_id

Definition at line 20 of file message_to_tf.cpp.

Definition at line 28 of file message_to_tf.cpp.

std::string g_footprint_frame_id

Definition at line 17 of file message_to_tf.cpp.

std::string g_frame_id

Definition at line 16 of file message_to_tf.cpp.

std::string g_imu_topic

Definition at line 14 of file message_to_tf.cpp.

std::string g_odometry_topic

Definition at line 12 of file message_to_tf.cpp.

Definition at line 27 of file message_to_tf.cpp.

std::string g_pose_topic

Definition at line 13 of file message_to_tf.cpp.

std::string g_position_frame_id

Definition at line 18 of file message_to_tf.cpp.

Definition at line 22 of file message_to_tf.cpp.

std::string g_stabilized_frame_id

Definition at line 19 of file message_to_tf.cpp.

std::string g_tf_prefix

Definition at line 24 of file message_to_tf.cpp.

std::string g_topic

Definition at line 15 of file message_to_tf.cpp.

Definition at line 26 of file message_to_tf.cpp.



message_to_tf
Author(s): Johannes Meyer
autogenerated on Fri Aug 28 2015 10:59:51