Class CompressedSubscriber
Defined in File compressed_subscriber.h
Nested Relationships
Nested Types
Inheritance Relationships
Base Type
public image_transport::SimpleSubscriberPlugin< sensor_msgs::msg::CompressedImage >
Class Documentation
-
class CompressedSubscriber : public image_transport::SimpleSubscriberPlugin<sensor_msgs::msg::CompressedImage>
Public Functions
-
inline CompressedSubscriber()
-
virtual ~CompressedSubscriber() = default
-
inline virtual std::string getTransportName() const
Protected Functions
-
void subscribeImpl(rclcpp::Node*, const std::string &base_topic, const Callback &callback, rmw_qos_profile_t custom_qos) override
-
void subscribeImpl(rclcpp::Node*, const std::string &base_topic, const Callback &callback, rmw_qos_profile_t custom_qos, rclcpp::SubscriptionOptions options) override
-
inline CompressedSubscriber()