6#ifndef YARP_DEV_RANGEFINDER2D_NWS_ROS2_H
7#define YARP_DEV_RANGEFINDER2D_NWS_ROS2_H
16#include <rclcpp/rclcpp.hpp>
17#include <std_msgs/msg/string.hpp>
18#include <sensor_msgs/msg/image.hpp>
19#include <sensor_msgs/msg/camera_info.hpp>
48 bool attach(
yarp::dev::PolyDriver *poly) override;
52 bool open(
yarp::os::Searchable& config) override;
53 bool close() override;
68 param(T& inVar, std::string inName)
77 rclcpp::Node::SharedPtr m_node;
78 rclcpp::Publisher<sensor_msgs::msg::Image>::SharedPtr rosPublisher_color;
79 rclcpp::Publisher<sensor_msgs::msg::Image>::SharedPtr rosPublisher_depth;
80 rclcpp::Publisher<sensor_msgs::msg::CameraInfo>::SharedPtr rosPublisher_colorCaminfo;
81 rclcpp::Publisher<sensor_msgs::msg::CameraInfo>::SharedPtr rosPublisher_depthCaminfo;
83 std::string m_depth_info_topic_name;
84 std::string m_color_info_topic_name;
88 bool m_forceInfoSync {
true};
91 bool setCamInfo(sensor_msgs::msg::CameraInfo& cameraInfo,
92 const std::string& frame_id,
94 const SensorType& sensorType);
This class is the parameters parser for class RgbdSensor_nws_ros2.
RgbdSensor_nws_ros2: A Network grabber for kinect-like devices.
bool detach() override
Detach the object (you must have first called attach).
RgbdSensor_nws_ros2(RgbdSensor_nws_ros2 &&) noexcept=delete
RgbdSensor_nws_ros2(const RgbdSensor_nws_ros2 &)=delete
bool attach(yarp::dev::PolyDriver *poly) override
Attach to another object.
bool open(yarp::os::Searchable &config) override
Open the DeviceDriver.
void run() override
Loop function.
bool close() override
Close the DeviceDriver.
Interface implemented by all device drivers.
Control interface for frame grabber devices.
A generic interface for cameras that have both color camera as well as depth camera sensor,...
Helper interface for an object that can wrap/or "attach" to a single other device.
An interface for reading from a network connection.
An abstraction for a periodic thread.
A base class for nested structures that can be searched.
An abstraction for a time stamp and/or sequence number.
The main, catch-all namespace for YARP.