#include "point_cloud_transformer.h"
#include <rviz/helpers/color.h>
#include <sensor_msgs/PointCloud2.h>
Go to the source code of this file.
Classes | |
class | rviz::AxisColorPCTransformer |
class | rviz::FlatColorPCTransformer |
class | rviz::IntensityPCTransformer |
class | rviz::RGB8PCTransformer |
class | rviz::RGBF32PCTransformer |
class | rviz::XYZPCTransformer |
Namespaces | |
namespace | rviz |
Typedefs | |
typedef std::vector< std::string > | rviz::V_string |
Functions | |
int32_t | rviz::findChannelIndex (const sensor_msgs::PointCloud2ConstPtr &cloud, const std::string &channel) |
template<typename T > | |
T | rviz::valueFromCloud (const sensor_msgs::PointCloud2ConstPtr &cloud, uint32_t offset, uint8_t type, uint32_t point_step, uint32_t index) |