#include "ros/ros.h"#include "mrpt_bridge/image.h"#include <mrpt/utils.h>#include <opencv/highgui.h>#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/Image.h>#include <sensor_msgs/image_encodings.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::image |
Functions | |
| bool | mrpt_bridge::image::mrpt2ros (const CObservationImage &obj, const std_msgs::Header &msg_header, sensor_msgs::Image &msg) |
| bool | mrpt_bridge::image::ros2mrpt (const sensor_msgs::Image &msg, CObservationImage &obj) |