#include <sensor_msgs/Image.h>
#include <opencv2/core/core.hpp>
#include <Image/ByteImage.h>
#include <stdexcept>
Go to the source code of this file.
Classes | |
class | ivt_bridge::Exception |
class | ivt_bridge::IvtImage |
Image message class that is interoperable with sensor_msgs/Image but uses a CByteImage representation for the image data. More... | |
Namespaces | |
namespace | ivt_bridge |
Typedefs | |
typedef boost::shared_ptr < IvtImage const > | ivt_bridge::IvtImageConstPtr |
typedef boost::shared_ptr < IvtImage > | ivt_bridge::IvtImagePtr |
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. |