Namespaces | Functions
cv_bridge.cpp File Reference
#include "boost/endian/conversion.hpp"
#include <map>
#include <boost/make_shared.hpp>
#include <boost/regex.hpp>
#include <opencv2/imgcodecs.hpp>
#include <opencv2/imgproc/imgproc.hpp>
#include <sensor_msgs/image_encodings.h>
#include <cv_bridge/cv_bridge.h>
#include <cv_bridge/rgb_colors.h>
Include dependency graph for cv_bridge.cpp:

Go to the source code of this file.

Namespaces

 cv_bridge
 

Functions

CvImagePtr cv_bridge::cvtColor (const CvImageConstPtr &source, const std::string &encoding)
 Convert a CvImage to another encoding using the same rules as toCvCopy. More...
 
CvImageConstPtr cv_bridge::cvtColorForDisplay (const CvImageConstPtr &source, const std::string &encoding=std::string(), const CvtColorForDisplayOptions options=CvtColorForDisplayOptions())
 Converts an immutable sensor_msgs::Image message to another CvImage for display purposes, using practical conversion rules if needed. More...
 
static int cv_bridge::depthStrToInt (const std::string depth)
 
int cv_bridge::getCvType (const std::string &encoding)
 Get the OpenCV type enum corresponding to the encoding. More...
 
std::string cv_bridge::getFormat (Format format)
 
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. More...
 
CvImagePtr cv_bridge::toCvCopy (const sensor_msgs::CompressedImageConstPtr &source, const std::string &encoding=std::string())
 
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. More...
 
CvImagePtr cv_bridge::toCvCopy (const sensor_msgs::CompressedImage &source, const std::string &encoding=std::string())
 
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. More...
 
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. More...
 


cv_bridge
Author(s): Patrick Mihelich, James Bowman
autogenerated on Thu Dec 12 2019 03:52:01