#include <ros/ros.h>
#include <boost/thread/mutex.hpp>
#include <boost/thread.hpp>
#include <pcl_ros/point_cloud.h>
#include "pcl/ModelCoefficients.h"
#include "pcl/point_types.h"
#include "pcl/io/pcd_io.h"
#include "pcl/sample_consensus/method_types.h"
#include "pcl/sample_consensus/model_types.h"
#include "pcl/segmentation/sac_segmentation.h"
#include <pcl/filters/extract_indices.h>
#include <pcl/filters/passthrough.h>
#include "sensor_msgs/Image.h"
#include "image_transport/image_transport.h"
#include "cv_bridge/CvBridge.h"
#include <opencv/cv.h>
#include <opencv/highgui.h>
#include <vector>
#include "geometry_msgs/Point.h"
#include "UI_segment_object/GetObject.h"
#include "UI_segment_object/GetPt.h"
#include "UI_segment_object/None_Bool.h"
#include "UI_segment_object/Save.h"
#include "pcl_ros/transforms.h"
#include <tf/transform_listener.h>
Go to the source code of this file.
Function Documentation
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
Variable Documentation