Namespaces | Defines | Functions
ivt_image.cpp File Reference
#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>
Include dependency graph for ivt_image.cpp:

Go to the source code of this file.

Namespaces

namespace  ivt_bridge

Defines

#define CHECK_CHANNEL_TYPE(t)
#define CHECK_ENCODING(code)

Functions

int ivt_bridge::getCvType (const std::string &encoding)
 Convert a IvtImage to another encoding.
CByteImage::ImageType ivt_bridge::getIvtType (const std::string &encoding)
 Get the CByteImage type enum corresponding to the encoding.
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.
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.
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.
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.

Define Documentation

#define CHECK_CHANNEL_TYPE (   t)
Value:
CHECK_ENCODING(t##1);                         \
  CHECK_ENCODING(t##2);                         \
  CHECK_ENCODING(t##3);                         \
  CHECK_ENCODING(t##4);                         \
  /***/
#define CHECK_ENCODING (   code)
Value:
if (encoding == enc::TYPE_##code) return CV_##code    \
  /***/


asr_ivt_bridge
Author(s): Hutmacher Robin, Kleinert Daniel, Meißner Pascal
autogenerated on Sat Jun 8 2019 19:52:36