From e5f660a1fb6dfc3674e45b53c0ef71f134249424 Mon Sep 17 00:00:00 2001 From: Ioannis Souflas Date: Thu, 11 Jan 2024 13:51:17 +0000 Subject: [PATCH 1/2] feat(obstacle_cruise_planner): add calculation of obstacle distance to ego Add the arc length from the ego to the obstacle stop point to the stop_reasons topic. Signed-off-by: Ioannis Souflas --- .../obstacle_cruise_planner/src/planner_interface.cpp | 8 +++++--- 1 file changed, 5 insertions(+), 3 deletions(-) diff --git a/planning/obstacle_cruise_planner/src/planner_interface.cpp b/planning/obstacle_cruise_planner/src/planner_interface.cpp index f00ad01efb0d9..f7ce218cf3ccf 100644 --- a/planning/obstacle_cruise_planner/src/planner_interface.cpp +++ b/planning/obstacle_cruise_planner/src/planner_interface.cpp @@ -37,19 +37,21 @@ StopSpeedExceeded createStopSpeedExceededMsg( } tier4_planning_msgs::msg::StopReasonArray makeStopReasonArray( - const rclcpp::Time & current_time, const geometry_msgs::msg::Pose & stop_pose, + const PlannerData & planner_data, const geometry_msgs::msg::Pose & stop_pose, const StopObstacle & stop_obstacle) { // create header std_msgs::msg::Header header; header.frame_id = "map"; - header.stamp = current_time; + header.stamp = planner_data.current_time; // create stop factor StopFactor stop_factor; stop_factor.stop_pose = stop_pose; geometry_msgs::msg::Point stop_factor_point = stop_obstacle.collision_point; stop_factor_point.z = stop_pose.position.z; + stop_factor.dist_to_stop_pose = motion_utils::calcSignedArcLength( + planner_data.traj_points, planner_data.ego_pose.position, stop_pose.position); stop_factor.stop_factor_points.emplace_back(stop_factor_point); // create stop reason stamped @@ -359,7 +361,7 @@ std::vector PlannerInterface::generateStopTrajectory( // Publish Stop Reason const auto stop_pose = output_traj_points.at(*zero_vel_idx).pose; const auto stop_reasons_msg = - makeStopReasonArray(planner_data.current_time, stop_pose, *closest_stop_obstacle); + makeStopReasonArray(planner_data, stop_pose, *closest_stop_obstacle); stop_reasons_pub_->publish(stop_reasons_msg); velocity_factors_pub_->publish(makeVelocityFactorArray(planner_data.current_time, stop_pose)); From 2bc2ec8c65f8727295e22fcb0848f1fd6fe6bee3 Mon Sep 17 00:00:00 2001 From: Ioannis Souflas Date: Sun, 25 Feb 2024 22:58:47 +0200 Subject: [PATCH 2/2] fix(tensorrt_yolox): renamed input output topic names The input and output argument names of yolox.launch.xml do not match the input and output arguments names of multiple_yolox.launch.xml. Signed-off-by: Ioannis Souflas --- .../launch/multiple_yolox.launch.xml | 32 +++++++++---------- 1 file changed, 16 insertions(+), 16 deletions(-) diff --git a/perception/tensorrt_yolox/launch/multiple_yolox.launch.xml b/perception/tensorrt_yolox/launch/multiple_yolox.launch.xml index 5959f73757de1..9de37c76e034b 100644 --- a/perception/tensorrt_yolox/launch/multiple_yolox.launch.xml +++ b/perception/tensorrt_yolox/launch/multiple_yolox.launch.xml @@ -27,43 +27,43 @@ - - + + - - + + - - + + - - + + - - + + - - + + - - + + - - + +