cv_bridge.cpp File Reference

#include <cv_bridge/cv_bridge.h>
#include <sensor_msgs/Image.h>
#include <opencv2/core/core.hpp>
#include <stdexcept>
#include <opencv2/imgproc/imgproc.hpp>
#include <string>
#include <boost/make_shared.hpp>
Include dependency graph for cv_bridge.cpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  cv_bridge

Defines

#define CHECK_CHANNEL_TYPE(t)
#define CHECK_ENCODING(code)   if (encoding == enc::TYPE_##code) return CV_##code \

Functions

CvImagePtr cv_bridge::cvtColor (const CvImageConstPtr &source, const std::string &encoding)
 Convert a CvImage to another encoding.
int cv_bridge::getCvType (const std::string &encoding)
 Get the OpenCV type enum corresponding to the encoding.
CvImagePtr cv_bridge::toCvCopy (const sensor_msgs::Image &source, const std::string &encoding=std::string())
 Convert a sensor_msgs::Image message to an OpenCV-compatible CvImage, copying the image data.
CvImagePtr cv_bridge::toCvCopy (const sensor_msgs::ImageConstPtr &source, const std::string &encoding=std::string())
 Convert a sensor_msgs::Image message to an OpenCV-compatible CvImage, copying the image data.
CvImageConstPtr cv_bridge::toCvShare (const sensor_msgs::Image &source, const boost::shared_ptr< void const > &tracked_object, const std::string &encoding=std::string())
 Convert an immutable sensor_msgs::Image message to an OpenCV-compatible CvImage, sharing the image data if possible.
CvImageConstPtr cv_bridge::toCvShare (const sensor_msgs::ImageConstPtr &source, const std::string &encoding=std::string())
 Convert an immutable sensor_msgs::Image message to an OpenCV-compatible CvImage, sharing the image data if possible.

Define Documentation

#define CHECK_CHANNEL_TYPE (  ) 
Value:
CHECK_ENCODING(t##1);                         \
  CHECK_ENCODING(t##2);                         \
  CHECK_ENCODING(t##3);                         \
  CHECK_ENCODING(t##4);                         \
#define CHECK_ENCODING ( code   )     if (encoding == enc::TYPE_##code) return CV_##code \
 All Classes Namespaces Files Functions Variables Typedefs Defines


cv_bridge
Author(s): James Bowman, Patrick Mihelich
autogenerated on Fri Jan 11 10:06:55 2013