Classes | Functions | Variables
segment_object_node.cpp File Reference
#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>
Include dependency graph for segment_object_node.cpp:

Go to the source code of this file.

Classes

class  PointCloudPub
class  UI

Functions

int counter (0)
int counter_ind (0)
int done (0)
int main (int argc, char **argv)

Variables

std::vector< int > in_indices
boost::mutex m
std::vector< std::vector< int > > poly_vec
CvPoint pts [1000]

Function Documentation

int counter ( )
int counter_ind ( )
int done ( )
int main ( int  argc,
char **  argv 
)

Definition at line 550 of file segment_object_node.cpp.


Variable Documentation

Definition at line 62 of file segment_object_node.cpp.

boost::mutex m

Definition at line 57 of file segment_object_node.cpp.

Definition at line 61 of file segment_object_node.cpp.

CvPoint pts[1000]

Definition at line 66 of file segment_object_node.cpp.



UI_segment_object
Author(s): Marc Killpack / mkillpack3@gatech.edu, Advisor: Prof. Charlie Kemp, Lab: Healthcare Robotics Lab at Georgia Tech
autogenerated on Wed Nov 27 2013 11:45:01