#include <limits>
#include <string>
#include <vector>
#include <opencv2/highgui/highgui.hpp>
#include "cv_bridge/cv_bridge.h"
#include "compressed_depth_image_transport/codec.h"
#include "compressed_depth_image_transport/compression_common.h"
#include "ros/ros.h"
#include <opencv2/imgcodecs.hpp>
Go to the source code of this file.
Namespaces | |
namespace | 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, double depth_max, double depth_quantization, int png_level) |