Class SubscriberPlugin

Inheritance Relationships

Base Type

  • public image_transport::SimpleSubscriberPlugin< std_msgs::msg::String >

Class Documentation

class SubscriberPlugin : public image_transport::SimpleSubscriberPlugin<std_msgs::msg::String>

Public Functions

SubscriberPlugin()
void shutdown() override
std::string getTransportName() const override

Protected Functions

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