Public Member Functions | |
bool | captureCallback (std_srvs::EmptyRequest &req, std_srvs::EmptyResponse &resp) |
void | onInit () |
void | pcCallback (sensor_msgs::PointCloud2::ConstPtr pc_msg) |
SurfaceSegmentation () | |
bool | surfSegCallback (hrl_table_detect::SegmentSurfaces::Request &req, hrl_table_detect::SegmentSurfaces::Response &resp) |
Public Attributes | |
pcl::PointCloud< PRGB > | accum_pc |
ros::Subscriber | cam_sub |
bool | do_capture |
ros::ServiceServer | get_pc_srv |
ros::ServiceServer | get_table_srv |
geometry_msgs::PoseArray | grasp_points |
ros::NodeHandle | nh |
bool | pc_captured |
ros::Publisher | pc_pub |
ros::Publisher | pc_pub2 |
ros::Publisher | pc_pub3 |
ros::Subscriber | pc_sub |
ros::Publisher | poly_pub |
tf::TransformListener | tf_listener |
Definition at line 52 of file surface_segmentation.cpp.
Definition at line 71 of file surface_segmentation.cpp.
bool hrl_table_detect::SurfaceSegmentation::captureCallback | ( | std_srvs::EmptyRequest & | req, |
std_srvs::EmptyResponse & | resp | ||
) |
Definition at line 86 of file surface_segmentation.cpp.
Definition at line 74 of file surface_segmentation.cpp.
void hrl_table_detect::SurfaceSegmentation::pcCallback | ( | sensor_msgs::PointCloud2::ConstPtr | pc_msg | ) |
Definition at line 98 of file surface_segmentation.cpp.
bool hrl_table_detect::SurfaceSegmentation::surfSegCallback | ( | hrl_table_detect::SegmentSurfaces::Request & | req, |
hrl_table_detect::SegmentSurfaces::Response & | resp | ||
) |
Definition at line 110 of file surface_segmentation.cpp.
Definition at line 59 of file surface_segmentation.cpp.
Definition at line 54 of file surface_segmentation.cpp.
Definition at line 61 of file surface_segmentation.cpp.
Definition at line 57 of file surface_segmentation.cpp.
Definition at line 57 of file surface_segmentation.cpp.
geometry_msgs::PoseArray hrl_table_detect::SurfaceSegmentation::grasp_points |
Definition at line 60 of file surface_segmentation.cpp.
Definition at line 55 of file surface_segmentation.cpp.
Definition at line 61 of file surface_segmentation.cpp.
Definition at line 56 of file surface_segmentation.cpp.
Definition at line 56 of file surface_segmentation.cpp.
Definition at line 56 of file surface_segmentation.cpp.
Definition at line 54 of file surface_segmentation.cpp.
Definition at line 56 of file surface_segmentation.cpp.
Definition at line 58 of file surface_segmentation.cpp.