#include <iostream>#include <ros/ros.h>#include <sensor_msgs/PointCloud2.h>#include <pcl_conversions/pcl_conversions.h>#include <pcl/ModelCoefficients.h>#include <pcl/io/pcd_io.h>#include <pcl/point_types.h>#include <pcl/sample_consensus/method_types.h>#include <pcl/sample_consensus/model_types.h>#include <pcl/segmentation/sac_segmentation.h>#include <pcl/filters/voxel_grid.h>#include <pcl/filters/extract_indices.h>#include <pcl/visualization/cloud_viewer.h>
Go to the source code of this file.
Functions | |
| void | cloud_cb (const pcl::PCLPointCloud2ConstPtr &cloud_blob) |
| int | main (int argc, char **argv) |
Variables | |
| ros::Publisher | pub |
| void cloud_cb | ( | const pcl::PCLPointCloud2ConstPtr & | cloud_blob | ) |
Definition at line 22 of file pcl_find_plane.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 106 of file pcl_find_plane.cpp.
| ros::Publisher pub |
Makes all the non-planar things green, publishes the final result on the /obstacles topic.
Definition at line 19 of file pcl_find_plane.cpp.