Public Member Functions | |
RegressionGraspEvaluatorNode () | |
virtual | ~RegressionGraspEvaluatorNode () |
Private Member Functions | |
void | appendMetadataToTestGrasps (std::vector< object_manipulation_msgs::Grasp > &input_list, std::vector< GraspWM > &output_list, const std::string frame_id) |
bool | graspEvalCB (object_manipulation_msgs::GraspPlanning::Request &request, object_manipulation_msgs::GraspPlanning::Response &response) |
Callback for the grasp eval service. | |
bool | initializeDatabase () |
Initializes a connection to the household_objects_database. | |
Private Attributes | |
ObjectsDatabasePtr | database_ |
ros::ServiceServer | grasp_eval_srv_ |
Service server for grasp evaluation. | |
ros::NodeHandle | priv_nh_ |
ros::NodeHandle | root_nh_ |
Definition at line 32 of file regression_grasp_evaluator_node.cpp.
Definition at line 62 of file regression_grasp_evaluator_node.cpp.
virtual bayesian_grasp_planner::RegressionGraspEvaluatorNode::~RegressionGraspEvaluatorNode | ( | ) | [inline, virtual] |
Definition at line 59 of file regression_grasp_evaluator_node.cpp.
void bayesian_grasp_planner::RegressionGraspEvaluatorNode::appendMetadataToTestGrasps | ( | std::vector< object_manipulation_msgs::Grasp > & | input_list, |
std::vector< GraspWM > & | output_list, | ||
const std::string | frame_id | ||
) | [private] |
The "tool point" is roughly in the middle of the object enclosed by the grasp, so roughly 13cm from wrist
Definition at line 197 of file regression_grasp_evaluator_node.cpp.
Callback for the grasp eval service.
Definition at line 104 of file regression_grasp_evaluator_node.cpp.
Initializes a connection to the household_objects_database.
Definition at line 75 of file regression_grasp_evaluator_node.cpp.
Definition at line 42 of file regression_grasp_evaluator_node.cpp.
Service server for grasp evaluation.
Definition at line 40 of file regression_grasp_evaluator_node.cpp.
Definition at line 36 of file regression_grasp_evaluator_node.cpp.
Definition at line 37 of file regression_grasp_evaluator_node.cpp.