Struct containing variables related to a ROS2MQTT connection. More...
#include <MqttClient.h>
Public Attributes | |
| struct { | |
| int qos = 0 | |
| MQTT QoS value. More... | |
| bool retained = false | |
| whether to retain MQTT message More... | |
| std::string topic | |
| MQTT topic. More... | |
| } | mqtt |
| MQTT-related variables. More... | |
| struct { | |
| int qos = 0 | |
| MQTT QoS value. More... | |
| bool retained = false | |
| whether to retain MQTT message More... | |
| std::string topic | |
| MQTT topic. More... | |
| } | mqtt |
| MQTT-related variables. More... | |
| bool | primitive = false |
| whether to publish as primitive message More... | |
| struct { | |
| std::string msg_type | |
| message type of subscriber More... | |
| int queue_size = 1 | |
| ROS subscriber queue size. More... | |
| rclcpp::GenericSubscription::SharedPtr subscriber | |
| generic ROS subscriber More... | |
| } | ros |
| ROS-related variables. More... | |
| struct { | |
| int queue_size = 1 | |
| ROS subscriber queue size. More... | |
| ros::Subscriber subscriber | |
| generic ROS subscriber More... | |
| } | ros |
| ROS-related variables. More... | |
| bool | stamped = false |
| whether to inject timestamp in MQTT message More... | |
Struct containing variables related to a ROS2MQTT connection.
Definition at line 377 of file MqttClient.h.
| struct { ... } mqtt_client::MqttClient::Ros2MqttInterface::mqtt |
MQTT-related variables.
| struct { ... } mqtt_client::MqttClient::Ros2MqttInterface::mqtt |
MQTT-related variables.
| std::string mqtt_client::MqttClient::Ros2MqttInterface::msg_type |
message type of subscriber
Definition at line 375 of file MqttClient.ros2.hpp.
| bool mqtt_client::MqttClient::Ros2MqttInterface::primitive = false |
whether to publish as primitive message
Definition at line 387 of file MqttClient.h.
| int mqtt_client::MqttClient::Ros2MqttInterface::qos = 0 |
MQTT QoS value.
Definition at line 384 of file MqttClient.h.
| int mqtt_client::MqttClient::Ros2MqttInterface::queue_size = 1 |
ROS subscriber queue size.
Definition at line 380 of file MqttClient.h.
| bool mqtt_client::MqttClient::Ros2MqttInterface::retained = false |
whether to retain MQTT message
Definition at line 385 of file MqttClient.h.
| struct { ... } mqtt_client::MqttClient::Ros2MqttInterface::ros |
ROS-related variables.
| struct { ... } mqtt_client::MqttClient::Ros2MqttInterface::ros |
ROS-related variables.
| bool mqtt_client::MqttClient::Ros2MqttInterface::stamped = false |
whether to inject timestamp in MQTT message
Definition at line 388 of file MqttClient.h.
| rclcpp::GenericSubscription::SharedPtr mqtt_client::MqttClient::Ros2MqttInterface::subscriber |
generic ROS subscriber
Definition at line 374 of file MqttClient.ros2.hpp.
| ros::Subscriber mqtt_client::MqttClient::Ros2MqttInterface::subscriber |
generic ROS subscriber
Definition at line 379 of file MqttClient.h.
| std::string mqtt_client::MqttClient::Ros2MqttInterface::topic |
MQTT topic.
Definition at line 383 of file MqttClient.h.