Classes | |
class | BayesianGraspPlanner |
class | BayesianGraspPlannerNode |
class | BimodalGaussianProbabilityDistribution |
Specialized distribution for the cluster planner--Gaussian except for 0 values (treated as a separate mode). More... | |
class | DatabaseObjectDetector |
class | GaussianProbabilityDistribution |
Gaussian distribution (if for an unshifted/unflipped value, use min, max, and/or flip). More... | |
class | GraspEvaluatorProb |
class | GraspGenerator |
class | GraspGeneratorDatabaseRetriever |
class | GraspGeneratorServiceCaller |
class | GraspWM |
Grasp with metadata. More... | |
class | IdentityProbabilityDistribution |
class | MultiplexEvaluator |
class | ObjectDetector |
class | ProbabilityDistribution |
class | RawGraspEvaluator |
class | RawGraspEvaluatorServiceCaller |
class | RawGraspEvaluatorWithRegression |
class | ServiceWrapper |
Wrapper class for service clients to perform initialization on first use. More... | |
Typedefs | |
typedef boost::shared_ptr < BayesianGraspPlanner > | BayesianGraspPlannerPtr |
Functions | |
bool | operator< (const GraspWM &g1, const GraspWM &g2) |
void | pplist (const std::vector< double > &list) |
template<class svcType > | |
ros::ServiceClient | register_service (ros::NodeHandle &nh, const std::string &service_name) |
Variables | |
static const std::string | PLANNING_MARKERS_OUT_NAME = "grasp_planning_markers" |
typedef boost::shared_ptr<BayesianGraspPlanner> bayesian_grasp_planner::BayesianGraspPlannerPtr |
Definition at line 108 of file bayesian_grasp_planner.h.
bool bayesian_grasp_planner::operator< | ( | const GraspWM & | g1, | |
const GraspWM & | g2 | |||
) | [inline] |
Definition at line 81 of file bayesian_grasp_planner_tools.h.
void bayesian_grasp_planner::pplist | ( | const std::vector< double > & | list | ) | [inline] |
Definition at line 88 of file bayesian_grasp_planner_tools.h.
ros::ServiceClient bayesian_grasp_planner::register_service | ( | ros::NodeHandle & | nh, | |
const std::string & | service_name | |||
) | [inline] |
Definition at line 99 of file bayesian_grasp_planner_tools.h.
const std::string bayesian_grasp_planner::PLANNING_MARKERS_OUT_NAME = "grasp_planning_markers" [static] |
Definition at line 63 of file bayesian_grasp_planner_node.cpp.