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::ROS2SystemComponent Class Reference

Central singleton-like System Component for ROS2 Gem. More...

#include <ROS2SystemComponent.h>

Inherits AZ::Component, AZ::TickBus::Handler, and ROS2RequestBus::Handler.

Inherited by ROS2::ROS2EditorSystemComponent.

Public Member Functions

 AZ_COMPONENT (ROS2SystemComponent, "{cb28d486-afa4-4a9f-a237-ac5eb42e1c87}")
 
std::shared_ptr< rclcpp::Node > GetNode () const override
 
builtin_interfaces::msg::Time GetROSTimestamp () const override
 
void BroadcastTransform (const geometry_msgs::msg::TransformStamped &t, bool isDynamic) const override
 
const SimulationClockGetSimulationClock () const override
 
void InitPassTemplateMappingsHandler ()
 

Static Public Member Functions

static void Reflect (AZ::ReflectContext *context)
 
static void GetProvidedServices (AZ::ComponentDescriptor::DependencyArrayType &provided)
 
static void GetIncompatibleServices (AZ::ComponentDescriptor::DependencyArrayType &incompatible)
 
static void GetRequiredServices (AZ::ComponentDescriptor::DependencyArrayType &required)
 
static void GetDependentServices (AZ::ComponentDescriptor::DependencyArrayType &dependent)
 

Protected Member Functions

void Init () override
 
void Activate () override
 
void Deactivate () override
 
void OnTick (float deltaTime, AZ::ScriptTimePoint time) override
 

Detailed Description

Central singleton-like System Component for ROS2 Gem.


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