#include <sensor_msgs/Image.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/PointCloud.h>
Go to the source code of this file.
Namespaces | |
astra_ros | |
Functions | |
bool | astra_ros::defaultMask (const std::size_t x, const std::size_t y) |
sensor_msgs::PointCloud | astra_ros::toPointCloud (const sensor_msgs::Image &rgb, const sensor_msgs::Image ®istered_depth, const sensor_msgs::CameraInfo &camera_info, const std::function< bool(const std::size_t x, const std::size_t y)> &mask=defaultMask) |