Defines conversions between ViSP and ROS image types. More...
#include "sensor_msgs/Image.h"
#include "visp/vpImage.h"
#include "visp/vpRGBa.h"
Go to the source code of this file.
Namespaces | |
namespace | visp_bridge |
Functions | |
sensor_msgs::Image | visp_bridge::toSensorMsgsImage (const vpImage< unsigned char > &src) |
Converts a ViSP image (vpImage) to a sensor_msgs::Image. Only works for greyscale images. | |
sensor_msgs::Image | visp_bridge::toSensorMsgsImage (const vpImage< vpRGBa > &src) |
vpImage< unsigned char > | visp_bridge::toVispImage (const sensor_msgs::Image &src) |
Converts a sensor_msgs::Image to a ViSP image (vpImage). Only works for greyscale images. | |
vpImage< vpRGBa > | visp_bridge::toVispImageRGBa (const sensor_msgs::Image &src) |
Defines conversions between ViSP and ROS image types.
Definition in file image.h.