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