Public Member Functions | |
BayesianGraspPlannerNode () | |
virtual | ~BayesianGraspPlannerNode () |
Private Member Functions | |
bool | graspPlanningCB (object_manipulation_msgs::GraspPlanning::Request &request, object_manipulation_msgs::GraspPlanning::Response &response) |
Callback for the grasp planning service. | |
bool | graspTestCB (object_manipulation_msgs::GraspPlanning::Request &request, object_manipulation_msgs::GraspPlanning::Response &response) |
Callback for the grasp test service. | |
bool | initializeDatabase () |
Initializes a connection to the household_objects_database. | |
Private Attributes | |
ObjectsDatabasePtr | database_ |
object_manipulator::GraspMarkerPublisher | debug_grasp_marker_pub_ |
Marker publisher for intermediate grasp lists grouped during the planning process. | |
ros::ServiceServer | grasp_execution_srv_ |
Service server for grasp execution. | |
ros::ServiceClient | grasp_planning_srv_ |
Service client for the grasp planning. | |
ros::ServiceServer | grasp_test_srv_ |
Service server for grasp testing. | |
ros::ServiceClient | object_detection_srv_ |
Service client for the object detection calls. | |
BayesianGraspPlannerPtr | planner_ |
The actual plannner. | |
ros::NodeHandle | priv_nh_ |
object_manipulator::GraspMarkerPublisher | rank_grasp_marker_pub_ |
Marker publisher for all of the grasps colored by rank. | |
object_manipulator::GraspMarkerPublisher | results_grasp_marker_pub_ |
Marker publisher for the final grasps list which is returned. | |
ros::NodeHandle | root_nh_ |
Definition at line 65 of file bayesian_grasp_planner_node.cpp.
bayesian_grasp_planner::BayesianGraspPlannerNode::BayesianGraspPlannerNode | ( | ) |
Definition at line 116 of file bayesian_grasp_planner_node.cpp.
bayesian_grasp_planner::BayesianGraspPlannerNode::~BayesianGraspPlannerNode | ( | ) | [virtual] |
Definition at line 205 of file bayesian_grasp_planner_node.cpp.
bool bayesian_grasp_planner::BayesianGraspPlannerNode::graspPlanningCB | ( | object_manipulation_msgs::GraspPlanning::Request & | request, | |
object_manipulation_msgs::GraspPlanning::Response & | response | |||
) | [private] |
Callback for the grasp planning service.
Definition at line 169 of file bayesian_grasp_planner_node.cpp.
bool bayesian_grasp_planner::BayesianGraspPlannerNode::graspTestCB | ( | object_manipulation_msgs::GraspPlanning::Request & | request, | |
object_manipulation_msgs::GraspPlanning::Response & | response | |||
) | [private] |
Callback for the grasp test service.
Definition at line 186 of file bayesian_grasp_planner_node.cpp.
bool bayesian_grasp_planner::BayesianGraspPlannerNode::initializeDatabase | ( | ) | [private] |
Initializes a connection to the household_objects_database.
Definition at line 141 of file bayesian_grasp_planner_node.cpp.
ObjectsDatabasePtr bayesian_grasp_planner::BayesianGraspPlannerNode::database_ [private] |
Definition at line 92 of file bayesian_grasp_planner_node.cpp.
object_manipulator::GraspMarkerPublisher bayesian_grasp_planner::BayesianGraspPlannerNode::debug_grasp_marker_pub_ [private] |
Marker publisher for intermediate grasp lists grouped during the planning process.
Definition at line 84 of file bayesian_grasp_planner_node.cpp.
ros::ServiceServer bayesian_grasp_planner::BayesianGraspPlannerNode::grasp_execution_srv_ [private] |
Service server for grasp execution.
Definition at line 78 of file bayesian_grasp_planner_node.cpp.
ros::ServiceClient bayesian_grasp_planner::BayesianGraspPlannerNode::grasp_planning_srv_ [private] |
Service client for the grasp planning.
Definition at line 75 of file bayesian_grasp_planner_node.cpp.
ros::ServiceServer bayesian_grasp_planner::BayesianGraspPlannerNode::grasp_test_srv_ [private] |
Service server for grasp testing.
Definition at line 81 of file bayesian_grasp_planner_node.cpp.
ros::ServiceClient bayesian_grasp_planner::BayesianGraspPlannerNode::object_detection_srv_ [private] |
Service client for the object detection calls.
Definition at line 73 of file bayesian_grasp_planner_node.cpp.
The actual plannner.
Definition at line 97 of file bayesian_grasp_planner_node.cpp.
ros::NodeHandle bayesian_grasp_planner::BayesianGraspPlannerNode::priv_nh_ [private] |
Definition at line 69 of file bayesian_grasp_planner_node.cpp.
object_manipulator::GraspMarkerPublisher bayesian_grasp_planner::BayesianGraspPlannerNode::rank_grasp_marker_pub_ [private] |
Marker publisher for all of the grasps colored by rank.
Definition at line 90 of file bayesian_grasp_planner_node.cpp.
object_manipulator::GraspMarkerPublisher bayesian_grasp_planner::BayesianGraspPlannerNode::results_grasp_marker_pub_ [private] |
Marker publisher for the final grasps list which is returned.
Definition at line 87 of file bayesian_grasp_planner_node.cpp.
ros::NodeHandle bayesian_grasp_planner::BayesianGraspPlannerNode::root_nh_ [private] |
Definition at line 70 of file bayesian_grasp_planner_node.cpp.