#include <sensor_msgs/PointCloud2.h>
#include <cstdarg>
#include <string>
#include <vector>
#include <sensor_msgs/impl/point_cloud2_iterator.h>
Go to the source code of this file.
Classes | |
class | sensor_msgs::PointCloud2ConstIterator< T > |
Same as a PointCloud2Iterator but for const data. More... | |
class | sensor_msgs::PointCloud2Iterator< T > |
Class that can iterate over a PointCloud2. More... | |
class | sensor_msgs::impl::PointCloud2IteratorBase< T, TT, U, C, V > |
class | sensor_msgs::PointCloud2Modifier |
Enables modifying a sensor_msgs::PointCloud2 like a container. More... | |
Namespaces | |
namespace | sensor_msgs |
Tools for manipulating sensor_msgs. | |
namespace | sensor_msgs::impl |