42#include <moveit/version.hpp>
43#include <tf2_eigen/tf2_eigen.hpp>
47#include <boost/regex.hpp>
49#if __has_include(<boost/timer/progress_display.hpp>)
50#include <boost/timer/progress_display.hpp>
54#define BOOST_TIMER_ENABLE_DEPRECATED 1
55#include <boost/progress.hpp>
56#undef BOOST_TIMER_ENABLE_DEPRECATED
60#include <boost/math/constants/constants.hpp>
61#include <boost/filesystem.hpp>
62#include <boost/date_time/posix_time/posix_time.hpp>
78rclcpp::Logger getLogger()
84template <
class Clock,
class Duration>
85boost::posix_time::ptime
toBoost(
const std::chrono::time_point<Clock, Duration>& from)
87 typedef std::chrono::nanoseconds duration_t;
89 rep_t d = std::chrono::duration_cast<duration_t>(from.time_since_epoch()).count();
90 rep_t sec = d / 1000000000;
91 rep_t nsec = d % 1000000000;
92 namespace pt = boost::posix_time;
93#ifdef BOOST_DATE_TIME_HAS_NANOSECONDS
94 return pt::from_time_t(sec) + pt::nanoseconds(nsec)
96 return pt::from_time_t(sec) + pt::microseconds(nsec / 1000);
102 robot_descriptionparam) }
103 , planning_scene_storage_{ nullptr }
104 , planning_scene_world_storage_{ nullptr }
105 , robot_state_storage_{ nullptr }
106 , constraints_storage_{ nullptr }
107 , trajectory_constraints_storage_{ nullptr }
123 for (
const std::string& planning_pipeline_name : planning_pipeline_names)
125 if (
moveit_cpp_->getPlanningPipelines().find(planning_pipeline_name) ==
moveit_cpp_->getPlanningPipelines().end())
127 RCLCPP_ERROR(getLogger(),
"Cannot find pipeline '%s'", planning_pipeline_name.c_str());
131 const auto& pipeline =
moveit_cpp_->getPlanningPipelines().at(planning_pipeline_name);
135 RCLCPP_ERROR(getLogger(),
"Failed to initialize planning pipeline '%s'", planning_pipeline_name.c_str());
143 RCLCPP_ERROR(getLogger(),
"No planning pipelines have been loaded. Nothing to do for the benchmarking service.");
147 RCLCPP_INFO(getLogger(),
"Available planning pipelines:");
148 for (
const std::pair<const std::string, planning_pipeline::PlanningPipelinePtr>& entry :
151 RCLCPP_INFO_STREAM(getLogger(), entry.first);
223 RCLCPP_ERROR(getLogger(),
"No planning pipelines configured. Did you call BenchmarkExecutor::initialize?");
227 std::vector<BenchmarkRequest> queries;
228 moveit_msgs::msg::PlanningScene scene_msg;
232 for (std::size_t i = 0; i < queries.size(); ++i)
235 if (scene_msg.robot_model_name !=
planning_scene_->getRobotModel()->getName())
255 RCLCPP_INFO(getLogger(),
"Benchmarking query '%s' (%lu of %lu)", queries[i].name.c_str(), i + 1, queries.size());
256 std::chrono::system_clock::time_point start_time = std::chrono::system_clock::now();
258 std::chrono::duration<double> dt = std::chrono::system_clock::now() - start_time;
259 double duration = dt.count();
266 writeOutput(queries[i], boost::posix_time::to_iso_extended_string(
toBoost(start_time)), duration, options);
275 moveit_msgs::msg::PlanningScene& scene_msg,
276 std::vector<BenchmarkRequest>& requests)
283 std::vector<StartState> start_states;
284 std::vector<PathConstraints> path_constraints;
285 std::vector<PathConstraints> goal_constraints;
286 std::vector<TrajectoryConstraints> traj_constraints;
287 std::vector<BenchmarkRequest> queries;
289 if (!
loadBenchmarkQueryData(options, scene_msg, start_states, path_constraints, goal_constraints, traj_constraints,
292 RCLCPP_ERROR(getLogger(),
"Failed to load benchmark query data");
298 "Benchmark loaded %lu starts, %lu goals, %lu path constraints, %lu trajectory constraints, and %lu queries",
299 start_states.size(), goal_constraints.size(), path_constraints.size(), traj_constraints.size(), queries.size());
301 moveit_msgs::msg::WorkspaceParameters workspace_parameters = options.workspace;
303 if (workspace_parameters.min_corner.x == workspace_parameters.max_corner.x &&
304 workspace_parameters.min_corner.x == 0.0 &&
305 workspace_parameters.min_corner.y == workspace_parameters.max_corner.y &&
306 workspace_parameters.min_corner.y == 0.0 &&
307 workspace_parameters.min_corner.z == workspace_parameters.max_corner.z &&
308 workspace_parameters.min_corner.z == 0.0)
310 workspace_parameters.min_corner.x = workspace_parameters.min_corner.y = workspace_parameters.min_corner.z = -5.0;
312 workspace_parameters.max_corner.x = workspace_parameters.max_corner.y = workspace_parameters.max_corner.z = 5.0;
323 benchmark_request.
name = goal_constraint.name;
324 benchmark_request.
request.workspace_parameters = workspace_parameters;
325 benchmark_request.
request.goal_constraints = goal_constraint.constraints;
326 benchmark_request.
request.group_name = options.group_name;
327 benchmark_request.
request.allowed_planning_time = options.timeout;
328 benchmark_request.
request.num_planning_attempts = 1;
330 if (benchmark_request.
request.goal_constraints.size() == 1 &&
331 benchmark_request.
request.goal_constraints.at(0).position_constraints.size() == 1 &&
332 benchmark_request.
request.goal_constraints.at(0).orientation_constraints.size() == 1 &&
333 benchmark_request.
request.goal_constraints.at(0).visibility_constraints.empty() &&
334 benchmark_request.
request.goal_constraints.at(0).joint_constraints.empty())
339 std::vector<BenchmarkRequest> request_combos;
341 requests.insert(requests.end(), request_combos.begin(), request_combos.end());
350 benchmark_request.
name = query.name;
351 benchmark_request.
request = query.request;
352 benchmark_request.
request.group_name = options.group_name;
353 benchmark_request.
request.allowed_planning_time = options.timeout;
354 benchmark_request.
request.num_planning_attempts = 1;
357 if (benchmark_request.
request.workspace_parameters.min_corner.x ==
358 benchmark_request.
request.workspace_parameters.max_corner.x &&
359 benchmark_request.
request.workspace_parameters.min_corner.x == 0.0 &&
360 benchmark_request.
request.workspace_parameters.min_corner.y ==
361 benchmark_request.
request.workspace_parameters.max_corner.y &&
362 benchmark_request.
request.workspace_parameters.min_corner.y == 0.0 &&
363 benchmark_request.
request.workspace_parameters.min_corner.z ==
364 benchmark_request.
request.workspace_parameters.max_corner.z &&
365 benchmark_request.
request.workspace_parameters.min_corner.z == 0.0)
368 benchmark_request.
request.workspace_parameters = workspace_parameters;
372 std::vector<BenchmarkRequest> request_combos;
374 requests.insert(requests.end(), request_combos.begin(), request_combos.end());
382 benchmark_request.
name = traj_constraint.name;
383 benchmark_request.
request.trajectory_constraints = traj_constraint.constraints;
384 benchmark_request.
request.group_name = options.group_name;
385 benchmark_request.
request.allowed_planning_time = options.timeout;
386 benchmark_request.
request.num_planning_attempts = 1;
388 if (benchmark_request.
request.trajectory_constraints.constraints.size() == 1 &&
389 benchmark_request.
request.trajectory_constraints.constraints.at(0).position_constraints.size() == 1 &&
390 benchmark_request.
request.trajectory_constraints.constraints.at(0).orientation_constraints.size() == 1 &&
391 benchmark_request.
request.trajectory_constraints.constraints.at(0).visibility_constraints.empty() &&
392 benchmark_request.
request.trajectory_constraints.constraints.at(0).joint_constraints.empty())
397 std::vector<BenchmarkRequest> request_combos;
398 std::vector<PathConstraints> no_path_constraints;
400 requests.insert(requests.end(), request_combos.begin(), request_combos.end());
406 const BenchmarkOptions& options, moveit_msgs::msg::PlanningScene& scene_msg, std::vector<StartState>& start_states,
407 std::vector<PathConstraints>& path_constraints, std::vector<PathConstraints>& goal_constraints,
408 std::vector<TrajectoryConstraints>& traj_constraints, std::vector<BenchmarkRequest>& queries)
412 warehouse_ros::DatabaseConnection::Ptr warehouse_connection =
db_loader_.loadDatabase();
413 warehouse_connection->setParams(options.hostname, options.port, 20);
414 if (warehouse_connection->connect())
418 std::make_shared<moveit_warehouse::PlanningSceneWorldStorage>(warehouse_connection);
419 robot_state_storage_ = std::make_shared<moveit_warehouse::RobotStateStorage>(warehouse_connection);
420 constraints_storage_ = std::make_shared<moveit_warehouse::ConstraintsStorage>(warehouse_connection);
422 std::make_shared<moveit_warehouse::TrajectoryConstraintsStorage>(warehouse_connection);
423 RCLCPP_INFO(getLogger(),
"Connected to DB");
427 RCLCPP_ERROR(getLogger(),
"Failed to connect to DB");
431 catch (std::exception& e)
433 RCLCPP_ERROR(getLogger(),
"Failed to initialize benchmark server: '%s'", e.what());
439 RCLCPP_ERROR(getLogger(),
"Failed to load the planning scene");
442 if (!
loadStates(options.start_state_regex, start_states))
444 RCLCPP_ERROR(getLogger(),
"Failed to load the states");
449 RCLCPP_ERROR(getLogger(),
"Failed to load the goal constraints");
453 RCLCPP_ERROR(getLogger(),
"Failed to load the path constraints");
457 RCLCPP_ERROR(getLogger(),
"Failed to load the trajectory constraints");
459 if (!
loadQueries(options.query_regex, options.scene_name, queries))
461 RCLCPP_ERROR(getLogger(),
"Failed to get a query regex");
467 const std::vector<double>& offset)
469 Eigen::Isometry3d offset_tf(Eigen::AngleAxis<double>(offset.at(3), Eigen::Vector3d::UnitX()) *
470 Eigen::AngleAxis<double>(offset.at(4), Eigen::Vector3d::UnitY()) *
471 Eigen::AngleAxis<double>(offset.at(5), Eigen::Vector3d::UnitZ()));
472 offset_tf.translation() = Eigen::Vector3d(offset.at(0), offset.at(1), offset.at(2));
474 geometry_msgs::msg::Pose constraint_pose_msg;
475 constraint_pose_msg.position =
476 constraints.position_constraints.at(0).constraint_region.primitive_poses.at(0).position;
477 constraint_pose_msg.orientation = constraints.orientation_constraints.at(0).orientation;
478 Eigen::Isometry3d constraint_pose;
479 tf2::fromMsg(constraint_pose_msg, constraint_pose);
481 Eigen::Isometry3d new_pose = constraint_pose * offset_tf;
482 geometry_msgs::msg::Pose new_pose_msg;
483 new_pose_msg = tf2::toMsg(new_pose);
485 constraints.position_constraints.at(0).constraint_region.primitive_poses.at(0).position = new_pose_msg.position;
486 constraints.orientation_constraints.at(0).orientation = new_pose_msg.orientation;
490 const std::vector<StartState>& start_states,
491 const std::vector<PathConstraints>& path_constraints,
492 std::vector<BenchmarkRequest>& requests)
495 if (start_states.empty())
501 new_benchmark_request.
request.path_constraints = path_constraint.constraints.at(0);
502 new_benchmark_request.
name = benchmark_request.
name +
"_" + path_constraint.name;
503 requests.push_back(new_benchmark_request);
506 if (path_constraints.empty())
508 requests.push_back(benchmark_request);
513 for (
const StartState& start_state : start_states)
516 if (start_state.name == benchmark_request.
name)
520 new_benchmark_request.
request.start_state = start_state.state;
525 new_benchmark_request.
request.path_constraints = path_constraint.constraints.at(0);
526 new_benchmark_request.
name = start_state.name +
"_" + new_benchmark_request.
name +
"_" + path_constraint.name;
527 requests.push_back(new_benchmark_request);
530 if (path_constraints.empty())
532 new_benchmark_request.
name = start_state.name +
"_" + benchmark_request.
name;
533 requests.push_back(new_benchmark_request);
542 for (
const std::pair<
const std::string, std::vector<std::string>>& pipeline_config_entry : pipeline_configurations)
544 bool pipeline_exists =
false;
545 for (
const std::pair<const std::string, planning_pipeline::PlanningPipelinePtr>& pipeline_entry :
548 pipeline_exists = pipeline_entry.first == pipeline_config_entry.first;
553 if (!pipeline_exists)
555 RCLCPP_ERROR(getLogger(),
"Planning pipeline '%s' does NOT exist", pipeline_config_entry.first.c_str());
572 RCLCPP_ERROR(getLogger(),
"Failed to load planning scene '%s'", scene_name.c_str());
575 scene_msg =
static_cast<moveit_msgs::msg::PlanningScene
>(*planning_scene_w_metadata);
582 RCLCPP_ERROR(getLogger(),
"Failed to load planning scene world '%s'", scene_name.c_str());
585 scene_msg.world =
static_cast<moveit_msgs::msg::PlanningSceneWorld
>(*pswwm);
586 scene_msg.robot_model_name =
587 "NO ROBOT INFORMATION. ONLY WORLD GEOMETRY";
591 RCLCPP_ERROR(getLogger(),
"Failed to find planning scene '%s'", scene_name.c_str());
595 catch (std::exception& ex)
597 RCLCPP_ERROR(getLogger(),
"Error loading planning scene: %s", ex.what());
600 RCLCPP_INFO(getLogger(),
"Loaded planning scene successfully");
605 std::vector<BenchmarkRequest>& queries)
609 RCLCPP_WARN(getLogger(),
"No query regex provided, don't load any queries from the database");
613 std::vector<std::string> query_names;
618 catch (std::exception& ex)
620 RCLCPP_ERROR(getLogger(),
"Error loading motion planning queries: %s", ex.what());
624 if (query_names.empty())
626 RCLCPP_ERROR(getLogger(),
"Scene '%s' has no associated queries", scene_name.c_str());
630 for (
const std::string& query_name : query_names)
637 catch (std::exception& ex)
639 RCLCPP_ERROR(getLogger(),
"Error loading motion planning query '%s': %s", query_name.c_str(), ex.what());
644 query.
name = query_name;
645 query.
request =
static_cast<moveit_msgs::msg::MotionPlanRequest
>(*planning_query);
646 queries.push_back(query);
648 RCLCPP_INFO(getLogger(),
"Loaded queries successfully");
656 std::regex start_regex(regex);
657 std::vector<std::string> state_names;
660 if (state_names.empty())
662 RCLCPP_WARN(getLogger(),
"Database does not contain any named states");
665 for (
const std::string& state_name : state_names)
668 if (std::regex_match(state_name, match, start_regex))
676 start_state.
state = moveit_msgs::msg::RobotState(*robot_state);
677 start_state.
name = state_name;
678 start_states.push_back(start_state);
681 catch (std::exception& ex)
683 RCLCPP_ERROR(getLogger(),
"Runtime error when loading state '%s': %s", state_name.c_str(), ex.what());
689 if (start_states.empty())
691 RCLCPP_WARN(getLogger(),
"No stored states matched the provided start state regex: '%s'", regex.c_str());
694 RCLCPP_INFO(getLogger(),
"Loaded states successfully");
702 std::vector<std::string> cnames;
705 for (
const std::string& cname : cnames)
714 constraint.
name = cname;
715 constraints.push_back(constraint);
718 catch (std::exception& ex)
720 RCLCPP_ERROR(getLogger(),
"Runtime error when loading path constraint '%s': %s", cname.c_str(), ex.what());
725 if (constraints.empty())
727 RCLCPP_WARN(getLogger(),
"No path constraints found that match regex: '%s'", regex.c_str());
731 RCLCPP_INFO(getLogger(),
"Loaded path constraints successfully");
738 std::vector<TrajectoryConstraints>& constraints)
742 std::vector<std::string> cnames;
745 for (
const std::string& cname : cnames)
754 constraint.
name = cname;
755 constraints.push_back(constraint);
758 catch (std::exception& ex)
760 RCLCPP_ERROR(getLogger(),
"Runtime error when loading trajectory constraint '%s': %s", cname.c_str(), ex.what());
765 if (constraints.empty())
767 RCLCPP_WARN(getLogger(),
"No trajectory constraints found that match regex: '%s'", regex.c_str());
771 RCLCPP_INFO(getLogger(),
"Loaded trajectory constraints successfully");
781 auto num_planners = 0;
782 for (
const std::pair<
const std::string, std::vector<std::string>>& pipeline_entry : options.planning_pipelines)
784 num_planners += pipeline_entry.second.size();
786 num_planners += options.parallel_planning_pipelines.size();
791 auto planning_pipelines =
moveit_cpp_->getPlanningPipelines();
792 for (
const std::pair<
const std::string, std::vector<std::string>>& pipeline_entry : options.planning_pipelines)
795 for (
const std::string& planner_id : pipeline_entry.second)
800 std::vector<planning_interface::MotionPlanDetailedResponse> responses(options.runs);
801 std::vector<bool> solved(options.runs);
803 request.planner_id = planner_id;
808 planner_start_function(request, planner_data);
813 .planning_pipeline = pipeline_entry.first,
814 .planning_attempts = request.num_planning_attempts,
815 .planning_time = request.allowed_planning_time,
816 .max_velocity_scaling_factor = request.max_velocity_scaling_factor,
817 .max_acceleration_scaling_factor = request.max_acceleration_scaling_factor
821 for (
int j = 0; j < options.runs; ++j)
825 pre_event_function(request);
828 auto planning_component = std::make_shared<moveit_cpp::PlanningComponent>(request.group_name,
moveit_cpp_);
832 planning_component->setStartState(start_state);
833 planning_component->setGoal(request.goal_constraints);
834 planning_component->setPathConstraints(request.path_constraints);
835 planning_component->setTrajectoryConstraints(request.trajectory_constraints);
838 std::chrono::system_clock::time_point start = std::chrono::system_clock::now();
841 const auto response = planning_component->plan(plan_req_params,
planning_scene_);
843 solved[j] = bool(response.error_code);
845 responses[j].error_code = response.error_code;
846 if (response.trajectory)
848 responses[j].description.push_back(
"plan");
849 responses[j].trajectory.push_back(response.trajectory);
850 responses[j].processing_time.push_back(response.planning_time);
853 std::chrono::duration<double> dt = std::chrono::system_clock::now() - start;
854 double total_time = dt.count();
857 start = std::chrono::system_clock::now();
862 post_event_fn(request, responses[j], planner_data[j]);
864 collectMetrics(planner_data[j], responses[j], solved[j], total_time);
865 dt = std::chrono::system_clock::now() - start;
866 double metriconstraints_storage_time = dt.count();
867 RCLCPP_DEBUG(getLogger(),
"Spent %lf seconds collecting metrics", metriconstraints_storage_time);
877 planner_completion_fn(request, planner_data);
884 if (!options.parallel_planning_pipelines.empty())
887 for (
const std::pair<
const std::string, std::vector<std::pair<std::string, std::string>>>& parallel_pipeline_entry :
888 options.parallel_planning_pipelines)
893 std::vector<planning_interface::MotionPlanDetailedResponse> responses(options.runs);
894 std::vector<bool> solved(options.runs);
899 planner_start_function(request, planner_data);
904 for (
const auto& pipeline_planner_id_pair : parallel_pipeline_entry.second)
907 .
planner_id = pipeline_planner_id_pair.second,
908 .planning_pipeline = pipeline_planner_id_pair.first,
909 .planning_attempts = request.num_planning_attempts,
910 .planning_time = request.allowed_planning_time,
911 .max_velocity_scaling_factor = request.max_velocity_scaling_factor,
912 .max_acceleration_scaling_factor = request.max_acceleration_scaling_factor
918 for (
int j = 0; j < options.runs; ++j)
923 pre_event_function(request);
927 auto planning_component = std::make_shared<moveit_cpp::PlanningComponent>(request.group_name,
moveit_cpp_);
931 planning_component->setStartState(start_state);
932 planning_component->setGoal(request.goal_constraints);
933 planning_component->setPathConstraints(request.path_constraints);
934 planning_component->setTrajectoryConstraints(request.trajectory_constraints);
937 std::chrono::system_clock::time_point start = std::chrono::system_clock::now();
939 const auto t1 = std::chrono::system_clock::now();
940 const auto response = planning_component->plan(multi_pipeline_plan_request,
943 const auto t2 = std::chrono::system_clock::now();
945 solved[j] = bool(response.error_code);
947 responses[j].error_code = response.error_code;
948 if (response.trajectory)
950 responses[j].description.push_back(
"plan");
951 responses[j].trajectory.push_back(response.trajectory);
952 responses[j].processing_time.push_back(std::chrono::duration_cast<std::chrono::milliseconds>(t2 - t1).count());
955 std::chrono::duration<double> dt = std::chrono::system_clock::now() - start;
956 double total_time = dt.count();
959 start = std::chrono::system_clock::now();
963 post_event_fn(request, responses[j], planner_data[j]);
966 collectMetrics(planner_data[j], responses[j], solved[j], total_time);
967 dt = std::chrono::system_clock::now() - start;
968 double metriconstraints_storage_time = dt.count();
969 RCLCPP_DEBUG(getLogger(),
"Spent %lf seconds collecting metrics", metriconstraints_storage_time);
979 planner_completion_fn(request, planner_data);
989 bool solved,
double total_time)
992 metrics[
"solved BOOLEAN"] = solved ?
"true" :
"false";
997 double traj_len = 0.0;
998 double clearance = 0.0;
1001 double process_time = total_time;
1002 for (std::size_t j = 0; j < motion_plan_response.
trajectory.size(); ++j)
1030 const auto smoothness = [&]() {
1032 return s.has_value() ? s.value() : 0.0;
1035 metrics[
"path_" + motion_plan_response.
description[j] +
"_correct BOOLEAN"] = correct ?
"true" :
"false";
1039 metrics[
"path_" + motion_plan_response.
description[j] +
"_time REAL"] =
1042 if (j == motion_plan_response.
trajectory.size() - 1)
1044 metrics[
"final_path_correct BOOLEAN"] = correct ?
"true" :
"false";
1052 if (process_time <= 0.0)
1059 PlannerBenchmarkData& planner_data,
const std::vector<planning_interface::MotionPlanDetailedResponse>& responses,
1060 const std::vector<bool>& solved)
1062 RCLCPP_INFO(getLogger(),
"Computing result path similarity");
1063 const size_t result_count = planner_data.size();
1064 size_t unsolved = std::count_if(solved.begin(), solved.end(), [](
bool s) { return !s; });
1065 std::vector<double> average_distances(responses.size());
1066 for (
size_t first_traj_i = 0; first_traj_i < result_count; ++first_traj_i)
1069 if (!solved[first_traj_i])
1071 average_distances[first_traj_i] = std::numeric_limits<double>::max();
1075 for (
size_t second_traj_i = first_traj_i + 1; second_traj_i < result_count; ++second_traj_i)
1078 if (!solved[second_traj_i])
1086 double trajectory_distance;
1091 average_distances[first_traj_i] += trajectory_distance;
1092 average_distances[second_traj_i] += trajectory_distance;
1095 average_distances[first_traj_i] /= result_count - unsolved - 1;
1099 for (
size_t i = 0; i < result_count; ++i)
1105 double& result_distance)
1108 if (traj_first.
empty() || traj_second.
empty())
1112 size_t pos_first = 0;
1113 size_t pos_second = 0;
1123 double total_distance = 0;
1129 total_distance += current_distance;
1131 if (pos_first == max_pos_first && pos_second == max_pos_second)
1135 bool can_up_first = pos_first < max_pos_first;
1136 bool can_up_second = pos_second < max_pos_second;
1137 bool can_up_both = can_up_first && can_up_second;
1140 double up_both = std::numeric_limits<double>::max();
1141 double up_first = std::numeric_limits<double>::max();
1142 double up_second = std::numeric_limits<double>::max();
1151 if (can_up_both && up_both < up_first && up_both < up_second)
1155 current_distance = up_both;
1157 else if ((can_up_first && up_first < up_second) || !can_up_second)
1160 current_distance = up_first;
1162 else if (can_up_second)
1165 current_distance = up_second;
1169 result_distance = total_distance /
static_cast<double>(steps);
1177 size_t num_planners = 0;
1178 for (
const std::pair<
const std::string, std::vector<std::string>>& pipeline : options.planning_pipelines)
1180 num_planners += pipeline.second.size();
1182 num_planners += options.parallel_planning_pipelines.size();
1184 std::string hostname = [&]() {
1185 static const int BUF_SIZE = 1024;
1186 char buffer[BUF_SIZE];
1187 int err = gethostname(buffer,
sizeof(buffer));
1190 return std::string();
1194 buffer[BUF_SIZE - 1] =
'\0';
1195 return std::string(buffer);
1198 if (hostname.empty())
1200 hostname =
"UNKNOWN";
1204 std::string filename = options.output_directory;
1205 if (!filename.empty() && filename[filename.size() - 1] !=
'/')
1207 filename.append(
"/");
1211 std::filesystem::create_directories(filename);
1214 filename += (options.benchmark_name.empty() ?
"" : options.benchmark_name +
"_") + benchmark_request.
name +
"_" +
1215 hostname +
"_" + start_time +
".log";
1218 std::ofstream out(filename.c_str());
1221 RCLCPP_ERROR(getLogger(),
"Failed to open '%s' for benchmark output", filename.c_str());
1226 out <<
"MoveIt version " << MOVEIT_VERSION_STR <<
'\n';
1227 out <<
"Experiment " << benchmark_request.
name <<
'\n';
1228 out <<
"Running on " << hostname <<
'\n';
1229 out <<
"Starting at " << start_time <<
'\n';
1232 moveit_msgs::msg::PlanningScene scene_msg;
1234 out <<
"<<<|" <<
'\n';
1235 out <<
"Motion plan request:" <<
'\n'
1236 <<
" planner_id: " << benchmark_request.
request.planner_id <<
'\n'
1237 <<
" group_name: " << benchmark_request.
request.group_name <<
'\n'
1238 <<
" num_planning_attempts: " << benchmark_request.
request.num_planning_attempts <<
'\n'
1239 <<
" allowed_planning_time: " << benchmark_request.
request.allowed_planning_time <<
'\n';
1240 out <<
"Planning scene:" <<
'\n'
1241 <<
" scene_name: " << scene_msg.name <<
'\n'
1242 <<
" robot_model_name: " << scene_msg.robot_model_name <<
'\n'
1246 out <<
"0 is the random seed" <<
'\n';
1247 out << benchmark_request.
request.allowed_planning_time <<
" seconds per run" <<
'\n';
1249 out <<
"-1 MB per run" <<
'\n';
1250 out << options.runs <<
" runs per planner" <<
'\n';
1251 out << benchmark_duration <<
" seconds spent to collect the data" <<
'\n';
1254 out <<
"0 enum types" <<
'\n';
1256 out << num_planners <<
" planners" <<
'\n';
1262 for (
const std::pair<
const std::string, std::vector<std::string>>& pipeline : options.planning_pipelines)
1264 for (std::size_t i = 0; i < pipeline.second.size(); ++i, ++run_id)
1267 out << pipeline.second[i] <<
" (" << pipeline.first <<
')' <<
'\n';
1271 out <<
"0 common properties" <<
'\n';
1274 std::set<std::string> properties_set;
1277 for (PlannerRunData::const_iterator pit = planner_run_data.begin(); pit != planner_run_data.end();
1279 properties_set.insert(pit->first);
1283 out << properties_set.size() <<
" properties for each run" <<
'\n';
1284 for (
const std::string& property : properties_set)
1285 out << property <<
'\n';
1294 for (
const std::string& property : properties_set)
1297 PlannerRunData::const_iterator runit = planner_run_data.find(property);
1298 if (runit != planner_run_data.end())
1299 out << runit->second;
1309 for (
const std::pair<
const std::string, std::vector<std::pair<std::string, std::string>>>& parallel_pipeline :
1310 options.parallel_planning_pipelines)
1313 out << parallel_pipeline.first <<
" (" << parallel_pipeline.first <<
")" <<
'\n';
1317 out <<
"0 common properties" <<
'\n';
1320 std::set<std::string> properties_set;
1324 for (PlannerRunData::const_iterator pit = planner_run_data.begin(); pit != planner_run_data.end(); ++pit)
1326 properties_set.insert(pit->first);
1331 out << properties_set.size() <<
" properties for each run" <<
'\n';
1332 for (
const std::string& property : properties_set)
1333 out << property <<
'\n';
1342 for (
const std::string& property : properties_set)
1345 PlannerRunData::const_iterator runit = planner_run_data.find(property);
1346 if (runit != planner_run_data.end())
1347 out << runit->second;
1359 RCLCPP_INFO(getLogger(),
"Benchmark results saved to '%s'", filename.c_str());
boost::progress_display boost_progress_display
boost::posix_time::ptime toBoost(const std::chrono::time_point< Clock, Duration > &from)
Representation of a robot's state. This includes position, velocity, acceleration and effort.
double distance(const RobotState &other) const
Return the sum of joint distances to "other" state. An L1 norm. Only considers active joints.
bool satisfiesBounds(double margin=0.0) const
bool loadPlanningScene(const std::string &scene_name, moveit_msgs::msg::PlanningScene &scene_msg)
Load the planning scene with the given name from the warehouse.
void computeAveragePathSimilarities(PlannerBenchmarkData &planner_data, const std::vector< planning_interface::MotionPlanDetailedResponse > &responses, const std::vector< bool > &solved)
bool pipelinesExist(const std::map< std::string, std::vector< std::string > > &planners)
Check that the desired planning pipelines exist.
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.
void createRequestCombinations(const BenchmarkRequest &benchmark_request, 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.
std::vector< PlannerRunData > PlannerBenchmarkData
Structure to hold information for a single planner's benchmark data.
rclcpp::Node::SharedPtr node_
planning_scene::PlanningScenePtr planning_scene_
std::vector< PlannerStartEventFunction > planner_start_functions_
warehouse_ros::DatabaseLoader db_loader_
bool computeTrajectoryDistance(const robot_trajectory::RobotTrajectory &traj_first, const robot_trajectory::RobotTrajectory &traj_second, double &result_distance)
void addQueryStartEvent(const QueryStartEventFunction &func)
std::shared_ptr< moveit_warehouse::ConstraintsStorage > constraints_storage_
std::shared_ptr< moveit_warehouse::PlanningSceneStorage > planning_scene_storage_
std::function< void(const moveit_msgs::msg::MotionPlanRequest &request, PlannerBenchmarkData &benchmark_data)> PlannerCompletionEventFunction
std::vector< QueryCompletionEventFunction > query_end_functions_
std::shared_ptr< moveit_warehouse::TrajectoryConstraintsStorage > trajectory_constraints_storage_
std::function< void(const moveit_msgs::msg::MotionPlanRequest &request, planning_scene::PlanningScenePtr)> QueryCompletionEventFunction
Definition of a query-end benchmark event function. Invoked after a query has finished benchmarking.
std::shared_ptr< moveit_cpp::MoveItCpp > moveit_cpp_
virtual void collectMetrics(PlannerRunData &metrics, const planning_interface::MotionPlanDetailedResponse &motion_plan_response, bool solved, double total_time)
std::vector< QueryStartEventFunction > query_start_functions_
bool loadPathConstraints(const std::string ®ex, std::vector< PathConstraints > &constraints)
Load all constraints matching the given regular expression from the warehouse.
std::vector< PreRunEventFunction > pre_event_functions_
void runBenchmark(moveit_msgs::msg::MotionPlanRequest request, const BenchmarkOptions &options)
Execute the given motion plan request on the set of planners for the set number of runs.
void addPreRunEvent(const PreRunEventFunction &func)
BenchmarkExecutor(const rclcpp::Node::SharedPtr &node, const std::string &robot_description_param="robot_description")
virtual bool runBenchmarks(const BenchmarkOptions &options)
std::vector< PlannerBenchmarkData > benchmark_data_
virtual bool 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)
Initialize benchmark query data from start states and constraints.
std::vector< PostRunEventFunction > post_event_functions_
virtual bool initializeBenchmarks(const BenchmarkOptions &options, moveit_msgs::msg::PlanningScene &scene_msg, std::vector< BenchmarkRequest > &queries)
void addPlannerCompletionEvent(const PlannerCompletionEventFunction &func)
std::shared_ptr< planning_scene_monitor::PlanningSceneMonitor > planning_scene_monitor_
void addPlannerStartEvent(const PlannerStartEventFunction &func)
void addQueryCompletionEvent(const QueryCompletionEventFunction &func)
bool loadStates(const std::string ®ex, std::vector< StartState > &start_states)
Load all states matching the given regular expression from the warehouse.
std::function< void(const moveit_msgs::msg::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...
std::function< void(moveit_msgs::msg::MotionPlanRequest &request)> PreRunEventFunction
Definition of a pre-run benchmark event function. Invoked immediately before each planner calls solve...
std::vector< PlannerCompletionEventFunction > planner_completion_functions_
std::shared_ptr< moveit_warehouse::RobotStateStorage > robot_state_storage_
virtual ~BenchmarkExecutor()
std::function< void(const moveit_msgs::msg::MotionPlanRequest &request, planning_scene::PlanningScenePtr)> QueryStartEventFunction
Definition of a query-start benchmark event function. Invoked before a new query is benchmarked.
virtual void writeOutput(const BenchmarkRequest &benchmark_request, const std::string &start_time, double benchmark_duration, const BenchmarkOptions &options)
bool initialize(const std::vector< std::string > &plugin_classes)
std::shared_ptr< moveit_warehouse::PlanningSceneWorldStorage > planning_scene_world_storage_
std::function< void(const moveit_msgs::msg::MotionPlanRequest &request, PlannerBenchmarkData &benchmark_data)> PlannerStartEventFunction
bool loadTrajectoryConstraints(const std::string ®ex, std::vector< TrajectoryConstraints > &constraints)
Load all trajectory constraints from the warehouse that match the given regular expression.
void addPostRunEvent(const PostRunEventFunction &func)
void shiftConstraintsByOffset(moveit_msgs::msg::Constraints &constraints, const std::vector< double > &offset)
std::map< std::string, std::string > PlannerRunData
Structure to hold information for a single run of a planner.
Maintain a sequence of waypoints and the time durations between these waypoints.
std::size_t getWayPointCount() const
const moveit::core::RobotState & getWayPoint(std::size_t index) const
std::string toString(double d)
Convert a double to std::string using the classic C locale.
bool robotStateMsgToRobotState(const Transforms &tf, const moveit_msgs::msg::RobotState &robot_state, RobotState &state, bool copy_attached_bodies=true)
Convert a robot state msg (with accompanying extra transforms) to a MoveIt robot state.
::planning_interface::MotionPlanResponse getShortestSolution(const std::vector<::planning_interface::MotionPlanResponse > &solutions)
Function that returns the shortest solution out of a vector of solutions based on robot_trajectory::p...
warehouse_ros::MessageWithMetadata< moveit_msgs::msg::RobotState >::ConstPtr RobotStateWithMetadata
warehouse_ros::MessageWithMetadata< moveit_msgs::msg::PlanningScene >::ConstPtr PlanningSceneWithMetadata
warehouse_ros::MessageWithMetadata< moveit_msgs::msg::TrajectoryConstraints >::ConstPtr TrajectoryConstraintsWithMetadata
warehouse_ros::MessageWithMetadata< moveit_msgs::msg::PlanningSceneWorld >::ConstPtr PlanningSceneWorldWithMetadata
warehouse_ros::MessageWithMetadata< moveit_msgs::msg::MotionPlanRequest >::ConstPtr MotionPlanRequestWithMetadata
warehouse_ros::MessageWithMetadata< moveit_msgs::msg::Constraints >::ConstPtr ConstraintsWithMetadata
rclcpp::Logger getLogger(const std::string &name)
Creates a namespaced logger.
std::optional< double > smoothness(const RobotTrajectory &trajectory)
Calculate the smoothness of a given trajectory.
double pathLength(const RobotTrajectory &trajectory)
Calculate the path length of a given trajectory based on the accumulated robot state distances....
Representation of a collision checking request.
bool pad_environment_collisions
If true, use padded collision environment.
Representation of a collision checking result.
bool collision
True if collision was found, false otherwise.
Planner parameters provided with the MotionPlanRequest.
std::vector< PlanRequestParameters > plan_request_parameter_vector
Planner parameters provided with the MotionPlanRequest.
moveit_msgs::msg::MotionPlanRequest request
std::vector< moveit_msgs::msg::Constraints > constraints
moveit_msgs::msg::RobotState state
moveit_msgs::msg::TrajectoryConstraints constraints
Options to configure a benchmark experiment. The configuration is provided via ROS2 parameters.
std::vector< std::string > description
std::vector< double > processing_time
std::vector< robot_trajectory::RobotTrajectoryPtr > trajectory