Same as a PointCloud2Iterator but for const data. More...
#include <point_cloud2_iterator.h>
Public Member Functions | |
PointCloud2ConstIterator (const sensor_msgs::PointCloud2 &cloud_msg, const std::string &field_name) | |
Public Member Functions inherited from sensor_msgs::impl::PointCloud2IteratorBase< T, const T, const unsigned char, const sensor_msgs::PointCloud2, PointCloud2ConstIterator > | |
PointCloud2ConstIterator< T > | end () const |
bool | operator!= (const PointCloud2ConstIterator< T > &iter) const |
const T & | operator* () const |
PointCloud2ConstIterator< T > | operator+ (int i) |
PointCloud2ConstIterator< T > & | operator++ () |
PointCloud2ConstIterator< T > & | operator+= (int i) |
PointCloud2ConstIterator< T > & | operator= (const PointCloud2ConstIterator< T > &iter) |
const T & | operator[] (size_t i) const |
PointCloud2IteratorBase () | |
PointCloud2IteratorBase (const sensor_msgs::PointCloud2 &cloud_msg, const std::string &field_name) | |
Same as a PointCloud2Iterator but for const data.
Definition at line 292 of file point_cloud2_iterator.h.
|
inline |
Definition at line 295 of file point_cloud2_iterator.h.