tabletop_object_detector::ObjectInHandSegmenter Class Reference

List of all members.

Public Member Functions

 ObjectInHandSegmenter (ros::NodeHandle nh)

Private Types

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

Private Member Functions

void combineClustersNearPoint (std::vector< pcl::PointIndices > clusters, pcl::PointCloud< Point > input_cloud, std::string wrist_frame, double x, double y, double z, double dist, pcl::PointCloud< Point > &output_cluster)
int segmentObject (std::string wrist_frame, sensor_msgs::PointCloud2 &output_cluster)
bool serviceCallback (SegmentObjectInHand::Request &request, SegmentObjectInHand::Response &response)

Private Attributes

double cluster_distance_
tf::TransformListener listener_
double max_dist_from_center_
double min_cluster_size_
ros::NodeHandle nh_
double object_center_x_
double object_center_y_
double object_center_z_
ros::NodeHandle priv_nh_
ros::Publisher pub_cloud_
ros::ServiceServer segmentation_srv_
std::string self_filtered_cloud_name_
ros::Subscriber sub_cloud_
std::string visualization_topic_
double x_filter_max_
double x_filter_min_
double y_filter_max_
double y_filter_min_
double z_filter_max_
double z_filter_min_

Detailed Description

Definition at line 53 of file segment_object_in_hand.cpp.


Member Typedef Documentation

Definition at line 53 of file segment_object_in_hand.cpp.

Definition at line 52 of file segment_object_in_hand.cpp.


Constructor & Destructor Documentation

tabletop_object_detector::ObjectInHandSegmenter::ObjectInHandSegmenter ( ros::NodeHandle  nh  )  [inline]

Definition at line 56 of file segment_object_in_hand.cpp.


Member Function Documentation

void tabletop_object_detector::ObjectInHandSegmenter::combineClustersNearPoint ( std::vector< pcl::PointIndices >  clusters,
pcl::PointCloud< Point input_cloud,
std::string  wrist_frame,
double  x,
double  y,
double  z,
double  dist,
pcl::PointCloud< Point > &  output_cluster 
) [inline, private]

Combine all clusters with points within dist of (x,y,z) in wrist_frame

Definition at line 246 of file segment_object_in_hand.cpp.

int tabletop_object_detector::ObjectInHandSegmenter::segmentObject ( std::string  wrist_frame,
sensor_msgs::PointCloud2 &  output_cluster 
) [inline, private]

find the connected points for an object in the robot's hand based on the next point cloud received

Definition at line 135 of file segment_object_in_hand.cpp.

bool tabletop_object_detector::ObjectInHandSegmenter::serviceCallback ( SegmentObjectInHand::Request request,
SegmentObjectInHand::Response response 
) [inline, private]

Service callback for segment object in hand service

Definition at line 119 of file segment_object_in_hand.cpp.


Member Data Documentation

Definition at line 105 of file segment_object_in_hand.cpp.

Definition at line 92 of file segment_object_in_hand.cpp.

Definition at line 111 of file segment_object_in_hand.cpp.

Definition at line 106 of file segment_object_in_hand.cpp.

Definition at line 91 of file segment_object_in_hand.cpp.

Definition at line 110 of file segment_object_in_hand.cpp.

Definition at line 110 of file segment_object_in_hand.cpp.

Definition at line 110 of file segment_object_in_hand.cpp.

Definition at line 91 of file segment_object_in_hand.cpp.

Definition at line 101 of file segment_object_in_hand.cpp.

Definition at line 114 of file segment_object_in_hand.cpp.

Definition at line 107 of file segment_object_in_hand.cpp.

Definition at line 100 of file segment_object_in_hand.cpp.

Definition at line 102 of file segment_object_in_hand.cpp.

Definition at line 95 of file segment_object_in_hand.cpp.

Definition at line 95 of file segment_object_in_hand.cpp.

Definition at line 96 of file segment_object_in_hand.cpp.

Definition at line 96 of file segment_object_in_hand.cpp.

Definition at line 97 of file segment_object_in_hand.cpp.

Definition at line 97 of file segment_object_in_hand.cpp.


The documentation for this class was generated from the following file:
 All Classes Namespaces Files Functions Variables Typedefs Enumerator


tabletop_object_detector
Author(s): Marius Muja and Matei Ciocarlie
autogenerated on Fri Jan 11 09:34:40 2013