#include "sick_scan/sick_scan_base.h"
#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< class > |
Same as a PointCloud2Iterator but for const data. | |
class | sensor_msgs::PointCloud2Iterator< class > |
Class that can iterate over a PointCloud2. | |
class | sensor_msgs::impl::PointCloud2IteratorBase< class, class, class, class, V > |
class | sensor_msgs::PointCloud2Modifier |
Enables modifying a sensor_msgs::PointCloud2 like a container. | |
Namespaces | |
sensor_msgs | |
Tools for manipulating sensor_msgs. | |
sensor_msgs::impl | |
Macros | |
#define | SENSOR_MSGS_POINT_CLOUD2_ITERATOR_H |
#define SENSOR_MSGS_POINT_CLOUD2_ITERATOR_H |
Definition at line 37 of file point_cloud2_iterator.h.