Skip to content

Commit 5b0a341

Browse files
authored
Merge branch 'main' into fix/voxel_grid_covariance
2 parents 30463a3 + fb43521 commit 5b0a341

File tree

45 files changed

+682
-464
lines changed

Some content is hidden

Large Commits have some content hidden by default. Use the searchbox below for content that may be hidden.

45 files changed

+682
-464
lines changed

control/autoware_control_validator/README.md

+7-6
Original file line numberDiff line numberDiff line change
@@ -57,9 +57,10 @@ The following parameters can be set for the `control_validator`:
5757

5858
The input trajectory is detected as invalid if the index exceeds the following thresholds.
5959

60-
| Name | Type | Description | Default value |
61-
| :---------------------------------- | :----- | :---------------------------------------------------------------------------------------------------------- | :------------ |
62-
| `thresholds.max_distance_deviation` | double | invalid threshold of the max distance deviation between the predicted path and the reference trajectory [m] | 1.0 |
63-
| `thresholds.rolling_back_velocity` | double | threshold velocity to valid the vehicle velocity [m/s] | 0.5 |
64-
| `thresholds.over_velocity_offset` | double | threshold velocity offset to valid the vehicle velocity [m/s] | 2.0 |
65-
| `thresholds.over_velocity_ratio` | double | threshold ratio to valid the vehicle velocity [*] | 0.2 |
60+
| Name | Type | Description | Default value |
61+
| :----------------------------------- | :----- | :---------------------------------------------------------------------------------------------------------- | :------------ |
62+
| `thresholds.max_distance_deviation` | double | invalid threshold of the max distance deviation between the predicted path and the reference trajectory [m] | 1.0 |
63+
| `thresholds.rolling_back_velocity` | double | threshold velocity to valid the vehicle velocity [m/s] | 0.5 |
64+
| `thresholds.over_velocity_offset` | double | threshold velocity offset to valid the vehicle velocity [m/s] | 2.0 |
65+
| `thresholds.over_velocity_ratio` | double | threshold ratio to valid the vehicle velocity [*] | 0.2 |
66+
| `thresholds.overrun_stop_point_dist` | double | threshold distance to overrun stop point [m] | 0.8 |

control/autoware_control_validator/config/control_validator.param.yaml

+1
Original file line numberDiff line numberDiff line change
@@ -12,6 +12,7 @@
1212
rolling_back_velocity: 0.5
1313
over_velocity_offset: 2.0
1414
over_velocity_ratio: 0.2
15+
overrun_stop_point_dist: 0.8
1516
nominal_latency: 0.01
1617

1718
vel_lpf_gain: 0.9 # Time constant 0.33

control/autoware_control_validator/include/autoware/control_validator/control_validator.hpp

+9
Original file line numberDiff line numberDiff line change
@@ -53,6 +53,7 @@ struct ValidationParams
5353
double rolling_back_velocity;
5454
double over_velocity_ratio;
5555
double over_velocity_offset;
56+
double overrun_stop_point_dist;
5657
double nominal_latency_threshold;
5758
};
5859

@@ -95,6 +96,14 @@ class ControlValidator : public rclcpp::Node
9596
void calc_velocity_deviation_status(
9697
const Trajectory & reference_trajectory, const Odometry & kinematics);
9798

99+
/**
100+
* @brief Calculate whether the vehicle has overrun a stop point in the trajectory.
101+
* @param reference_trajectory Reference trajectory
102+
* @param kinematics Current vehicle odometry including pose and twist
103+
*/
104+
void calc_stop_point_overrun_status(
105+
const Trajectory & reference_trajectory, const Odometry & kinematics);
106+
98107
private:
99108
/**
100109
* @brief Setup diagnostic updater

control/autoware_control_validator/msg/ControlValidatorStatus.msg

+3
Original file line numberDiff line numberDiff line change
@@ -4,12 +4,15 @@ builtin_interfaces/Time stamp
44
bool is_valid_max_distance_deviation
55
bool is_rolling_back
66
bool is_over_velocity
7+
bool has_overrun_stop_point
78
bool is_valid_latency
89

910
# values
1011
float64 max_distance_deviation
1112
float64 target_vel
1213
float64 vehicle_vel
14+
float64 dist_to_stop
15+
float64 nearest_trajectory_vel
1316
float64 latency
1417

1518
int64 invalid_count

control/autoware_control_validator/src/control_validator.cpp

+42-2
Original file line numberDiff line numberDiff line change
@@ -16,10 +16,12 @@
1616

1717
#include "autoware/control_validator/utils.hpp"
1818
#include "autoware/motion_utils/trajectory/interpolation.hpp"
19+
#include "autoware/motion_utils/trajectory/trajectory.hpp"
1920
#include "autoware_vehicle_info_utils/vehicle_info_utils.hpp"
2021

2122
#include <nav_msgs/msg/odometry.hpp>
2223

24+
#include <algorithm>
2325
#include <cstdint>
2426
#include <memory>
2527
#include <string>
@@ -72,6 +74,7 @@ void ControlValidator::setup_parameters()
7274
p.rolling_back_velocity = declare_parameter<double>(t + "rolling_back_velocity");
7375
p.over_velocity_offset = declare_parameter<double>(t + "over_velocity_offset");
7476
p.over_velocity_ratio = declare_parameter<double>(t + "over_velocity_ratio");
77+
p.overrun_stop_point_dist = declare_parameter<double>(t + "overrun_stop_point_dist");
7578
p.nominal_latency_threshold = declare_parameter<double>(t + "nominal_latency");
7679
}
7780
const auto lpf_gain = declare_parameter<double>("vel_lpf_gain");
@@ -129,6 +132,11 @@ void ControlValidator::setup_diag()
129132
stat, !validation_status_.is_over_velocity,
130133
"The vehicle is over-speeding against the target.");
131134
});
135+
d.add(ns + "overrun_stop_point", [&](auto & stat) {
136+
set_status(
137+
stat, !validation_status_.has_overrun_stop_point,
138+
"The vehicle has overrun the front stop point on the trajectory.");
139+
});
132140
d.add(ns + "latency", [&](auto & stat) {
133141
set_status(
134142
stat, validation_status_.is_valid_latency, "The latency is larger than expected value.");
@@ -219,12 +227,14 @@ void ControlValidator::validate(
219227
}
220228

221229
validation_status_.stamp = get_clock()->now();
230+
validation_status_.vehicle_vel = vehicle_vel_.filter(kinematics.twist.twist.linear.x);
222231

223232
std::tie(
224233
validation_status_.max_distance_deviation, validation_status_.is_valid_max_distance_deviation) =
225234
calc_lateral_deviation_status(predicted_trajectory, *current_reference_trajectory_);
226235

227236
calc_velocity_deviation_status(*current_reference_trajectory_, kinematics);
237+
calc_stop_point_overrun_status(*current_reference_trajectory_, kinematics);
228238

229239
validation_status_.invalid_count =
230240
is_all_valid(validation_status_) ? 0 : validation_status_.invalid_count + 1;
@@ -245,7 +255,6 @@ void ControlValidator::calc_velocity_deviation_status(
245255
{
246256
auto & status = validation_status_;
247257
const auto & params = validation_params_;
248-
status.vehicle_vel = vehicle_vel_.filter(kinematics.twist.twist.linear.x);
249258
status.target_vel = target_vel_.filter(
250259
autoware::motion_utils::calcInterpolatedPoint(reference_trajectory, kinematics.pose.pose)
251260
.longitudinal_velocity_mps);
@@ -268,10 +277,41 @@ void ControlValidator::calc_velocity_deviation_status(
268277
}
269278
}
270279

280+
void ControlValidator::calc_stop_point_overrun_status(
281+
const Trajectory & reference_trajectory, const Odometry & kinematics)
282+
{
283+
auto & status = validation_status_;
284+
const auto & params = validation_params_;
285+
286+
status.dist_to_stop = [](const Trajectory & traj, const geometry_msgs::msg::Pose & pose) {
287+
const auto stop_idx_opt = autoware::motion_utils::searchZeroVelocityIndex(traj.points);
288+
289+
const size_t end_idx = stop_idx_opt ? *stop_idx_opt : traj.points.size() - 1;
290+
const size_t seg_idx =
291+
autoware::motion_utils::findFirstNearestSegmentIndexWithSoftConstraints(traj.points, pose);
292+
const double signed_length_on_traj = autoware::motion_utils::calcSignedArcLength(
293+
traj.points, pose.position, seg_idx, traj.points.at(end_idx).pose.position,
294+
std::min(end_idx, traj.points.size() - 2));
295+
296+
if (std::isnan(signed_length_on_traj)) {
297+
return 0.0;
298+
}
299+
return signed_length_on_traj;
300+
}(reference_trajectory, kinematics.pose.pose);
301+
302+
status.nearest_trajectory_vel =
303+
autoware::motion_utils::calcInterpolatedPoint(reference_trajectory, kinematics.pose.pose)
304+
.longitudinal_velocity_mps;
305+
306+
// NOTE: the same velocity threshold as autoware::motion_utils::searchZeroVelocity
307+
status.has_overrun_stop_point = status.dist_to_stop < -params.overrun_stop_point_dist &&
308+
status.nearest_trajectory_vel < 1e-3 && status.vehicle_vel > 1e-3;
309+
}
310+
271311
bool ControlValidator::is_all_valid(const ControlValidatorStatus & s)
272312
{
273313
return s.is_valid_max_distance_deviation && !s.is_rolling_back && !s.is_over_velocity &&
274-
s.is_valid_latency;
314+
!s.has_overrun_stop_point;
275315
}
276316

277317
void ControlValidator::display_status()

control/autoware_mpc_lateral_controller/src/vehicle_model/vehicle_model_bicycle_kinematics.cpp

+15-10
Original file line numberDiff line numberDiff line change
@@ -76,36 +76,41 @@ MPCTrajectory KinematicsBicycleModel::calculatePredictedTrajectoryInWorldCoordin
7676
const MPCTrajectory & reference_trajectory, const double dt) const
7777
{
7878
// Calculate predicted state in world coordinate since there is modeling errors in Frenet
79-
// Relative coordinate x = [lat_err, yaw_err, steer]
80-
// World coordinate x = [x, y, yaw, steer]
79+
// Relative coordinate state = [lat_err, yaw_err, steer]
80+
// World coordinate state_w = [x, y, yaw]
81+
82+
// Note: Ideally, the first-order delay of the steering should be considered, as in the control
83+
// model. However, significant accuracy degradation was observed when discretizing with a long dt,
84+
// so it has been ignored here. If the accuracy of the discretization improves,an appropriate
85+
// model should be considered.
8186

8287
const auto & t = reference_trajectory;
8388

8489
// create initial state in the world coordinate
85-
Eigen::VectorXd state_w = [&]() {
86-
Eigen::VectorXd state = Eigen::VectorXd::Zero(3);
90+
Eigen::Vector3d state_w = [&]() {
91+
Eigen::Vector3d state = Eigen::Vector3d::Zero();
8792
const auto lateral_error_0 = x0(0);
8893
const auto yaw_error_0 = x0(1);
89-
state(0, 0) = t.x.at(0) - std::sin(t.yaw.at(0)) * lateral_error_0; // world-x
90-
state(1, 0) = t.y.at(0) + std::cos(t.yaw.at(0)) * lateral_error_0; // world-y
91-
state(2, 0) = t.yaw.at(0) + yaw_error_0; // world-yaw
94+
state(0) = t.x.at(0) - std::sin(t.yaw.at(0)) * lateral_error_0; // world-x
95+
state(1) = t.y.at(0) + std::cos(t.yaw.at(0)) * lateral_error_0; // world-y
96+
state(2) = t.yaw.at(0) + yaw_error_0; // world-yaw
9297
return state;
9398
}();
9499

95100
// update state in the world coordinate
96101
const auto updateState = [&](
97-
const Eigen::VectorXd & state_w, const double & input, const double dt,
102+
const Eigen::Vector3d & state_w, const double & input, const double dt,
98103
const double velocity) {
99104
const auto yaw = state_w(2);
100105

101-
Eigen::VectorXd dstate = Eigen::VectorXd::Zero(4);
106+
Eigen::Vector3d dstate = Eigen::Vector3d::Zero();
102107
dstate(0) = velocity * std::cos(yaw);
103108
dstate(1) = velocity * std::sin(yaw);
104109
dstate(2) = velocity * std::tan(input) / m_wheelbase;
105110

106111
// Note: don't do "return state_w + dstate * dt", which does not work due to the lazy evaluation
107112
// in Eigen.
108-
const Eigen::VectorXd next_state = state_w + dstate * dt;
113+
const Eigen::Vector3d next_state = state_w + dstate * dt;
109114
return next_state;
110115
};
111116

launch/tier4_perception_launch/launch/perception.launch.xml

+48-38
Original file line numberDiff line numberDiff line change
@@ -34,9 +34,18 @@
3434
<arg name="occupancy_grid_map_param_path"/>
3535
<arg name="occupancy_grid_map_updater"/>
3636
<arg name="occupancy_grid_map_updater_param_path"/>
37-
<arg name="traffic_light_arbiter_param_path"/>
38-
<arg name="traffic_light_multi_camera_fusion_param_path"/>
3937
<arg name="lidar_detection_model"/>
38+
<arg name="each_traffic_light_map_based_detector_param_path"/>
39+
<arg name="traffic_light_fine_detector_param_path"/>
40+
<arg name="yolox_traffic_light_detector_param_path"/>
41+
<arg name="car_traffic_light_classifier_param_path"/>
42+
<arg name="pedestrian_traffic_light_classifier_param_path"/>
43+
<arg name="traffic_light_roi_visualizer_param_path"/>
44+
<arg name="traffic_light_selector_param_path"/>
45+
<arg name="traffic_light_occlusion_predictor_param_path"/>
46+
<arg name="traffic_light_multi_camera_fusion_param_path"/>
47+
<arg name="traffic_light_arbiter_param_path"/>
48+
<arg name="crosswalk_traffic_light_estimator_param_path"/>
4049

4150
<!-- ML model parameters -->
4251
<arg name="lidar_detection_model_type" default="$(eval &quot;'$(var lidar_detection_model)'.split('/')[0]&quot;)"/>
@@ -98,31 +107,22 @@
98107
<arg name="use_obstacle_segmentation_single_frame_filter" description="use single frame filter at the ground segmentation"/>
99108
<arg name="use_obstacle_segmentation_time_series_filter" description="use time series filter at the ground segmentation"/>
100109

101-
<!-- Traffic light recognition parameters -->
102-
<arg name="use_traffic_light_recognition" default="false"/>
103-
<arg name="traffic_light_recognition/use_ml_detector" default="false" description="where ml model is used for TL detection"/>
104-
<arg name="traffic_light_recognition/ml_detection_model_type" default="fine_detection_model" description="select ml model for TL detection: fine_detection_model or whole_image_detection_model"/>
105-
<arg name="traffic_light_recognition/whole_image_detector_model_path" default="$(var data_path)/tensorrt_yolox"/>
106-
<arg name="traffic_light_recognition/whole_image_detector_model_name" default="yolox_s_car_ped_tl_detector_960_960_batch_1.onnx"/>
107-
<arg name="traffic_light_recognition/fusion_only" default="false"/>
108-
<arg name="all_traffic_light_camera" default="[camera6, camera7]" description="choose camera which use for traffic light recognition"/>
109-
<arg
110-
name="traffic_light_fine_detector_model_path"
111-
default="$(var data_path)/traffic_light_fine_detector"
112-
description="options: `tlr_yolox_s_batch_**`. The batch number must be either one of 1, 4, 6"
113-
/>
114-
<arg name="traffic_light_fine_detector_model_name" default="tlr_car_ped_yolox_s_batch_6" description="options: `tlr_car_ped_yolox_s_batch_**`. The batch number must be either one of 1, 4, 6"/>
115-
<arg name="traffic_light_classifier_model_path" default="$(var data_path)/traffic_light_classifier" description="classifier onnx model path"/>
116-
<arg
117-
name="car_traffic_light_classifier_model_name"
118-
default="traffic_light_classifier_mobilenetv2_batch_6"
119-
description="options: `traffic_light_classifier_mobilenetv2_batch_*` or `traffic_light_classifier_efficientNet_b1_batch_*`. The batch number must be either one of 1, 4, 6"
120-
/>
121-
<arg
122-
name="pedestrian_traffic_light_classifier_model_name"
123-
default="ped_traffic_light_classifier_mobilenetv2_batch_6"
124-
description="options: `ped_traffic_light_classifier_mobilenetv2_batch_*` or `ped_traffic_light_classifier_efficientNet_b1_batch_*`. The batch number must be either one of 1, 4, 6"
125-
/>
110+
<!-- traffic light recognition options to switch launch function/module -->
111+
<arg name="use_traffic_light_recognition"/>
112+
<arg name="traffic_light_recognition/fusion_only"/>
113+
<arg name="traffic_light_recognition/camera_namespaces"/>
114+
<arg name="traffic_light_recognition/use_high_accuracy_detection"/>
115+
<arg name="traffic_light_recognition/high_accuracy_detection_type"/>
116+
117+
<!-- traffic light recognition parameters -->
118+
<arg name="traffic_light_recognition/whole_image_detection/model_path"/>
119+
<arg name="traffic_light_recognition/whole_image_detection/label_path"/>
120+
<arg name="traffic_light_recognition/fine_detection/model_path"/>
121+
<arg name="traffic_light_recognition/fine_detection/label_path"/>
122+
<arg name="traffic_light_recognition/classification/car/model_path"/>
123+
<arg name="traffic_light_recognition/classification/car/label_path"/>
124+
<arg name="traffic_light_recognition/classification/pedestrian/model_path"/>
125+
<arg name="traffic_light_recognition/classification/pedestrian/label_path"/>
126126

127127
<!-- Whether to use detection by tracker -->
128128
<arg name="use_detection_by_tracker" default="true"/>
@@ -310,19 +310,29 @@
310310
<group if="$(var use_traffic_light_recognition)">
311311
<push-ros-namespace namespace="traffic_light_recognition"/>
312312
<include file="$(find-pkg-share tier4_perception_launch)/launch/traffic_light_recognition/traffic_light.launch.xml">
313-
<arg name="use_ml_detector" value="$(var traffic_light_recognition/use_ml_detector)"/>
314-
<arg name="ml_detection_model_type" value="$(var traffic_light_recognition/ml_detection_model_type)"/>
315-
<arg name="whole_image_detector_model_path" value="$(var traffic_light_recognition/whole_image_detector_model_path)"/>
316-
<arg name="whole_image_detector_model_name" value="$(var traffic_light_recognition/whole_image_detector_model_name)"/>
317313
<arg name="fusion_only" value="$(var traffic_light_recognition/fusion_only)"/>
318-
<arg name="all_camera_namespaces" value="$(var all_traffic_light_camera)"/>
319-
<arg name="traffic_light_arbiter_param_path" value="$(var traffic_light_arbiter_param_path)"/>
314+
<arg name="camera_namespaces" value="$(var traffic_light_recognition/camera_namespaces)"/>
315+
<arg name="use_high_accuracy_detection" value="$(var traffic_light_recognition/use_high_accuracy_detection)"/>
316+
<arg name="high_accuracy_detection_type" value="$(var traffic_light_recognition/high_accuracy_detection_type)"/>
317+
<arg name="each_traffic_light_map_based_detector_param_path" value="$(var each_traffic_light_map_based_detector_param_path)"/>
318+
<arg name="traffic_light_fine_detector_param_path" value="$(var traffic_light_fine_detector_param_path)"/>
319+
<arg name="yolox_traffic_light_detector_param_path" value="$(var yolox_traffic_light_detector_param_path)"/>
320+
<arg name="car_traffic_light_classifier_param_path" value="$(var car_traffic_light_classifier_param_path)"/>
321+
<arg name="pedestrian_traffic_light_classifier_param_path" value="$(var pedestrian_traffic_light_classifier_param_path)"/>
322+
<arg name="traffic_light_roi_visualizer_param_path" value="$(var traffic_light_roi_visualizer_param_path)"/>
323+
<arg name="traffic_light_selector_param_path" value="$(var traffic_light_selector_param_path)"/>
324+
<arg name="traffic_light_occlusion_predictor_param_path" value="$(var traffic_light_occlusion_predictor_param_path)"/>
320325
<arg name="traffic_light_multi_camera_fusion_param_path" value="$(var traffic_light_multi_camera_fusion_param_path)"/>
321-
<arg name="traffic_light_fine_detector_model_path" value="$(var traffic_light_fine_detector_model_path)"/>
322-
<arg name="traffic_light_fine_detector_model_name" value="$(var traffic_light_fine_detector_model_name)"/>
323-
<arg name="traffic_light_classifier_model_path" value="$(var traffic_light_classifier_model_path)"/>
324-
<arg name="car_traffic_light_classifier_model_name" value="$(var car_traffic_light_classifier_model_name)"/>
325-
<arg name="pedestrian_traffic_light_classifier_model_name" value="$(var pedestrian_traffic_light_classifier_model_name)"/>
326+
<arg name="traffic_light_arbiter_param_path" value="$(var traffic_light_arbiter_param_path)"/>
327+
<arg name="crosswalk_traffic_light_estimator_param_path" value="$(var crosswalk_traffic_light_estimator_param_path)"/>
328+
<arg name="whole_image_detection/model_path" value="$(var traffic_light_recognition/whole_image_detection/model_path)"/>
329+
<arg name="whole_image_detection/label_path" value="$(var traffic_light_recognition/whole_image_detection/label_path)"/>
330+
<arg name="fine_detection/model_path" value="$(var traffic_light_recognition/fine_detection/model_path)"/>
331+
<arg name="fine_detection/label_path" value="$(var traffic_light_recognition/fine_detection/label_path)"/>
332+
<arg name="classification/car/model_path" value="$(var traffic_light_recognition/classification/car/model_path)"/>
333+
<arg name="classification/car/label_path" value="$(var traffic_light_recognition/classification/car/label_path)"/>
334+
<arg name="classification/pedestrian/model_path" value="$(var traffic_light_recognition/classification/pedestrian/model_path)"/>
335+
<arg name="classification/pedestrian/label_path" value="$(var traffic_light_recognition/classification/pedestrian/label_path)"/>
326336
</include>
327337
</group>
328338
</group>

0 commit comments

Comments
 (0)