#include <opencv2/core/core.hpp>
#include "sensor_msgs/CompressedImage.h"
#include "sensor_msgs/Image.h"
#include "sensor_msgs/image_encodings.h"
Go to the source code of this file.
Namespaces | |
compressed_depth_image_transport | |
Functions | |
sensor_msgs::Image::Ptr | compressed_depth_image_transport::decodeCompressedDepthImage (const sensor_msgs::CompressedImage &compressed_image) |
sensor_msgs::CompressedImage::Ptr | compressed_depth_image_transport::encodeCompressedDepthImage (const sensor_msgs::Image &message, const std::string &compression_format, double depth_max, double depth_quantization, int png_level) |