#include <filesystem>
#include <map>
#include <memory>
#include <string>
#include <fmt/format.h>
#include <mqtt_client_interfaces/srv/is_connected.hpp>
#include <mqtt/async_client.h>
#include <rclcpp/rclcpp.hpp>
#include <rclcpp/serialization.hpp>
#include <std_msgs/msg/float64.hpp>
Go to the source code of this file.
Classes | |
struct | mqtt_client::MqttClient::BrokerConfig |
Struct containing broker parameters. More... | |
struct | mqtt_client::MqttClient::ClientConfig |
Struct containing client parameters. More... | |
struct | mqtt_client::MqttClient::Mqtt2RosInterface |
Struct containing variables related to a MQTT2ROS connection. More... | |
class | mqtt_client::MqttClient |
ROS Nodelet for sending and receiving ROS messages via MQTT. More... | |
struct | mqtt_client::MqttClient::Ros2MqttInterface |
Struct containing variables related to a ROS2MQTT connection. More... | |
Namespaces | |
mqtt_client | |
Namespace for the mqtt_client package. | |
Macros | |
#define | FMT_HEADER_ONLY |
Functions | |
template<typename T > | |
void | mqtt_client::deserializeRosMessage (const rclcpp::SerializedMessage &serialized_msg, T &msg) |
template<typename T > | |
void | mqtt_client::serializeRosMessage (const T &msg, rclcpp::SerializedMessage &serialized_msg) |
#define FMT_HEADER_ONLY |
Definition at line 35 of file MqttClient.ros2.hpp.