Class TheoraSubscriber

Inheritance Relationships

Base Type

  • public image_transport::SimpleSubscriberPlugin< theora_image_transport::msg::Packet >

Class Documentation

class TheoraSubscriber : public image_transport::SimpleSubscriberPlugin<theora_image_transport::msg::Packet>

Public Functions

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

Protected Functions

virtual void subscribeImpl(rclcpp::Node *node, const std::string &base_topic, const Callback &callback, uint32_t queue_size, rmw_qos_profile_t custom_qos)
virtual void internalCallback(const theora_image_transport::msg::Packet::ConstSharedPtr &msg, const Callback &user_cb)
int updatePostProcessingLevel(int level)
void msgToOggPacket(const theora_image_transport::msg::Packet &msg, ogg_packet &ogg)

Protected Attributes

int pplevel_
bool received_header_
bool received_keyframe_
th_dec_ctx *decoding_context_
th_info header_info_
th_comment header_comment_
th_setup_info *setup_info_
sensor_msgs::msg::Image::SharedPtr latest_image_
rclcpp::Logger logger_