Open 3D Engine ROS2 Gem API Reference 23.10.0
O3DE is an open-source, fully-featured, high-fidelity, modular 3D engine for building games and simulations, available to every industry.
ROS2::IControlSubscriptionHandler Class Referenceabstract

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.
 

Detailed Description

Component extension enabling polymorphic use of generics.

Member Function Documentation

◆ Activate()

virtual void ROS2::IControlSubscriptionHandler::Activate ( const AZ::Entity *  entity,
const TopicConfiguration subscriberConfiguration 
)
pure virtual

Interface handling component activation Only activated IComponentActivationHandler will receive and process control messages.

Parameters
entityActivation context for the owning Component - the entity it belongs to.
subscriberConfigurationconfiguration with topic and qos

Implemented in ROS2::ControlSubscriptionHandler< T >, ROS2::ControlSubscriptionHandler< ackermann_msgs::msg::AckermannDrive >, and ROS2::ControlSubscriptionHandler< geometry_msgs::msg::Twist >.

◆ Deactivate()

virtual void ROS2::IControlSubscriptionHandler::Deactivate ( )
pure virtual

The documentation for this class was generated from the following file: