Public Member Functions | Protected Types | Protected Member Functions | Protected Attributes | List of all members
compressed_image_transport::CompressedSubscriber Class Reference

#include <compressed_subscriber.h>

Inheritance diagram for compressed_image_transport::CompressedSubscriber:
Inheritance graph
[legend]

Public Member Functions

virtual std::string getTransportName () const
 
virtual void shutdown ()
 
virtual ~CompressedSubscriber ()
 
- Public Member Functions inherited from image_transport::SimpleSubscriberPlugin< sensor_msgs::CompressedImage >
virtual uint32_t getNumPublishers () const
 
virtual std::string getTopic () const
 
virtual ~SimpleSubscriberPlugin ()
 
- Public Member Functions inherited from image_transport::SubscriberPlugin
void subscribe (ros::NodeHandle &nh, const std::string &base_topic, uint32_t queue_size, void(T::*fp)(const sensor_msgs::ImageConstPtr &), T *obj, const TransportHints &transport_hints=TransportHints())
 
void subscribe (ros::NodeHandle &nh, const std::string &base_topic, uint32_t queue_size, const Callback &callback, const ros::VoidPtr &tracked_object=ros::VoidPtr(), const TransportHints &transport_hints=TransportHints())
 
void subscribe (ros::NodeHandle &nh, const std::string &base_topic, uint32_t queue_size, void(T::*fp)(const sensor_msgs::ImageConstPtr &), const boost::shared_ptr< T > &obj, const TransportHints &transport_hints=TransportHints())
 
void subscribe (ros::NodeHandle &nh, const std::string &base_topic, uint32_t queue_size, void(*fp)(const sensor_msgs::ImageConstPtr &), const TransportHints &transport_hints=TransportHints())
 
virtual ~SubscriberPlugin ()
 

Protected Types

typedef compressed_image_transport::CompressedSubscriberConfig Config
 
typedef dynamic_reconfigure::Server< ConfigReconfigureServer
 

Protected Member Functions

void configCb (Config &config, uint32_t level)
 
virtual void internalCallback (const sensor_msgs::CompressedImageConstPtr &message, const Callback &user_cb)
 
virtual void subscribeImpl (ros::NodeHandle &nh, const std::string &base_topic, uint32_t queue_size, const Callback &callback, const ros::VoidPtr &tracked_object, const image_transport::TransportHints &transport_hints)
 
- Protected Member Functions inherited from image_transport::SimpleSubscriberPlugin< sensor_msgs::CompressedImage >
virtual std::string getTopicToSubscribe (const std::string &base_topic) const
 
virtual void internalCallback (const typename sensor_msgs::CompressedImage::ConstPtr &message, const Callback &user_cb)=0
 
const ros::NodeHandlenh () const
 

Protected Attributes

Config config_
 
int imdecode_flag_
 
boost::shared_ptr< ReconfigureServerreconfigure_server_
 

Additional Inherited Members

- Public Types inherited from image_transport::SubscriberPlugin
typedef boost::function< void(const sensor_msgs::ImageConstPtr &)> Callback
 
- Static Public Member Functions inherited from image_transport::SubscriberPlugin
static std::string getLookupName (const std::string &transport_type)
 

Detailed Description

Definition at line 42 of file compressed_subscriber.h.

Member Typedef Documentation

typedef compressed_image_transport::CompressedSubscriberConfig compressed_image_transport::CompressedSubscriber::Config
protected

Definition at line 64 of file compressed_subscriber.h.

typedef dynamic_reconfigure::Server<Config> compressed_image_transport::CompressedSubscriber::ReconfigureServer
protected

Definition at line 65 of file compressed_subscriber.h.

Constructor & Destructor Documentation

virtual compressed_image_transport::CompressedSubscriber::~CompressedSubscriber ( )
inlinevirtual

Definition at line 45 of file compressed_subscriber.h.

Member Function Documentation

void compressed_image_transport::CompressedSubscriber::configCb ( Config config,
uint32_t  level 
)
protected

Definition at line 67 of file compressed_subscriber.cpp.

virtual std::string compressed_image_transport::CompressedSubscriber::getTransportName ( ) const
inlinevirtual

Implements image_transport::SubscriberPlugin.

Definition at line 47 of file compressed_subscriber.h.

void compressed_image_transport::CompressedSubscriber::internalCallback ( const sensor_msgs::CompressedImageConstPtr &  message,
const Callback user_cb 
)
protectedvirtual

Definition at line 85 of file compressed_subscriber.cpp.

void compressed_image_transport::CompressedSubscriber::shutdown ( )
virtual
void compressed_image_transport::CompressedSubscriber::subscribeImpl ( ros::NodeHandle nh,
const std::string &  base_topic,
uint32_t  queue_size,
const Callback callback,
const ros::VoidPtr tracked_object,
const image_transport::TransportHints transport_hints 
)
protectedvirtual

Member Data Documentation

Config compressed_image_transport::CompressedSubscriber::config_
protected

Definition at line 67 of file compressed_subscriber.h.

int compressed_image_transport::CompressedSubscriber::imdecode_flag_
protected

Definition at line 68 of file compressed_subscriber.h.

boost::shared_ptr<ReconfigureServer> compressed_image_transport::CompressedSubscriber::reconfigure_server_
protected

Definition at line 66 of file compressed_subscriber.h.


The documentation for this class was generated from the following files:


compressed_image_transport
Author(s): Patrick Mihelich, Julius Kammerl
autogenerated on Fri Sep 20 2019 03:32:14