Classes | Typedefs | Functions | Variables
drawer_handles_detector.cpp File Reference
#include <ros/ros.h>
#include <visualization_msgs/Marker.h>
#include <sensor_msgs/PointCloud2.h>
#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
#include <pcl/ros/conversions.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/passthrough.h>
#include <pcl/filters/project_inliers.h>
#include <pcl/surface/convex_hull.h>
#include "pcl/filters/extract_indices.h"
#include "pcl/segmentation/extract_polygonal_prism_data.h"
#include "pcl/common/common.h"
#include <pcl/io/pcd_io.h>
#include "pcl/segmentation/extract_clusters.h"
#include <pcl/features/normal_3d.h>
#include <pcl/common/angles.h>
#include <pcl_ros/publisher.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_listener.h>
#include <tf/message_filter.h>
#include <actionlib/server/simple_action_server.h>
#include <handle_detection/HandleDetectionAction.h>
Include dependency graph for drawer_handles_detector.cpp:

Go to the source code of this file.

Classes

class  DrawerHandlesDetector

Typedefs

typedef pcl::KdTree< Point >::Ptr KdTreePtr
typedef pcl::PointXYZ Point
typedef pcl::PointCloud< PointPointCloud
typedef PointCloud::ConstPtr PointCloudConstPtr
typedef PointCloud::Ptr PointCloudPtr

Functions

int main (int argc, char **argv)
const tf::Vector3 wp_normal (1, 0, 0)

Variables

const double wp_offset = -1.45

Typedef Documentation

typedef pcl::KdTree<Point>::Ptr KdTreePtr

Definition at line 81 of file drawer_handles_detector.cpp.

typedef pcl::PointXYZ Point
Author:
Dejan Pangercic

drawer_handles_detector detects furtniture doors and drawers and correponding handles

Definition at line 76 of file drawer_handles_detector.cpp.

Definition at line 77 of file drawer_handles_detector.cpp.

typedef PointCloud::ConstPtr PointCloudConstPtr

Definition at line 80 of file drawer_handles_detector.cpp.

typedef PointCloud::Ptr PointCloudPtr

Definition at line 78 of file drawer_handles_detector.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 479 of file drawer_handles_detector.cpp.

const tf::Vector3 wp_normal ( ,
,
 
)

Variable Documentation

const double wp_offset = -1.45

Definition at line 84 of file drawer_handles_detector.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


handle_detection
Author(s): Nico Blodow
autogenerated on Thu May 23 2013 06:56:42