A structure for a single ROS2 topic, a part of publisher or subscriber configuration.  
 More...
#include <TopicConfiguration.h>
 | 
| 
static void  | Reflect (AZ::ReflectContext *context) | 
|   | 
 | 
| 
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. 
  | 
|   | 
A structure for a single ROS2 topic, a part of publisher or subscriber configuration. 
 
◆ 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:
- Gems/ROS2/Code/Include/ROS2/Communication/TopicConfiguration.h