#include <ros/ros.h>
#include <image_transport/image_transport.h>
#include <opencv/cv.h>
#include <opencv/highgui.h>
#include <cv_bridge/CvBridge.h>
#include <image_geometry/pinhole_camera_model.h>
#include <pcl_ros/transforms.h>
#include <tf/transform_listener.h>
#include <tf/transform_broadcaster.h>
#include <angles/angles.h>
#include <sensor_msgs/PointCloud.h>
#include <boost/thread/mutex.hpp>
#include <pcl/ros/conversions.h>
#include <sensor_msgs/point_cloud_conversion.h>
#include <pcl/point_types.h>
#include <pcl/io/pcd_io.h>
#include "pcl/filters/extract_indices.h"
#include "pcl/segmentation/extract_clusters.h"
#include "pcl/kdtree/kdtree_flann.h"
#include <boost/algorithm/string.hpp>
#include <boost/filesystem.hpp>
#include "pcl/common/common.h"
#include <geometry_msgs/PolygonStamped.h>
Go to the source code of this file.
Classes | |
class | PointCloudToImageProjector |
Typedefs | |
typedef pcl::KdTree< Point >::Ptr | KdTreePtr |
typedef pcl::PointXYZ | Point |
Functions | |
int | main (int argc, char **argv) |
Definition at line 33 of file pointcloud_to_image_projector_opencv.cpp.
typedef pcl::PointXYZ Point |
Definition at line 32 of file pointcloud_to_image_projector_opencv.cpp.
Definition at line 314 of file pointcloud_to_image_projector_opencv.cpp.