#include <ivt_bridge/ivt_image.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <Image/ImageProcessor.h>
#include <sensor_msgs/image_encodings.h>
#include <boost/make_shared.hpp>
Go to the source code of this file.
|  | 
| int | ivt_bridge::getCvType (const std::string &encoding) | 
|  | Convert a IvtImage to another encoding.  More... 
 | 
|  | 
| CByteImage::ImageType | ivt_bridge::getIvtType (const std::string &encoding) | 
|  | Get the CByteImage type enum corresponding to the encoding.  More... 
 | 
|  | 
| IvtImagePtr | ivt_bridge::toIvtCopy (const sensor_msgs::ImageConstPtr &source, const std::string &encoding=std::string()) | 
|  | Convert a sensor_msgs::Image message to an Ivt-compatible CByteImage, copying the image data.  More... 
 | 
|  | 
| IvtImagePtr | ivt_bridge::toIvtCopy (const sensor_msgs::Image &source, const std::string &encoding=std::string()) | 
|  | Convert a sensor_msgs::Image message to an Ivt-compatible CByteImage, copying the image data.  More... 
 | 
|  | 
| IvtImageConstPtr | ivt_bridge::toIvtShare (const sensor_msgs::ImageConstPtr &source, const std::string &encoding=std::string()) | 
|  | Convert an immutable sensor_msgs::Image message to an Ivt-compatible CByteImage, sharing the image data if possible.  More... 
 | 
|  | 
| IvtImageConstPtr | ivt_bridge::toIvtShare (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 Ivt-compatible CByteImage, sharing the image data if possible.  More... 
 | 
|  | 
◆ CHECK_CHANNEL_TYPE
      
        
          | #define CHECK_CHANNEL_TYPE | ( |  | t | ) |  | 
      
 
Value:  CHECK_ENCODING(t##2);                         \
  CHECK_ENCODING(t##3);                         \
  CHECK_ENCODING(t##4);                         \
  
#define CHECK_ENCODING(code)
 
 
◆ CHECK_ENCODING
      
        
          | #define CHECK_ENCODING | ( |  | code | ) |  | 
      
 
Value:if (encoding == enc::TYPE_##code) return CV_##code    \