Struct MqttClient::Mqtt2RosInterface

Nested Relationships

This struct is a nested type of Class MqttClient.

Struct Documentation

struct Mqtt2RosInterface

Struct containing variables related to a MQTT2ROS connection.

Public Members

int qos = 0

MQTT QoS value.

struct mqtt_client::MqttClient::Mqtt2RosInterface mqtt

MQTT-related variables.

std::string topic

ROS topic.

std::string msg_type

message type of publisher

rclcpp::GenericPublisher::SharedPtr publisher

generic ROS publisher

rclcpp::Publisher<std_msgs::msg::Float64>::SharedPtr latency_publisher

ROS publisher for latency.

int queue_size = 1

ROS publisher queue size.

rclcpp::ReliabilityPolicy reliability = rclcpp::ReliabilityPolicy::SystemDefault
rclcpp::DurabilityPolicy durability = rclcpp::DurabilityPolicy::SystemDefault
struct mqtt_client::MqttClient::Mqtt2RosInterface qos
bool latched = false

whether to latch ROS message

bool is_stale = false

whether a new generic publisher/subscriber is required

struct mqtt_client::MqttClient::Mqtt2RosInterface ros

ROS-related variables.

bool fixed_type = false

whether the published ros message type is specified explicitly

bool primitive = false

whether to publish as primitive message (if coming from non-ROS MQTT client)

bool stamped = false

whether timestamp is injected