Component extension enabling polymorphic use of generics. More...
#include <ControlSubscriptionHandler.h>
Inherited by ROS2::ControlSubscriptionHandler< ackermann_msgs::msg::AckermannDrive >, ROS2::ControlSubscriptionHandler< geometry_msgs::msg::Twist >, and ROS2::ControlSubscriptionHandler< T >.
Public Member Functions | |
virtual void | Activate (const AZ::Entity *entity, const TopicConfiguration &subscriberConfiguration)=0 |
virtual void | Deactivate ()=0 |
Interface handling component deactivation. | |
Component extension enabling polymorphic use of generics.
|
pure virtual |
Interface handling component activation Only activated IComponentActivationHandler will receive and process control messages.
entity | Activation context for the owning Component - the entity it belongs to. |
subscriberConfiguration | configuration with topic and qos |
Implemented in ROS2::ControlSubscriptionHandler< T >, ROS2::ControlSubscriptionHandler< ackermann_msgs::msg::AckermannDrive >, and ROS2::ControlSubscriptionHandler< geometry_msgs::msg::Twist >.
|
pure virtual |
Interface handling component deactivation.
Implemented in ROS2::ControlSubscriptionHandler< T >, ROS2::ControlSubscriptionHandler< ackermann_msgs::msg::AckermannDrive >, and ROS2::ControlSubscriptionHandler< geometry_msgs::msg::Twist >.