#include <tabletop_detector.h>
Public Member Functions | |
void | onInit () |
void | pcCallback (PointCloud2::ConstPtr pc) |
bool | srvCallback (hrl_object_fetching::DetectTable::Request &req, hrl_object_fetching::DetectTable::Response &resp) |
TabletopDetector () | |
Public Attributes | |
geometry_msgs::PoseArray | grasp_points |
bool | grasp_points_found |
image_transport::Publisher | height_pub |
image_transport::ImageTransport | img_trans |
ros::NodeHandle | nh |
ros::NodeHandle | nh_priv |
ros::Publisher | pc_pub |
ros::Subscriber | pc_sub |
ros::Publisher | pose_arr_pub |
ros::ServiceServer | table_detect_service |
tf::TransformListener | tf_listener |
Definition at line 28 of file tabletop_detector.h.
Definition at line 6 of file tabletop_detector.cpp.
Definition at line 10 of file tabletop_detector.cpp.
void hrl_object_fetching::TabletopDetector::pcCallback | ( | PointCloud2::ConstPtr | pc | ) |
Definition at line 42 of file tabletop_detector.cpp.
bool hrl_object_fetching::TabletopDetector::srvCallback | ( | hrl_object_fetching::DetectTable::Request & | req, |
hrl_object_fetching::DetectTable::Response & | resp | ||
) |
Definition at line 24 of file tabletop_detector.cpp.
geometry_msgs::PoseArray hrl_object_fetching::TabletopDetector::grasp_points |
Definition at line 38 of file tabletop_detector.h.
Definition at line 37 of file tabletop_detector.h.
Definition at line 40 of file tabletop_detector.h.
Definition at line 39 of file tabletop_detector.h.
Definition at line 33 of file tabletop_detector.h.
Definition at line 34 of file tabletop_detector.h.
Definition at line 35 of file tabletop_detector.h.
Definition at line 32 of file tabletop_detector.h.
Definition at line 36 of file tabletop_detector.h.
Definition at line 31 of file tabletop_detector.h.
Definition at line 41 of file tabletop_detector.h.