$search

image.cpp File Reference

Implements conversions between ViSP and ROS image types. More...

#include "image.h"
#include "sensor_msgs/Image.h"
#include "visp/vpImage.h"
#include "visp/vpRGBa.h"
#include <sensor_msgs/image_encodings.h>
#include <boost/format.hpp>
#include <stdexcept>
Include dependency graph for image.cpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  visp_bridge

Functions

sensor_msgs::Image visp_bridge::toSensorMsgsImage (const vpImage< vpRGBa > &src)
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.
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)

Detailed Description

Implements conversions between ViSP and ROS image types.

Definition in file image.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


visp_bridge
Author(s): Filip Novotny
autogenerated on Sat Mar 2 14:15:43 2013