Class ZstdSubscriber

Inheritance Relationships

Base Type

  • public image_transport::SimpleSubscriberPlugin< sensor_msgs::msg::CompressedImage >

Class Documentation

class ZstdSubscriber : public image_transport::SimpleSubscriberPlugin<sensor_msgs::msg::CompressedImage>

Public Functions

ZstdSubscriber()
virtual ~ZstdSubscriber() = default
std::string getTransportName() const override

Protected Functions

void subscribeImpl(rclcpp::Node*, const std::string &base_topic, const Callback &callback, rmw_qos_profile_t custom_qos, rclcpp::SubscriptionOptions options) override
void internalCallback(const sensor_msgs::msg::CompressedImage::ConstSharedPtr &message, const Callback &user_cb) override

Protected Attributes

rclcpp::Logger logger_
rclcpp::Node *node_