#include <ros/ros.h>
#include <tf/tf.h>
#include <tf/transform_listener.h>
#include <tf/message_filter.h>
#include <message_filters/subscriber.h>
#include <sensor_msgs/Imu.h>
#include <geometry_msgs/Vector3Stamped.h>
#include <geometry_msgs/QuaternionStamped.h>
#include <geometry_msgs/PoseStamped.h>
#include <iostream>
Go to the source code of this file.
Functions | |
void | imu_callback (const sensor_msgs::ImuConstPtr &msg) |
int | main (int argc, char **argv) |
void | transformCovariance (const boost::array< double, 9 > &in, boost::array< double, 9 > &out, const tf::StampedTransform &transform) |
Variables | |
boost::shared_ptr < tf::TransformListener > | listener_ |
ros::Publisher | pub_ |
std::string | target_frame_id_ |
void imu_callback | ( | const sensor_msgs::ImuConstPtr & | msg | ) |
Definition at line 65 of file imu_transformer.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 129 of file imu_transformer.cpp.
void transformCovariance | ( | const boost::array< double, 9 > & | in, |
boost::array< double, 9 > & | out, | ||
const tf::StampedTransform & | transform | ||
) |
Definition at line 50 of file imu_transformer.cpp.
boost::shared_ptr<tf::TransformListener> listener_ |
Definition at line 47 of file imu_transformer.cpp.
Definition at line 46 of file imu_transformer.cpp.
std::string target_frame_id_ |
Definition at line 48 of file imu_transformer.cpp.