#include <cstring>
#include <sensor_msgs/Imu.h>
#include <mrpt/obs/CObservationIMU.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/Quaternion.h>
Go to the source code of this file.
Namespaces | |
namespace | mrpt_bridge |
File includes methods for converting CNetworkOfPoses*DInf <=> NetworkOfPoses message types. | |
namespace | mrpt_bridge::imu |
Functions | |
bool | mrpt_bridge::imu::mrpt2ros (const CObservationIMU &obj, const std_msgs::Header &msg_header, sensor_msgs::Imu &msg) |
bool | mrpt_bridge::imu::ros2mrpt (const sensor_msgs::Imu &msg, CObservationIMU obj) |