Class CompressedDepthPublisher

Inheritance Relationships

Base Type

  • public image_transport::SimplePublisherPlugin< CompressedImage >

Class Documentation

class CompressedDepthPublisher : public image_transport::SimplePublisherPlugin<CompressedImage>

Public Functions

inline CompressedDepthPublisher()
inline virtual ~CompressedDepthPublisher()
inline virtual std::string getTransportName() const override

Protected Functions

void advertiseImpl(rclcpp::Node *node, const std::string &base_topic, rmw_qos_profile_t custom_qos, rclcpp::PublisherOptions options) final override
void publish(const sensor_msgs::msg::Image &message, const PublishFn &publish_fn) const final override

Protected Attributes

rclcpp::Logger logger_
rclcpp::Node *node_