, including all inherited members.
  | cam_info_ | tabletop_pushing::PointCloudSegmentation |  | 
  | cloud_diff_thresh_ | tabletop_pushing::PointCloudSegmentation |  | 
  | cloud_intersect_thresh_ | tabletop_pushing::PointCloudSegmentation |  | 
  | cloudsIntersect(XYZPointCloud cloud0, XYZPointCloud cloud1) | tabletop_pushing::PointCloudSegmentation |  | 
  | cloudsIntersect(XYZPointCloud cloud0, XYZPointCloud cloud1, double thresh) | tabletop_pushing::PointCloudSegmentation |  | 
  | cluster_tolerance_ | tabletop_pushing::PointCloudSegmentation |  | 
  | clusterProtoObjects(XYZPointCloud &objects_cloud, ProtoObjects &objs) | tabletop_pushing::PointCloudSegmentation |  | 
  | colors_ | tabletop_pushing::PointCloudSegmentation |  | 
  | cur_camera_header_ | tabletop_pushing::PointCloudSegmentation |  | 
  | cylinder_ransac_angle_thresh_ | tabletop_pushing::PointCloudSegmentation |  | 
  | cylinder_ransac_thresh_ | tabletop_pushing::PointCloudSegmentation |  | 
  | displayObjectImage(cv::Mat &obj_img, std::string win_name="projected objects", bool use_display=true) | tabletop_pushing::PointCloudSegmentation |  | 
  | dist(pcl16::PointXYZ a, pcl16::PointXYZ b) | tabletop_pushing::PointCloudSegmentation |  [inline, static] | 
  | dist(geometry_msgs::Point b, pcl16::PointXYZ a) | tabletop_pushing::PointCloudSegmentation |  [inline, static] | 
  | dist(pcl16::PointXYZ a, geometry_msgs::Point b) | tabletop_pushing::PointCloudSegmentation |  [inline, static] | 
  | downsampleCloud(XYZPointCloud &cloud_in, XYZPointCloud &cloud_down) | tabletop_pushing::PointCloudSegmentation |  | 
  | findTabletopObjects(XYZPointCloud &input_cloud, ProtoObjects &objs, bool use_mps=false) | tabletop_pushing::PointCloudSegmentation |  | 
  | findTabletopObjects(XYZPointCloud &input_cloud, ProtoObjects &objs, XYZPointCloud &objs_cloud, bool use_mps=false) | tabletop_pushing::PointCloudSegmentation |  | 
  | findTabletopObjects(XYZPointCloud &input_cloud, ProtoObjects &objs, XYZPointCloud &objs_cloud, XYZPointCloud &plane_cloud, bool use_mps=false) | tabletop_pushing::PointCloudSegmentation |  | 
  | fitCylinderRANSAC(ProtoObject &obj, XYZPointCloud &cylinder_cloud, pcl16::ModelCoefficients &cylinder) | tabletop_pushing::PointCloudSegmentation |  | 
  | fitSphereRANSAC(ProtoObject &obj, XYZPointCloud &sphere_cloud, pcl16::ModelCoefficients &sphere) | tabletop_pushing::PointCloudSegmentation |  | 
  | getMovedRegions(XYZPointCloud &prev_cloud, XYZPointCloud &cur_cloud, ProtoObjects &moved_regions, std::string suf="") | tabletop_pushing::PointCloudSegmentation |  | 
  | getTableCentroid() const  | tabletop_pushing::PointCloudSegmentation |  [inline] | 
  | getTablePlane(XYZPointCloud &cloud, XYZPointCloud &objs_cloud, XYZPointCloud &plane_cloud, Eigen::Vector4f ¢er, bool find_hull=false, bool find_centroid=false) | tabletop_pushing::PointCloudSegmentation |  | 
  | getTablePlaneMPS(XYZPointCloud &cloud, XYZPointCloud &objs_cloud, XYZPointCloud &plane_cloud, Eigen::Vector4f ¢er, bool find_hull=false, bool find_centroid=false) | tabletop_pushing::PointCloudSegmentation |  | 
  | hull_alpha_ | tabletop_pushing::PointCloudSegmentation |  | 
  | icp_max_cor_dist_ | tabletop_pushing::PointCloudSegmentation |  | 
  | icp_max_iters_ | tabletop_pushing::PointCloudSegmentation |  | 
  | icp_ransac_thresh_ | tabletop_pushing::PointCloudSegmentation |  | 
  | icp_transform_eps_ | tabletop_pushing::PointCloudSegmentation |  | 
  | ICPBoundarySamples(XYZPointCloud &hull_t_0, XYZPointCloud &hull_t_1, Eigen::Matrix4f &transform, XYZPointCloud &aligned) | tabletop_pushing::PointCloudSegmentation |  | 
  | ICPProtoObjects(ProtoObject &a, ProtoObject &b, Eigen::Matrix4f &transform) | tabletop_pushing::PointCloudSegmentation |  | 
  | lineCloudIntersection(XYZPointCloud &cloud, Eigen::Vector3f vec, Eigen::Vector4f base, XYZPointCloud &line_cloud) | tabletop_pushing::PointCloudSegmentation |  | 
  | lineCloudIntersectionEndPoints(XYZPointCloud &cloud, Eigen::Vector3f vec, Eigen::Vector4f base, std::vector< pcl16::PointXYZ > &end_points) | tabletop_pushing::PointCloudSegmentation |  | 
  | matchMovedRegions(ProtoObjects &objs, ProtoObjects &moved_regions) | tabletop_pushing::PointCloudSegmentation |  | 
  | max_cluster_size_ | tabletop_pushing::PointCloudSegmentation |  | 
  | max_table_z_ | tabletop_pushing::PointCloudSegmentation |  | 
  | max_workspace_x_ | tabletop_pushing::PointCloudSegmentation |  | 
  | max_workspace_z_ | tabletop_pushing::PointCloudSegmentation |  | 
  | min_cluster_size_ | tabletop_pushing::PointCloudSegmentation |  | 
  | min_table_z_ | tabletop_pushing::PointCloudSegmentation |  | 
  | min_workspace_x_ | tabletop_pushing::PointCloudSegmentation |  | 
  | min_workspace_z_ | tabletop_pushing::PointCloudSegmentation |  | 
  | moved_count_thresh_ | tabletop_pushing::PointCloudSegmentation |  | 
  | mps_min_angle_thresh_ | tabletop_pushing::PointCloudSegmentation |  | 
  | mps_min_dist_thresh_ | tabletop_pushing::PointCloudSegmentation |  | 
  | mps_min_inliers_ | tabletop_pushing::PointCloudSegmentation |  | 
  | num_downsamples_ | tabletop_pushing::PointCloudSegmentation |  | 
  | optimize_cylinder_coefficients_ | tabletop_pushing::PointCloudSegmentation |  | 
  | PointCloudSegmentation(boost::shared_ptr< tf::TransformListener > tf) | tabletop_pushing::PointCloudSegmentation |  | 
  | pointIntersectsCloud(XYZPointCloud cloud, geometry_msgs::Point pt, double thresh) | tabletop_pushing::PointCloudSegmentation |  | 
  | pointLineXYDist(pcl16::PointXYZ p, Eigen::Vector3f vec, Eigen::Vector4f base) | tabletop_pushing::PointCloudSegmentation |  | 
  | projectPointCloudIntoImage(XYZPointCloud &cloud, cv::Mat &lbl_img, std::string target_frame, unsigned int id=1) | tabletop_pushing::PointCloudSegmentation |  | 
  | projectPointCloudIntoImage(XYZPointCloud &cloud, cv::Mat &lbl_img) | tabletop_pushing::PointCloudSegmentation |  | 
  | projectPointIntoImage(pcl16::PointXYZ cur_point_pcl, std::string point_frame, std::string target_frame) | tabletop_pushing::PointCloudSegmentation |  | 
  | projectPointIntoImage(geometry_msgs::PointStamped cur_point) | tabletop_pushing::PointCloudSegmentation |  | 
  | projectPointIntoImage(geometry_msgs::PointStamped cur_point, std::string target_frame) | tabletop_pushing::PointCloudSegmentation |  | 
  | projectPointIntoImage(Eigen::Vector3f cur_point_eig, std::string point_frame, std::string target_frame) | tabletop_pushing::PointCloudSegmentation |  | 
  | projectProtoObjectIntoImage(ProtoObject &obj, cv::Size img_size, std::string target_frame) | tabletop_pushing::PointCloudSegmentation |  | 
  | projectProtoObjectsIntoImage(ProtoObjects &objs, cv::Size img_size, std::string target_frame) | tabletop_pushing::PointCloudSegmentation |  | 
  | sphere_ransac_thresh_ | tabletop_pushing::PointCloudSegmentation |  | 
  | sqrDist(Eigen::Vector3f &a, pcl16::PointXYZ &b) | tabletop_pushing::PointCloudSegmentation |  [inline, static] | 
  | sqrDist(Eigen::Vector4f &a, Eigen::Vector4f &b) | tabletop_pushing::PointCloudSegmentation |  [inline, static] | 
  | sqrDist(pcl16::PointXYZ a, pcl16::PointXYZ b) | tabletop_pushing::PointCloudSegmentation |  [inline, static] | 
  | sqrDistXY(pcl16::PointXYZ a, pcl16::PointXYZ b) | tabletop_pushing::PointCloudSegmentation |  [inline, static] | 
  | table_centroid_ | tabletop_pushing::PointCloudSegmentation |  [protected] | 
  | table_ransac_angle_thresh_ | tabletop_pushing::PointCloudSegmentation |  | 
  | table_ransac_thresh_ | tabletop_pushing::PointCloudSegmentation |  | 
  | tf_ | tabletop_pushing::PointCloudSegmentation |  [protected] | 
  | use_voxel_down_ | tabletop_pushing::PointCloudSegmentation |  | 
  | voxel_down_res_ | tabletop_pushing::PointCloudSegmentation |  |