|  | 
| static void | clearImage (Image &image) | 
|  | 
| static bool | convertPointCloud2ToPointCloud (const sensor_msgs::PointCloud2 &input, sensor_msgs::PointCloud &output) | 
|  | 
| static bool | convertPointCloudToPointCloud2 (const sensor_msgs::PointCloud &input, sensor_msgs::PointCloud2 &output) | 
|  | 
| static bool | fillImage (Image &image, const std::string &encoding_arg, uint32_t rows_arg, uint32_t cols_arg, uint32_t step_arg, const void *data_arg) | 
|  | 
| static int | getPointCloud2FieldIndex (const sensor_msgs::PointCloud2 &cloud, const std::string &field_name) | 
|  | 
| T | readPointCloud2BufferValue (const unsigned char *data_ptr) | 
|  | 
| T | readPointCloud2BufferValue (const unsigned char *data_ptr, const unsigned char datatype) | 
|  | 
|  | ROS_DECLARE_MESSAGE (PointCloud2) | 
|  | 
| void | writePointCloud2BufferValue (unsigned char *data_ptr, const unsigned char datatype, T value) | 
|  | 
| void | writePointCloud2BufferValue (unsigned char *data_ptr, T value) | 
|  |