6#ifndef YARP_ROS2_ROS2TEST_H
7#define YARP_ROS2_ROS2TEST_H
12#include <rclcpp/rclcpp.hpp>
13#include <std_msgs/msg/string.hpp>
22 std::shared_ptr<rclcpp::Node>
node;
56 bool open(
yarp::os::Searchable& config) override;
57 bool close() override;
63 rclcpp::Publisher<std_msgs::msg::String>::SharedPtr m_publisher;
ros2test: A Network publisher test
MinimalPublisher(const std::string &topicname)
std::shared_ptr< rclcpp::Node > node
bool open(yarp::os::Searchable &config) override
Open the DeviceDriver.
bool close() override
Close the DeviceDriver.
Ros2Test(Ros2Test &&) noexcept=delete
void run() override
Loop function.
Ros2Test(const Ros2Test &)=delete
Interface implemented by all device drivers.
An abstraction for a periodic thread.
The main, catch-all namespace for YARP.