|
15 | 15 | #define BEHAVIOR_PATH_PLANNER__UTILS__LANE_CHANGE__LANE_CHANGE_MODULE_DATA_HPP_
|
16 | 16 |
|
17 | 17 | #include "behavior_path_planner/utils/avoidance/avoidance_module_data.hpp"
|
| 18 | +#include "behavior_path_planner/utils/safety_check.hpp" |
18 | 19 | #include "lanelet2_core/geometry/Lanelet.h"
|
19 | 20 |
|
20 | 21 | #include "autoware_auto_planning_msgs/msg/path_point_with_lane_id.hpp"
|
|
28 | 29 | namespace behavior_path_planner
|
29 | 30 | {
|
30 | 31 |
|
31 |
| -struct PoseWithVelocity |
32 |
| -{ |
33 |
| - Pose pose; |
34 |
| - double velocity; |
35 |
| - |
36 |
| - PoseWithVelocity(const Pose & pose, const double velocity) : pose(pose), velocity(velocity) {} |
37 |
| -}; |
38 |
| - |
39 |
| -struct PoseWithVelocityStamped : public PoseWithVelocity |
40 |
| -{ |
41 |
| - double time; |
42 |
| - |
43 |
| - PoseWithVelocityStamped(const double time, const Pose & pose, const double velocity) |
44 |
| - : PoseWithVelocity(pose, velocity), time(time) |
45 |
| - { |
46 |
| - } |
47 |
| -}; |
48 |
| - |
49 |
| -struct PoseWithVelocityAndPolygonStamped : public PoseWithVelocityStamped |
50 |
| -{ |
51 |
| - Polygon2d poly; |
52 |
| - |
53 |
| - PoseWithVelocityAndPolygonStamped( |
54 |
| - const double time, const Pose & pose, const double velocity, const Polygon2d & poly) |
55 |
| - : PoseWithVelocityStamped(time, pose, velocity), poly(poly) |
56 |
| - { |
57 |
| - } |
58 |
| -}; |
59 |
| - |
60 |
| -struct PredictedPathWithPolygon |
61 |
| -{ |
62 |
| - float confidence; |
63 |
| - std::vector<PoseWithVelocityAndPolygonStamped> path; |
64 |
| -}; |
65 |
| - |
66 |
| -struct ExtendedPredictedObject |
67 |
| -{ |
68 |
| - unique_identifier_msgs::msg::UUID uuid; |
69 |
| - geometry_msgs::msg::PoseWithCovariance initial_pose; |
70 |
| - geometry_msgs::msg::TwistWithCovariance initial_twist; |
71 |
| - geometry_msgs::msg::AccelWithCovariance initial_acceleration; |
72 |
| - autoware_auto_perception_msgs::msg::Shape shape; |
73 |
| - std::vector<PredictedPathWithPolygon> predicted_paths; |
74 |
| -}; |
75 |
| - |
76 | 32 | struct LaneChangeCancelParameters
|
77 | 33 | {
|
78 | 34 | bool enable_on_prepare_phase{true};
|
@@ -176,9 +132,9 @@ struct LaneChangeTargetObjectIndices
|
176 | 132 |
|
177 | 133 | struct LaneChangeTargetObjects
|
178 | 134 | {
|
179 |
| - std::vector<ExtendedPredictedObject> current_lane{}; |
180 |
| - std::vector<ExtendedPredictedObject> target_lane{}; |
181 |
| - std::vector<ExtendedPredictedObject> other_lane{}; |
| 135 | + std::vector<utils::safety_check::ExtendedPredictedObject> current_lane{}; |
| 136 | + std::vector<utils::safety_check::ExtendedPredictedObject> target_lane{}; |
| 137 | + std::vector<utils::safety_check::ExtendedPredictedObject> other_lane{}; |
182 | 138 | };
|
183 | 139 |
|
184 | 140 | enum class LaneChangeModuleType {
|
|
0 commit comments