Classes | Namespaces
image_transport_codec.h File Reference

Base for all image transport codecs. More...

#include <string>
#include <vector>
#include <dynamic_reconfigure/Config.h>
#include <ros/node_handle.h>
#include <sensor_msgs/Image.h>
#include <topic_tools/shape_shifter.h>
#include <xmlrpcpp/XmlRpc.h>
#include <cras_cpp_common/expected.hpp>
#include <cras_cpp_common/log_utils.h>
#include <cras_cpp_common/optional.hpp>
#include <cras_topic_tools/shape_shifter.h>
Include dependency graph for image_transport_codec.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

struct  image_transport_codecs::CompressedImageContent
 The part of a compressed message that represents the actual image data (i.e. data that can be passed to an external decoder). More...
 
class  image_transport_codecs::ImageTransportCodec
 Base for all image transport codecs. All codecs have to extend class ImageTransportCodec and implement the pure virtual methods std::string getTransportName() const, encode(const sensor_msgs::Image&, const dynamic_reconfigure::Config&) const and decode(const topic_tools::ShapeShifter&, const dynamic_reconfigure::Config&) const. There are other convenience methods provided, but all of them are based on these implementations. More...
 

Namespaces

 image_transport_codecs
 

Detailed Description

Base for all image transport codecs.

Author
Martin Pecka

Definition in file image_transport_codec.h.



image_transport_codecs
Author(s): Martin Pecka
autogenerated on Sat Jun 17 2023 02:33:19