Public Member Functions | Protected Types | Protected Member Functions | Protected Attributes
theora_imagem_transport::TheoraSubscriber Class Reference

#include <theora_subscriber.h>

Inheritance diagram for theora_imagem_transport::TheoraSubscriber:
Inheritance graph
[legend]

List of all members.

Public Member Functions

virtual std::string getTransportName () const
 TheoraSubscriber ()
virtual ~TheoraSubscriber ()

Protected Types

typedef
theora_imagem_transport::TheoraSubscriberConfig 
Config
typedef
message_transport::SubscriberPlugin
< sensor_msgs::Image >
::Callback 
ImageCallback
typedef
dynamic_reconfigure::Server
< Config
ReconfigureServer

Protected Member Functions

void configCb (Config &config, uint32_t level)
virtual void internalCallback (const theora_image_transport::Packet::ConstPtr &msg, const message_transport::SimpleSubscriberPlugin< sensor_msgs::Image, theora_image_transport::Packet >::Callback &user_cb)
void msgToOggPacket (const theora_image_transport::Packet &msg, ogg_packet &ogg)
virtual void subscribeImpl (ros::NodeHandle &nh, const std::string &base_topic, uint32_t queue_size, const ImageCallback &callback, const ros::VoidPtr &tracked_object, const message_transport::TransportHints &transport_hints)
int updatePostProcessingLevel (int level)

Protected Attributes

th_dec_ctx * decoding_context_
th_comment header_comment_
th_info header_info_
sensor_msgs::ImagePtr latest_image_
int pplevel_
bool received_header_
bool received_keyframe_
boost::shared_ptr
< ReconfigureServer
reconfigure_server_
th_setup_info * setup_info_

Detailed Description

Definition at line 15 of file theora_subscriber.h.


Member Typedef Documentation

typedef theora_imagem_transport::TheoraSubscriberConfig theora_imagem_transport::TheoraSubscriber::Config [protected]

Definition at line 40 of file theora_subscriber.h.

Definition at line 31 of file theora_subscriber.h.

typedef dynamic_reconfigure::Server<Config> theora_imagem_transport::TheoraSubscriber::ReconfigureServer [protected]

Definition at line 41 of file theora_subscriber.h.


Constructor & Destructor Documentation

Definition at line 13 of file theora_subscriber.cpp.

Definition at line 24 of file theora_subscriber.cpp.


Member Function Documentation

void theora_imagem_transport::TheoraSubscriber::configCb ( Config config,
uint32_t  level 
) [protected]

Definition at line 48 of file theora_subscriber.cpp.

virtual std::string theora_imagem_transport::TheoraSubscriber::getTransportName ( ) const [inline, virtual]

Implements message_transport::SubscriberPluginGen.

Definition at line 21 of file theora_subscriber.h.

void theora_imagem_transport::TheoraSubscriber::internalCallback ( const theora_image_transport::Packet::ConstPtr &  msg,
const message_transport::SimpleSubscriberPlugin< sensor_msgs::Image, theora_image_transport::Packet >::Callback user_cb 
) [protected, virtual]
Todo:
Break this function into pieces
Todo:
Handle RGB8 or MONO8 efficiently

Definition at line 89 of file theora_subscriber.cpp.

void theora_imagem_transport::TheoraSubscriber::msgToOggPacket ( const theora_image_transport::Packet &  msg,
ogg_packet &  ogg 
) [protected]

Definition at line 78 of file theora_subscriber.cpp.

void theora_imagem_transport::TheoraSubscriber::subscribeImpl ( ros::NodeHandle nh,
const std::string &  base_topic,
uint32_t  queue_size,
const ImageCallback callback,
const ros::VoidPtr tracked_object,
const message_transport::TransportHints transport_hints 
) [protected, virtual]

Definition at line 33 of file theora_subscriber.cpp.

Definition at line 58 of file theora_subscriber.cpp.


Member Data Documentation

Definition at line 53 of file theora_subscriber.h.

Definition at line 55 of file theora_subscriber.h.

Definition at line 54 of file theora_subscriber.h.

Definition at line 57 of file theora_subscriber.h.

Definition at line 43 of file theora_subscriber.h.

Definition at line 51 of file theora_subscriber.h.

Definition at line 52 of file theora_subscriber.h.

Definition at line 42 of file theora_subscriber.h.

Definition at line 56 of file theora_subscriber.h.


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


theora_imagem_transport
Author(s): Ethan Dreyfuss, Cedric Pradalier
autogenerated on Sun Oct 5 2014 23:49:34