|
typedef std::vector< PlannerRunData > | PlannerBenchmarkData |
| Structure to hold information for a single planner's benchmark data. More...
|
|
typedef boost::function< void(const moveit_msgs::MotionPlanRequest &request, PlannerBenchmarkData &benchmark_data)> | PlannerCompletionEventFunction |
|
typedef std::map< std::string, std::string > | PlannerRunData |
| Structure to hold information for a single run of a planner. More...
|
|
typedef boost::function< void(const moveit_msgs::MotionPlanRequest &request, PlannerBenchmarkData &benchmark_data)> | PlannerStartEventFunction |
|
typedef boost::function< void(const moveit_msgs::MotionPlanRequest &request, const planning_interface::MotionPlanDetailedResponse &response, PlannerRunData &run_data)> | PostRunEventFunction |
| Definition of a post-run benchmark event function. Invoked immediately after each planner calls solve(). More...
|
|
typedef boost::function< void(moveit_msgs::MotionPlanRequest &request)> | PreRunEventFunction |
| Definition of a pre-run benchmark event function. Invoked immediately before each planner calls solve(). More...
|
|
typedef boost::function< void(const moveit_msgs::MotionPlanRequest &request, planning_scene::PlanningScenePtr)> | QueryCompletionEventFunction |
| Definition of a query-end benchmark event function. Invoked after a query has finished benchmarking. More...
|
|
typedef boost::function< void(const moveit_msgs::MotionPlanRequest &request, planning_scene::PlanningScenePtr)> | QueryStartEventFunction |
| Definition of a query-start benchmark event function. Invoked before a new query is benchmarked. More...
|
|
virtual void | collectMetrics (PlannerRunData &metrics, const planning_interface::MotionPlanDetailedResponse &mp_res, bool solved, double total_time) |
|
void | computeAveragePathSimilarities (PlannerBenchmarkData &planner_data, const std::vector< planning_interface::MotionPlanDetailedResponse > &responses, const std::vector< bool > &solved) |
|
bool | computeTrajectoryDistance (const robot_trajectory::RobotTrajectory &traj_first, const robot_trajectory::RobotTrajectory &traj_second, double &result_distance) |
|
void | createRequestCombinations (const BenchmarkRequest &brequest, const std::vector< StartState > &start_states, const std::vector< PathConstraints > &path_constraints, std::vector< BenchmarkRequest > &combos) |
| Duplicate the given benchmark request for all combinations of start states and path constraints. More...
|
|
virtual bool | initializeBenchmarks (const BenchmarkOptions &opts, moveit_msgs::PlanningScene &scene_msg, std::vector< BenchmarkRequest > &queries) |
|
bool | loadPathConstraints (const std::string ®ex, std::vector< PathConstraints > &constraints) |
| Load all constraints matching the given regular expression from the warehouse. More...
|
|
bool | loadPlanningScene (const std::string &scene_name, moveit_msgs::PlanningScene &scene_msg) |
| Load the planning scene with the given name from the warehouse. More...
|
|
bool | loadQueries (const std::string ®ex, const std::string &scene_name, std::vector< BenchmarkRequest > &queries) |
| Load all motion plan requests matching the given regular expression from the warehouse. More...
|
|
bool | loadStates (const std::string ®ex, std::vector< StartState > &start_states) |
| Load all states matching the given regular expression from the warehouse. More...
|
|
bool | loadTrajectoryConstraints (const std::string ®ex, std::vector< TrajectoryConstraints > &constraints) |
| Load all trajectory constraints from the warehouse that match the given regular expression. More...
|
|
bool | plannerConfigurationsExist (const std::map< std::string, std::vector< std::string >> &planners, const std::string &group_name) |
| Check that the desired planner plugins and algorithms exist for the given group. More...
|
|
bool | queriesAndPlannersCompatible (const std::vector< BenchmarkRequest > &requests, const std::map< std::string, std::vector< std::string >> &planners) |
| Check that the given requests can be run on the set of planner plugins and algorithms. More...
|
|
void | runBenchmark (moveit_msgs::MotionPlanRequest request, const std::map< std::string, std::vector< std::string >> &planners, int runs) |
| Execute the given motion plan request on the set of planners for the set number of runs. More...
|
|
void | shiftConstraintsByOffset (moveit_msgs::Constraints &constraints, const std::vector< double > &offset) |
|
virtual void | writeOutput (const BenchmarkRequest &brequest, const std::string &start_time, double benchmark_duration) |
|
std::vector< PlannerBenchmarkData > | benchmark_data_ |
|
moveit_warehouse::ConstraintsStorage * | cs_ |
|
warehouse_ros::DatabaseLoader | dbloader |
|
BenchmarkOptions | options_ |
|
std::vector< PlannerCompletionEventFunction > | planner_completion_fns_ |
|
std::vector< PlannerStartEventFunction > | planner_start_fns_ |
|
std::map< std::string, planning_pipeline::PlanningPipelinePtr > | planning_pipelines_ |
|
planning_scene::PlanningScenePtr | planning_scene_ |
|
std::vector< PostRunEventFunction > | post_event_fns_ |
|
std::vector< PreRunEventFunction > | pre_event_fns_ |
|
planning_scene_monitor::PlanningSceneMonitor * | psm_ |
|
moveit_warehouse::PlanningSceneStorage * | pss_ |
|
moveit_warehouse::PlanningSceneWorldStorage * | psws_ |
|
std::vector< QueryCompletionEventFunction > | query_end_fns_ |
|
std::vector< QueryStartEventFunction > | query_start_fns_ |
|
moveit_warehouse::RobotStateStorage * | rs_ |
|
moveit_warehouse::TrajectoryConstraintsStorage * | tcs_ |
|