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

System component for ROS2 editor. More...

#include <ROS2EditorSystemComponent.h>

Inherits ROS2::ROS2SystemComponent, and AzToolsFramework::EditorEntityContextNotificationBus::Handler.

Public Member Functions

 AZ_COMPONENT (ROS2EditorSystemComponent, "{34fa5d9a-956b-4655-a6bc-1d57dce8e7a2}", BaseSystemComponent)
 
- Public Member Functions inherited from ROS2::ROS2SystemComponent
 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 Public Member Functions inherited from ROS2::ROS2SystemComponent
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)
 

Additional Inherited Members

- Protected Member Functions inherited from ROS2::ROS2SystemComponent
void Init () override
 
void Activate () override
 
void Deactivate () override
 
void OnTick (float deltaTime, AZ::ScriptTimePoint time) override
 

Detailed Description

System component for ROS2 editor.


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