Template Function sensor_msgs::readPointCloud2BufferValue(const unsigned char *)

Function Documentation

template<int point_field_type, typename T>
inline T sensor_msgs::readPointCloud2BufferValue(const unsigned char *data_ptr)

Converts a value at the given pointer position, interpreted as the datatype specified by the given template argument point_field_type, to the given template type T and returns it.

Parameters

data_ptr – pointer into the point cloud 2 buffer

Template Parameters
  • point_field_type – sensor_msgs::PointField datatype value

  • T – return type