| addPlannerCompletionEvent(const PlannerCompletionEventFunction &func) | moveit_ros_benchmarks::BenchmarkExecutor | |
| addPlannerStartEvent(const PlannerStartEventFunction &func) | moveit_ros_benchmarks::BenchmarkExecutor | |
| addPostRunEvent(const PostRunEventFunction &func) | moveit_ros_benchmarks::BenchmarkExecutor | |
| addPreRunEvent(const PreRunEventFunction &func) | moveit_ros_benchmarks::BenchmarkExecutor | |
| addQueryCompletionEvent(const QueryCompletionEventFunction &func) | moveit_ros_benchmarks::BenchmarkExecutor | |
| addQueryStartEvent(const QueryStartEventFunction &func) | moveit_ros_benchmarks::BenchmarkExecutor | |
| benchmark_data_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| BenchmarkExecutor(const rclcpp::Node::SharedPtr &node, const std::string &robot_description_param="robot_description") | moveit_ros_benchmarks::BenchmarkExecutor | |
| clear() | moveit_ros_benchmarks::BenchmarkExecutor | virtual |
| collectMetrics(PlannerRunData &metrics, const planning_interface::MotionPlanDetailedResponse &motion_plan_response, bool solved, double total_time) | moveit_ros_benchmarks::BenchmarkExecutor | protectedvirtual |
| computeAveragePathSimilarities(PlannerBenchmarkData &planner_data, const std::vector< planning_interface::MotionPlanDetailedResponse > &responses, const std::vector< bool > &solved) | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| computeTrajectoryDistance(const robot_trajectory::RobotTrajectory &traj_first, const robot_trajectory::RobotTrajectory &traj_second, double &result_distance) | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| constraints_storage_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| createRequestCombinations(const BenchmarkRequest &benchmark_request, const std::vector< StartState > &start_states, const std::vector< PathConstraints > &path_constraints, std::vector< BenchmarkRequest > &combos) | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| db_loader_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| initialize(const std::vector< std::string > &plugin_classes) | moveit_ros_benchmarks::BenchmarkExecutor | |
| initializeBenchmarks(const BenchmarkOptions &options, moveit_msgs::msg::PlanningScene &scene_msg, std::vector< BenchmarkRequest > &queries) | moveit_ros_benchmarks::BenchmarkExecutor | protectedvirtual |
| loadBenchmarkQueryData(const BenchmarkOptions &options, moveit_msgs::msg::PlanningScene &scene_msg, std::vector< StartState > &start_states, std::vector< PathConstraints > &path_constraints, std::vector< PathConstraints > &goal_constraints, std::vector< TrajectoryConstraints > &traj_constraints, std::vector< BenchmarkRequest > &queries) | moveit_ros_benchmarks::BenchmarkExecutor | protectedvirtual |
| loadPathConstraints(const std::string ®ex, std::vector< PathConstraints > &constraints) | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| loadPlanningScene(const std::string &scene_name, moveit_msgs::msg::PlanningScene &scene_msg) | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| loadQueries(const std::string ®ex, const std::string &scene_name, std::vector< BenchmarkRequest > &queries) | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| loadStates(const std::string ®ex, std::vector< StartState > &start_states) | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| loadTrajectoryConstraints(const std::string ®ex, std::vector< TrajectoryConstraints > &constraints) | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| moveit_cpp_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| node_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| pipelinesExist(const std::map< std::string, std::vector< std::string > > &planners) | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| planner_completion_functions_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| planner_start_functions_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| PlannerBenchmarkData typedef | moveit_ros_benchmarks::BenchmarkExecutor | |
| PlannerCompletionEventFunction typedef | moveit_ros_benchmarks::BenchmarkExecutor | |
| PlannerRunData typedef | moveit_ros_benchmarks::BenchmarkExecutor | |
| PlannerStartEventFunction typedef | moveit_ros_benchmarks::BenchmarkExecutor | |
| planning_scene_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| planning_scene_monitor_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| planning_scene_storage_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| planning_scene_world_storage_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| post_event_functions_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| PostRunEventFunction typedef | moveit_ros_benchmarks::BenchmarkExecutor | |
| pre_event_functions_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| PreRunEventFunction typedef | moveit_ros_benchmarks::BenchmarkExecutor | |
| query_end_functions_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| query_start_functions_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| QueryCompletionEventFunction typedef | moveit_ros_benchmarks::BenchmarkExecutor | |
| QueryStartEventFunction typedef | moveit_ros_benchmarks::BenchmarkExecutor | |
| robot_state_storage_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| runBenchmark(moveit_msgs::msg::MotionPlanRequest request, const BenchmarkOptions &options) | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| runBenchmarks(const BenchmarkOptions &options) | moveit_ros_benchmarks::BenchmarkExecutor | virtual |
| shiftConstraintsByOffset(moveit_msgs::msg::Constraints &constraints, const std::vector< double > &offset) | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| trajectory_constraints_storage_ | moveit_ros_benchmarks::BenchmarkExecutor | protected |
| writeOutput(const BenchmarkRequest &benchmark_request, const std::string &start_time, double benchmark_duration, const BenchmarkOptions &options) | moveit_ros_benchmarks::BenchmarkExecutor | protectedvirtual |
| ~BenchmarkExecutor() | moveit_ros_benchmarks::BenchmarkExecutor | virtual |