6#ifndef YARP_DEV_RGBDTOPOINTCLOUDSENSOR_NWS_ROS2_H
7#define YARP_DEV_RGBDTOPOINTCLOUDSENSOR_NWS_ROS2_H
16#include <rclcpp/rclcpp.hpp>
17#include <std_msgs/msg/string.hpp>
18#include <sensor_msgs/msg/point_cloud2.hpp>
68 typedef unsigned int UInt;
69 rclcpp::Publisher<sensor_msgs::msg::PointCloud2>::SharedPtr m_rosPublisher_pointCloud2;
70 rclcpp::Node::SharedPtr m_node;
81 param(T& inVar, std::string inName)
94 bool m_forceInfoSync {
true};
101 static std::string yarp2RosPixelCode(
int code);
120 bool attach(
yarp::dev::PolyDriver *poly) override;
124 bool open(
yarp::os::Searchable& config) override;
125 bool close() override;
This class is the parameters parser for class RgbdToPointCloudSensor_nws_ros2.
rgbdToPointCloudSensor_nws_ros2: A Network grabber for kinect-like devices.
RgbdToPointCloudSensor_nws_ros2(const RgbdToPointCloudSensor_nws_ros2 &)=delete
RgbdToPointCloudSensor_nws_ros2()
RgbdToPointCloudSensor_nws_ros2(RgbdToPointCloudSensor_nws_ros2 &&) noexcept=delete
bool close() override
Close the DeviceDriver.
bool detach() override
Detach the object (you must have first called attach).
bool open(yarp::os::Searchable &config) override
Open the DeviceDriver.
void run() override
Loop function.
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.
A mini-server for performing network communication in the background.
An interface for reading from a network connection.
An abstraction for a periodic thread.
A class for storing options and configuration information.
A base class for nested structures that can be searched.
const std::string frameId_param
const std::string nodeName_param
constexpr double DEFAULT_THREAD_PERIOD
const std::string pointCloudTopicName_param
The main, catch-all namespace for YARP.