#include <sensor_msgs/PointCloud.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/point_field_conversion.h>
Go to the source code of this file.
Namespaces | |
namespace | sensor_msgs |
Tools for manipulating sensor_msgs. | |
Functions | |
static bool | sensor_msgs::convertPointCloud2ToPointCloud (const sensor_msgs::PointCloud2 &input, sensor_msgs::PointCloud &output) |
Convert a sensor_msgs::PointCloud2 message to a sensor_msgs::PointCloud message. | |
static bool | sensor_msgs::convertPointCloudToPointCloud2 (const sensor_msgs::PointCloud &input, sensor_msgs::PointCloud2 &output) |
Convert a sensor_msgs::PointCloud message to a sensor_msgs::PointCloud2 message. | |
static int | sensor_msgs::getPointCloud2FieldIndex (const sensor_msgs::PointCloud2 &cloud, const std::string &field_name) |
Get the index of a specified field (i.e., dimension/channel) |