#include <ros/ros.h>#include <sensor_msgs/Image.h>#include <sensor_msgs/PointCloud2.h>#include <pcl_conversions/pcl_conversions.h>
Go to the source code of this file.
| Functions | |
| int | main (int argc, char **argv) | 
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
convert a pcd to an image file run with: rosrun pcl convert_pcd_image cloud_00042.pcd It will publish a ros image message on /pcd/image View the image with: rosrun image_view image_view image:=/pcd/image
Definition at line 56 of file convert_pcd_to_image.cpp.