point_cloud.hpp
Go to the documentation of this file.
1 #ifndef _ASTRA_ROS_POINT_CLOUD_HPP_
2 #define _ASTRA_ROS_POINT_CLOUD_HPP_
3 
4 #include <sensor_msgs/Image.h>
5 #include <sensor_msgs/CameraInfo.h>
6 #include <sensor_msgs/PointCloud.h>
7 
8 namespace astra_ros
9 {
10  bool defaultMask(const std::size_t x, const std::size_t y);
11  sensor_msgs::PointCloud toPointCloud(const sensor_msgs::Image &rgb, const sensor_msgs::Image &registered_depth, const sensor_msgs::CameraInfo &camera_info, const std::function<bool (const std::size_t x, const std::size_t y)> &mask = defaultMask);
12 }
13 
14 #endif
astra_ros::toPointCloud
sensor_msgs::PointCloud toPointCloud(const sensor_msgs::Image &rgb, const sensor_msgs::Image &registered_depth, const sensor_msgs::CameraInfo &camera_info, const std::function< bool(const std::size_t x, const std::size_t y)> &mask=defaultMask)
Definition: point_cloud.cpp:72
astra_ros::defaultMask
bool defaultMask(const std::size_t x, const std::size_t y)
Definition: point_cloud.cpp:67
astra_ros
Definition: Device.hpp:14


astra_ros
Author(s): Braden McDorman
autogenerated on Wed Mar 2 2022 00:53:06