15 #ifndef MRPT_BRIDGE_IMU_H 16 #define MRPT_BRIDGE_IMU_H 19 #include <sensor_msgs/Imu.h> 20 #include <mrpt/obs/CObservationIMU.h> 21 #include <geometry_msgs/Pose.h> 22 #include <geometry_msgs/Quaternion.h> 40 bool ros2mrpt(
const sensor_msgs::Imu &msg, CObservationIMU obj);
55 #endif //MRPT_BRIDGE_IMU_H bool mrpt2ros(const CObservationIMU &obj, const std_msgs::Header &msg_header, sensor_msgs::Imu &msg)
bool ros2mrpt(const sensor_msgs::Imu &msg, CObservationIMU obj)
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types...