Struct containing variables related to a MQTT2ROS connection. More...
#include <MqttClient.h>
Public Attributes | |
struct { | |
int qos = 0 | |
MQTT QoS value. More... | |
} | mqtt |
MQTT-related variables. More... | |
struct { | |
int qos = 0 | |
MQTT QoS value. More... | |
} | mqtt |
MQTT-related variables. More... | |
bool | primitive = false |
struct { | |
bool latched = false | |
whether to latch ROS message More... | |
rclcpp::Publisher< std_msgs::msg::Float64 >::SharedPtr latency_publisher | |
ROS publisher for latency. More... | |
std::string msg_type | |
message type of publisher More... | |
rclcpp::GenericPublisher::SharedPtr publisher | |
generic ROS publisher More... | |
int queue_size = 1 | |
ROS publisher queue size. More... | |
std::string topic | |
ROS topic. More... | |
} | ros |
ROS-related variables. More... | |
struct { | |
bool latched = false | |
whether to latch ROS message More... | |
ros::Publisher latency_publisher | |
ROS publisher for latency. More... | |
ros::Publisher publisher | |
generic ROS publisher More... | |
int queue_size = 1 | |
ROS publisher queue size. More... | |
topic_tools::ShapeShifter shape_shifter | |
ROS msg type ShapeShifter. More... | |
std::string topic | |
ROS topic. More... | |
} | ros |
ROS-related variables. More... | |
bool | stamped = false |
whether timestamp is injected More... | |
Struct containing variables related to a MQTT2ROS connection.
Definition at line 394 of file MqttClient.h.
bool mqtt_client::MqttClient::Mqtt2RosInterface::latched = false |
whether to latch ROS message
Definition at line 404 of file MqttClient.h.
rclcpp::Publisher<std_msgs::msg::Float64>::SharedPtr mqtt_client::MqttClient::Mqtt2RosInterface::latency_publisher |
ROS publisher for latency.
Definition at line 399 of file MqttClient.ros2.hpp.
ros::Publisher mqtt_client::MqttClient::Mqtt2RosInterface::latency_publisher |
ROS publisher for latency.
Definition at line 402 of file MqttClient.h.
struct { ... } mqtt_client::MqttClient::Mqtt2RosInterface::mqtt |
MQTT-related variables.
struct { ... } mqtt_client::MqttClient::Mqtt2RosInterface::mqtt |
MQTT-related variables.
std::string mqtt_client::MqttClient::Mqtt2RosInterface::msg_type |
message type of publisher
Definition at line 396 of file MqttClient.ros2.hpp.
bool mqtt_client::MqttClient::Mqtt2RosInterface::primitive = false |
whether to publish as primitive message (if coming from non-ROS MQTT client)
Definition at line 406 of file MqttClient.h.
rclcpp::GenericPublisher::SharedPtr mqtt_client::MqttClient::Mqtt2RosInterface::publisher |
generic ROS publisher
Definition at line 397 of file MqttClient.ros2.hpp.
ros::Publisher mqtt_client::MqttClient::Mqtt2RosInterface::publisher |
generic ROS publisher
Definition at line 400 of file MqttClient.h.
int mqtt_client::MqttClient::Mqtt2RosInterface::qos = 0 |
MQTT QoS value.
Definition at line 396 of file MqttClient.h.
int mqtt_client::MqttClient::Mqtt2RosInterface::queue_size = 1 |
ROS publisher queue size.
Definition at line 403 of file MqttClient.h.
struct { ... } mqtt_client::MqttClient::Mqtt2RosInterface::ros |
ROS-related variables.
struct { ... } mqtt_client::MqttClient::Mqtt2RosInterface::ros |
ROS-related variables.
topic_tools::ShapeShifter mqtt_client::MqttClient::Mqtt2RosInterface::shape_shifter |
ROS msg type ShapeShifter.
Definition at line 401 of file MqttClient.h.
bool mqtt_client::MqttClient::Mqtt2RosInterface::stamped = false |
whether timestamp is injected
Definition at line 408 of file MqttClient.h.
std::string mqtt_client::MqttClient::Mqtt2RosInterface::topic |
ROS topic.
Definition at line 399 of file MqttClient.h.