bayesian_grasp_planner::RawGraspEvaluatorServiceCaller Class Reference

#include <grasp_evaluator.h>

Inheritance diagram for bayesian_grasp_planner::RawGraspEvaluatorServiceCaller:
Inheritance graph
[legend]

List of all members.

Public Member Functions

double evaluate (const GraspWM &grasp, const object_manipulation_msgs::GraspableObject &object) const
 Evalute a single grasp (raw grasp metric).
void evaluate_list (std::vector< GraspWM > &grasps, const object_manipulation_msgs::GraspableObject &object, std::vector< double > &values)
 Evaluate an entire list of grasps (overwrite if there is a batch operation for an inherited class).
 RawGraspEvaluatorServiceCaller (ros::NodeHandle &nh, std::string service_name, bool object_dependent)

Private Attributes

ros::ServiceClient service_
std::string service_name_

Detailed Description

Definition at line 147 of file grasp_evaluator.h.


Constructor & Destructor Documentation

bayesian_grasp_planner::RawGraspEvaluatorServiceCaller::RawGraspEvaluatorServiceCaller ( ros::NodeHandle &  nh,
std::string  service_name,
bool  object_dependent 
)

Definition at line 99 of file grasp_evaluator.cpp.


Member Function Documentation

double bayesian_grasp_planner::RawGraspEvaluatorServiceCaller::evaluate ( const GraspWM grasp,
const object_manipulation_msgs::GraspableObject &  object 
) const [virtual]

Evalute a single grasp (raw grasp metric).

Implements bayesian_grasp_planner::RawGraspEvaluator.

Definition at line 106 of file grasp_evaluator.cpp.

void bayesian_grasp_planner::RawGraspEvaluatorServiceCaller::evaluate_list ( std::vector< GraspWM > &  grasps,
const object_manipulation_msgs::GraspableObject &  object,
std::vector< double > &  values 
) [virtual]

Evaluate an entire list of grasps (overwrite if there is a batch operation for an inherited class).

Reimplemented from bayesian_grasp_planner::RawGraspEvaluator.

Definition at line 121 of file grasp_evaluator.cpp.


Member Data Documentation

Definition at line 151 of file grasp_evaluator.h.

Definition at line 152 of file grasp_evaluator.h.


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


bayesian_grasp_planner
Author(s): Matei Ciocarlie
autogenerated on Fri Jan 11 09:40:46 2013