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::TopicConfiguration Struct Reference

A structure for a single ROS2 topic, a part of publisher or subscriber configuration. More...

#include <TopicConfiguration.h>

Public Member Functions

 AZ_TYPE_INFO (TopicConfiguration, "{7535D58F-5284-4657-A799-1F69D3F5AA42}")
 
rclcpp::QoS GetQoS () const
 

Static Public Member Functions

static void Reflect (AZ::ReflectContext *context)
 

Public Attributes

AZStd::string m_type = "std_msgs::msg::Empty"
 descriptive topic type for identification.
 
AZStd::string m_topic = "default_topic"
 Topic to publish. Final topic will have a namespace added.
 

Detailed Description

A structure for a single ROS2 topic, a part of publisher or subscriber configuration.

Member Function Documentation

◆ GetQoS()

rclcpp::QoS ROS2::TopicConfiguration::GetQoS ( ) const
inline

Get topic QoS (Quality of Service) settings.

See also
ROS2::QoS.

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