5 #ifndef DMU_ROS_DMU11_H 6 #define DMU_ROS_DMU11_H 9 #include <sensor_msgs/Imu.h> 10 #include <dmu_ros/DMURaw.h> 31 const double g_ = 9.80665;
95 #endif //DMU_ROS_DMU11_H
void closePort()
Close the device.
ros::Publisher imu_publisher_
int openPort()
Open device.
void doParsing(int16_t *int16buff)
Gets the raw data and converts them to standard ROS IMU message.
int16_t big_endian_to_short(unsigned char *data)
change big endian 2 byte into short
float short_to_float(int16_t *data)
change big endian short into float
ros::Publisher dmu_raw_publisher_
sensor_msgs::Imu imu_raw_
DMU11(ros::NodeHandle &nh)
Constructor.
dmu_ros::DMURaw raw_package_
void update()
Read the data received on serial port.