34 #ifndef MULTISENSE_ROS_IMU_H 35 #define MULTISENSE_ROS_IMU_H 37 #include <boost/shared_ptr.hpp> 38 #include <boost/thread.hpp> 41 #include <sensor_msgs/Imu.h> 42 #include <geometry_msgs/Vector3Stamped.h> 44 #include <multisense_lib/MultiSenseChannel.hh> const std::string mag_frameId_
ros::Publisher magnetometer_vector_pub_
void imuCallback(const crl::multisense::imu::Header &header)
const std::string accel_frameId_
sensor_msgs::Imu imu_message_
int32_t total_subscribers_
const std::string tf_prefix_
ros::Publisher gyroscope_pub_
ros::Publisher magnetometer_pub_
Imu(crl::multisense::Channel *driver, std::string tf_prefix)
ros::Publisher accelerometer_vector_pub_
const std::string gyro_frameId_
ros::Publisher gyroscope_vector_pub_
ros::Publisher accelerometer_pub_
crl::multisense::Channel * driver_
ros::NodeHandle device_nh_