Public Types | Public Slots | Public Member Functions | Protected Attributes | Private Slots
OrganizedSegmentationDemo Class Reference

#include <organized_segmentation_demo.h>

List of all members.

Public Types

typedef pcl::PointCloud< PointTCloud
typedef Cloud::ConstPtr CloudConstPtr
typedef Cloud::Ptr CloudPtr

Public Slots

void disableClusteringPressed ()
void disableRefinementPressed ()
void displayCurvaturePressed ()
void displayDistanceMapPressed ()
void displayNormalsPressed ()
void toggleCapturePressed ()
void useEdgeAwareComparatorPressed ()
void useEuclideanClusteringPressed ()
void useEuclideanComparatorPressed ()
void usePlanarRefinementPressed ()
void usePlaneComparatorPressed ()
void useRGBComparatorPressed ()

Public Member Functions

void cloud_cb (const CloudConstPtr &cloud)
 OrganizedSegmentationDemo (pcl::Grabber &grabber)
 ~OrganizedSegmentationDemo ()

Protected Attributes

bool capture_
bool data_modified_
bool display_curvature_
bool display_distance_map_
bool display_normals_
pcl::EdgeAwarePlaneComparator
< PointT, pcl::Normal >::Ptr 
edge_aware_comparator_
pcl::EuclideanClusterComparator
< PointT, pcl::Normal,
pcl::Label >::Ptr 
euclidean_cluster_comparator_
pcl::EuclideanPlaneCoefficientComparator
< PointT, pcl::Normal >::Ptr 
euclidean_comparator_
pcl::Grabbergrabber_
pcl::OrganizedMultiPlaneSegmentation
< PointT, pcl::Normal,
pcl::Label
mps
QMutex mtx_
pcl::IntegralImageNormalEstimation
< PointT, pcl::Normal
ne
pcl::PlaneCoefficientComparator
< PointT, pcl::Normal >::Ptr 
plane_comparator_
pcl::PointCloud< PointTprev_cloud_
pcl::PointCloud< PointT >
::CloudVectorType 
prev_clusters_
float * prev_distance_map_
pcl::PointCloud< pcl::Normalprev_normals_
std::vector< pcl::PlanarRegion
< PointT >
, Eigen::aligned_allocator
< pcl::PlanarRegion< PointT > > > 
prev_regions_
size_t previous_clusters_size_
size_t previous_data_size_
pcl::RGBPlaneCoefficientComparator
< PointT, pcl::Normal
rgb_comp_
pcl::RGBPlaneCoefficientComparator
< PointT, pcl::Normal >::Ptr 
rgb_comparator_
Ui::MainWindow * ui_
bool use_clustering_
bool use_planar_refinement_
boost::shared_ptr
< pcl::visualization::PCLVisualizer
vis_
QMutex vis_mtx_
QTimer * vis_timer_

Private Slots

void timeoutSlot ()

Detailed Description

Definition at line 88 of file organized_segmentation_demo.h.


Member Typedef Documentation

Definition at line 92 of file organized_segmentation_demo.h.

Definition at line 94 of file organized_segmentation_demo.h.

Definition at line 93 of file organized_segmentation_demo.h.


Constructor & Destructor Documentation

Definition at line 196 of file organized_segmentation_demo.cpp.

Definition at line 99 of file organized_segmentation_demo.h.


Member Function Documentation

Definition at line 270 of file organized_segmentation_demo.cpp.

Definition at line 169 of file organized_segmentation_demo.h.

Definition at line 159 of file organized_segmentation_demo.h.

Definition at line 438 of file organized_segmentation_demo.cpp.

Definition at line 444 of file organized_segmentation_demo.cpp.

Definition at line 450 of file organized_segmentation_demo.cpp.

void OrganizedSegmentationDemo::timeoutSlot ( ) [private, slot]

Definition at line 358 of file organized_segmentation_demo.cpp.

Definition at line 145 of file organized_segmentation_demo.h.

Definition at line 430 of file organized_segmentation_demo.cpp.

Definition at line 174 of file organized_segmentation_demo.h.

Definition at line 406 of file organized_segmentation_demo.cpp.

Definition at line 164 of file organized_segmentation_demo.h.

Definition at line 422 of file organized_segmentation_demo.cpp.

Definition at line 414 of file organized_segmentation_demo.cpp.


Member Data Documentation

Definition at line 125 of file organized_segmentation_demo.h.

Definition at line 126 of file organized_segmentation_demo.h.

Definition at line 131 of file organized_segmentation_demo.h.

Definition at line 132 of file organized_segmentation_demo.h.

Definition at line 130 of file organized_segmentation_demo.h.

Definition at line 141 of file organized_segmentation_demo.h.

Definition at line 142 of file organized_segmentation_demo.h.

Definition at line 138 of file organized_segmentation_demo.h.

Definition at line 109 of file organized_segmentation_demo.h.

Definition at line 123 of file organized_segmentation_demo.h.

QMutex OrganizedSegmentationDemo::mtx_ [protected]

Definition at line 111 of file organized_segmentation_demo.h.

Definition at line 122 of file organized_segmentation_demo.h.

Definition at line 137 of file organized_segmentation_demo.h.

Definition at line 115 of file organized_segmentation_demo.h.

Definition at line 120 of file organized_segmentation_demo.h.

Definition at line 118 of file organized_segmentation_demo.h.

Definition at line 116 of file organized_segmentation_demo.h.

std::vector<pcl::PlanarRegion<PointT>, Eigen::aligned_allocator<pcl::PlanarRegion<PointT> > > OrganizedSegmentationDemo::prev_regions_ [protected]

Definition at line 117 of file organized_segmentation_demo.h.

Definition at line 128 of file organized_segmentation_demo.h.

Definition at line 127 of file organized_segmentation_demo.h.

Definition at line 140 of file organized_segmentation_demo.h.

Definition at line 139 of file organized_segmentation_demo.h.

Ui::MainWindow* OrganizedSegmentationDemo::ui_ [protected]

Definition at line 113 of file organized_segmentation_demo.h.

Definition at line 135 of file organized_segmentation_demo.h.

Definition at line 134 of file organized_segmentation_demo.h.

Definition at line 108 of file organized_segmentation_demo.h.

Definition at line 112 of file organized_segmentation_demo.h.

Definition at line 114 of file organized_segmentation_demo.h.


The documentation for this class was generated from the following files:


pcl
Author(s): Open Perception
autogenerated on Wed Aug 26 2015 15:38:53