File tree 21 files changed +81
-71
lines changed
planning/autoware_obstacle_cruise_planner
optimization_based_planner
21 files changed +81
-71
lines changed Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__COMMON_STRUCTS_HPP_
16
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__COMMON_STRUCTS_HPP_
15
+ #ifndef COMMON_STRUCTS_HPP_
16
+ #define COMMON_STRUCTS_HPP_
17
17
18
- #include " autoware_obstacle_cruise_planner/type_alias.hpp"
19
18
#include " motion_utils/trajectory/conversion.hpp"
20
19
#include " motion_utils/trajectory/interpolation.hpp"
21
20
#include " motion_utils/trajectory/trajectory.hpp"
22
21
#include " tier4_autoware_utils/geometry/boost_polygon_utils.hpp"
23
22
#include " tier4_autoware_utils/ros/update_param.hpp"
24
23
#include " tier4_autoware_utils/ros/uuid_helper.hpp"
24
+ #include " type_alias.hpp"
25
25
26
26
#include < rclcpp/rclcpp.hpp>
27
27
@@ -302,4 +302,4 @@ struct EgoNearestParam
302
302
double yaw_threshold;
303
303
};
304
304
305
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__COMMON_STRUCTS_HPP_
305
+ #endif // COMMON_STRUCTS_HPP_
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #include " autoware_obstacle_cruise_planner/ node.hpp"
15
+ #include " node.hpp"
16
16
17
- #include " autoware_obstacle_cruise_planner/polygon_utils.hpp"
18
- #include " autoware_obstacle_cruise_planner/utils.hpp"
19
17
#include " motion_utils/resample/resample.hpp"
20
18
#include " motion_utils/trajectory/conversion.hpp"
21
19
#include " object_recognition_utils/predicted_path_utils.hpp"
20
+ #include " polygon_utils.hpp"
22
21
#include " tier4_autoware_utils/geometry/boost_polygon_utils.hpp"
23
22
#include " tier4_autoware_utils/ros/marker_helper.hpp"
24
23
#include " tier4_autoware_utils/ros/update_param.hpp"
24
+ #include " utils.hpp"
25
25
26
26
#include < boost/format.hpp>
27
27
28
28
#include < algorithm>
29
29
#include < chrono>
30
+ #include < limits>
31
+ #include < utility>
30
32
31
33
namespace
32
34
{
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__NODE_HPP_
16
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__NODE_HPP_
15
+ #ifndef NODE_HPP_
16
+ #define NODE_HPP_
17
17
18
- #include " autoware_obstacle_cruise_planner/common_structs.hpp"
19
- #include " autoware_obstacle_cruise_planner/optimization_based_planner/optimization_based_planner.hpp"
20
- #include " autoware_obstacle_cruise_planner/pid_based_planner/pid_based_planner.hpp"
21
- #include " autoware_obstacle_cruise_planner/type_alias.hpp"
18
+ #include " common_structs.hpp"
19
+ #include " optimization_based_planner/optimization_based_planner.hpp"
20
+ #include " pid_based_planner/pid_based_planner.hpp"
22
21
#include " signal_processing/lowpass_filter_1d.hpp"
23
22
#include " tier4_autoware_utils/ros/logger_level_configure.hpp"
24
23
#include " tier4_autoware_utils/ros/polling_subscriber.hpp"
25
24
#include " tier4_autoware_utils/system/stop_watch.hpp"
25
+ #include " type_alias.hpp"
26
26
27
27
#include < rclcpp/rclcpp.hpp>
28
28
#include < tier4_autoware_utils/ros/published_time_publisher.hpp>
@@ -280,4 +280,4 @@ class ObstacleCruisePlannerNode : public rclcpp::Node
280
280
};
281
281
} // namespace autoware::motion_planning
282
282
283
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__NODE_HPP_
283
+ #endif // NODE_HPP_
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #include " autoware_obstacle_cruise_planner/ optimization_based_planner/optimization_based_planner.hpp"
15
+ #include " optimization_based_planner/optimization_based_planner.hpp"
16
16
17
- #include " autoware_obstacle_cruise_planner/utils.hpp"
18
17
#include " interpolation/linear_interpolation.hpp"
19
18
#include " interpolation/spline_interpolation.hpp"
20
19
#include " interpolation/zero_order_hold.hpp"
24
23
#include " motion_utils/trajectory/trajectory.hpp"
25
24
#include " tier4_autoware_utils/geometry/geometry.hpp"
26
25
#include " tier4_autoware_utils/ros/marker_helper.hpp"
26
+ #include " utils.hpp"
27
27
28
28
#ifdef ROS_DISTRO_GALACTIC
29
29
#include < tf2_geometry_msgs/tf2_geometry_msgs.h>
33
33
34
34
#include < tf2/utils.h>
35
35
36
+ #include < algorithm>
37
+ #include < limits>
38
+
36
39
constexpr double ZERO_VEL_THRESHOLD = 0.01 ;
37
40
constexpr double CLOSE_S_DIST_THRESHOLD = 1e-3 ;
38
41
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__OPTIMIZATION_BASED_PLANNER__OPTIMIZATION_BASED_PLANNER_HPP_ // NOLINT
16
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__OPTIMIZATION_BASED_PLANNER__OPTIMIZATION_BASED_PLANNER_HPP_ // NOLINT
15
+ #ifndef OPTIMIZATION_BASED_PLANNER__OPTIMIZATION_BASED_PLANNER_HPP_ // NOLINT
16
+ #define OPTIMIZATION_BASED_PLANNER__OPTIMIZATION_BASED_PLANNER_HPP_ // NOLINT
17
17
18
- #include " autoware_obstacle_cruise_planner/optimization_based_planner/s_boundary.hpp"
19
- #include " autoware_obstacle_cruise_planner/optimization_based_planner/velocity_optimizer.hpp"
20
- #include " autoware_obstacle_cruise_planner/planner_interface.hpp"
21
- #include " autoware_obstacle_cruise_planner/type_alias.hpp"
22
18
#include " autoware_vehicle_info_utils/vehicle_info_utils.hpp"
19
+ #include " optimization_based_planner/s_boundary.hpp"
20
+ #include " optimization_based_planner/velocity_optimizer.hpp"
21
+ #include " planner_interface.hpp"
22
+ #include " type_alias.hpp"
23
23
24
24
#include < lanelet2_extension/utility/message_conversion.hpp>
25
25
#include < lanelet2_extension/utility/utilities.hpp>
@@ -118,5 +118,5 @@ class OptimizationBasedPlanner : public PlannerInterface
118
118
double stop_dist_to_prohibit_engage_;
119
119
};
120
120
// clang-format off
121
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__OPTIMIZATION_BASED_PLANNER__OPTIMIZATION_BASED_PLANNER_HPP_ // NOLINT
121
+ #endif // OPTIMIZATION_BASED_PLANNER__OPTIMIZATION_BASED_PLANNER_HPP_ // NOLINT
122
122
// clang-format on
Original file line number Diff line number Diff line change 11
11
// WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__OPTIMIZATION_BASED_PLANNER__S_BOUNDARY_HPP_
15
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__OPTIMIZATION_BASED_PLANNER__S_BOUNDARY_HPP_
14
+ #ifndef OPTIMIZATION_BASED_PLANNER__S_BOUNDARY_HPP_
15
+ #define OPTIMIZATION_BASED_PLANNER__S_BOUNDARY_HPP_
16
16
17
17
#include < limits>
18
18
#include < vector>
@@ -30,4 +30,4 @@ class SBoundary
30
30
31
31
using SBoundaries = std::vector<SBoundary>;
32
32
33
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__OPTIMIZATION_BASED_PLANNER__S_BOUNDARY_HPP_
33
+ #endif // OPTIMIZATION_BASED_PLANNER__S_BOUNDARY_HPP_
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #include " autoware_obstacle_cruise_planner/ optimization_based_planner/velocity_optimizer.hpp"
15
+ #include " optimization_based_planner/velocity_optimizer.hpp"
16
16
17
17
#include < Eigen/Core>
18
18
19
+ #include < algorithm>
19
20
#include < iostream>
20
21
21
22
VelocityOptimizer::VelocityOptimizer (
Original file line number Diff line number Diff line change 11
11
// WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__OPTIMIZATION_BASED_PLANNER__VELOCITY_OPTIMIZER_HPP_
15
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__OPTIMIZATION_BASED_PLANNER__VELOCITY_OPTIMIZER_HPP_
14
+ #ifndef OPTIMIZATION_BASED_PLANNER__VELOCITY_OPTIMIZER_HPP_
15
+ #define OPTIMIZATION_BASED_PLANNER__VELOCITY_OPTIMIZER_HPP_
16
16
17
- #include " autoware_obstacle_cruise_planner/ optimization_based_planner/s_boundary.hpp"
17
+ #include " optimization_based_planner/s_boundary.hpp"
18
18
#include " osqp_interface/osqp_interface.hpp"
19
19
20
20
#include < vector>
@@ -72,4 +72,4 @@ class VelocityOptimizer
72
72
autoware::common::osqp::OSQPInterface qp_solver_;
73
73
};
74
74
75
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__OPTIMIZATION_BASED_PLANNER__VELOCITY_OPTIMIZER_HPP_
75
+ #endif // OPTIMIZATION_BASED_PLANNER__VELOCITY_OPTIMIZER_HPP_
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__PID_BASED_PLANNER__CRUISE_PLANNING_DEBUG_INFO_HPP_
16
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__PID_BASED_PLANNER__CRUISE_PLANNING_DEBUG_INFO_HPP_
15
+ #ifndef PID_BASED_PLANNER__CRUISE_PLANNING_DEBUG_INFO_HPP_
16
+ #define PID_BASED_PLANNER__CRUISE_PLANNING_DEBUG_INFO_HPP_
17
17
18
18
#include < rclcpp/rclcpp.hpp>
19
19
@@ -94,4 +94,4 @@ class CruisePlanningDebugInfo
94
94
std::array<double , static_cast <int >(TYPE::SIZE)> info_;
95
95
};
96
96
97
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__PID_BASED_PLANNER__CRUISE_PLANNING_DEBUG_INFO_HPP_
97
+ #endif // PID_BASED_PLANNER__CRUISE_PLANNING_DEBUG_INFO_HPP_
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #include " autoware_obstacle_cruise_planner/ pid_based_planner/pid_based_planner.hpp"
15
+ #include " pid_based_planner/pid_based_planner.hpp"
16
16
17
- #include " autoware_obstacle_cruise_planner/utils.hpp"
18
17
#include " interpolation/spline_interpolation.hpp"
19
18
#include " motion_utils/marker/marker_helper.hpp"
20
19
#include " tier4_autoware_utils/geometry/geometry.hpp"
21
20
#include " tier4_autoware_utils/ros/marker_helper.hpp"
22
21
#include " tier4_autoware_utils/ros/update_param.hpp"
22
+ #include " utils.hpp"
23
23
24
24
#include " tier4_planning_msgs/msg/velocity_limit.hpp"
25
25
26
+ #include < algorithm>
27
+ #include < string>
26
28
namespace
27
29
{
28
30
VelocityLimit createVelocityLimitMsg (
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__PID_BASED_PLANNER__PID_BASED_PLANNER_HPP_
16
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__PID_BASED_PLANNER__PID_BASED_PLANNER_HPP_
15
+ #ifndef PID_BASED_PLANNER__PID_BASED_PLANNER_HPP_
16
+ #define PID_BASED_PLANNER__PID_BASED_PLANNER_HPP_
17
17
18
- #include " autoware_obstacle_cruise_planner/ pid_based_planner/cruise_planning_debug_info.hpp"
19
- #include " autoware_obstacle_cruise_planner/ pid_based_planner/pid_controller.hpp"
20
- #include " autoware_obstacle_cruise_planner/ planner_interface.hpp"
18
+ #include " pid_based_planner/cruise_planning_debug_info.hpp"
19
+ #include " pid_based_planner/pid_controller.hpp"
20
+ #include " planner_interface.hpp"
21
21
#include " signal_processing/lowpass_filter_1d.hpp"
22
22
23
23
#include " visualization_msgs/msg/marker_array.hpp"
@@ -137,4 +137,4 @@ class PIDBasedPlanner : public PlannerInterface
137
137
std::function<double (double )> error_func_;
138
138
};
139
139
140
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__PID_BASED_PLANNER__PID_BASED_PLANNER_HPP_
140
+ #endif // PID_BASED_PLANNER__PID_BASED_PLANNER_HPP_
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__PID_BASED_PLANNER__PID_CONTROLLER_HPP_
16
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__PID_BASED_PLANNER__PID_CONTROLLER_HPP_
15
+ #ifndef PID_BASED_PLANNER__PID_CONTROLLER_HPP_
16
+ #define PID_BASED_PLANNER__PID_CONTROLLER_HPP_
17
17
18
18
#include < optional>
19
19
@@ -59,4 +59,4 @@ class PIDController
59
59
std::optional<double > prev_error_;
60
60
};
61
61
62
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__PID_BASED_PLANNER__PID_CONTROLLER_HPP_
62
+ #endif // PID_BASED_PLANNER__PID_CONTROLLER_HPP_
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #include " autoware_obstacle_cruise_planner/ planner_interface.hpp"
15
+ #include " planner_interface.hpp"
16
16
17
17
#include " motion_utils/distance/distance.hpp"
18
18
#include " motion_utils/marker/marker_helper.hpp"
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__PLANNER_INTERFACE_HPP_
16
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__PLANNER_INTERFACE_HPP_
15
+ #ifndef PLANNER_INTERFACE_HPP_
16
+ #define PLANNER_INTERFACE_HPP_
17
17
18
- #include " autoware_obstacle_cruise_planner/common_structs.hpp"
19
- #include " autoware_obstacle_cruise_planner/stop_planning_debug_info.hpp"
20
- #include " autoware_obstacle_cruise_planner/type_alias.hpp"
21
- #include " autoware_obstacle_cruise_planner/utils.hpp"
18
+ #include " common_structs.hpp"
22
19
#include " motion_utils/trajectory/trajectory.hpp"
20
+ #include " stop_planning_debug_info.hpp"
23
21
#include " tier4_autoware_utils/ros/update_param.hpp"
24
22
#include " tier4_autoware_utils/system/stop_watch.hpp"
23
+ #include " type_alias.hpp"
24
+ #include " utils.hpp"
25
25
26
26
#include < algorithm>
27
27
#include < limits>
@@ -425,4 +425,4 @@ class PlannerInterface
425
425
std::nullopt};
426
426
};
427
427
428
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__PLANNER_INTERFACE_HPP_
428
+ #endif // PLANNER_INTERFACE_HPP_
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #include " autoware_obstacle_cruise_planner/ polygon_utils.hpp"
15
+ #include " polygon_utils.hpp"
16
16
17
17
#include " motion_utils/trajectory/trajectory.hpp"
18
18
#include " tier4_autoware_utils/geometry/boost_polygon_utils.hpp"
19
19
#include " tier4_autoware_utils/geometry/geometry.hpp"
20
20
21
+ #include < algorithm>
22
+
21
23
namespace
22
24
{
23
25
PointWithStamp calcNearestCollisionPoint (
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__POLYGON_UTILS_HPP_
16
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__POLYGON_UTILS_HPP_
15
+ #ifndef POLYGON_UTILS_HPP_
16
+ #define POLYGON_UTILS_HPP_
17
17
18
- #include " autoware_obstacle_cruise_planner/common_structs.hpp"
19
- #include " autoware_obstacle_cruise_planner/type_alias.hpp"
20
18
#include " autoware_vehicle_info_utils/vehicle_info_utils.hpp"
19
+ #include " common_structs.hpp"
21
20
#include " tier4_autoware_utils/geometry/boost_geometry.hpp"
21
+ #include " type_alias.hpp"
22
22
23
23
#include < boost/geometry.hpp>
24
24
@@ -52,4 +52,4 @@ std::vector<PointWithStamp> getCollisionPoints(
52
52
53
53
} // namespace polygon_utils
54
54
55
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__POLYGON_UTILS_HPP_
55
+ #endif // POLYGON_UTILS_HPP_
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__STOP_PLANNING_DEBUG_INFO_HPP_
16
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__STOP_PLANNING_DEBUG_INFO_HPP_
15
+ #ifndef STOP_PLANNING_DEBUG_INFO_HPP_
16
+ #define STOP_PLANNING_DEBUG_INFO_HPP_
17
17
18
18
#include < rclcpp/rclcpp.hpp>
19
19
@@ -85,4 +85,4 @@ class StopPlanningDebugInfo
85
85
std::array<double , static_cast <int >(TYPE::SIZE)> info_;
86
86
};
87
87
88
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__STOP_PLANNING_DEBUG_INFO_HPP_
88
+ #endif // STOP_PLANNING_DEBUG_INFO_HPP_
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #ifndef AUTOWARE_OBSTACLE_CRUISE_PLANNER__TYPE_ALIAS_HPP_
16
- #define AUTOWARE_OBSTACLE_CRUISE_PLANNER__TYPE_ALIAS_HPP_
15
+ #ifndef TYPE_ALIAS_HPP_
16
+ #define TYPE_ALIAS_HPP_
17
17
18
18
#include " autoware_vehicle_info_utils/vehicle_info_utils.hpp"
19
19
@@ -63,4 +63,4 @@ namespace bg = boost::geometry;
63
63
using tier4_autoware_utils::Point2d;
64
64
using tier4_autoware_utils::Polygon2d;
65
65
66
- #endif // AUTOWARE_OBSTACLE_CRUISE_PLANNER__TYPE_ALIAS_HPP_
66
+ #endif // TYPE_ALIAS_HPP_
Original file line number Diff line number Diff line change 12
12
// See the License for the specific language governing permissions and
13
13
// limitations under the License.
14
14
15
- #include " autoware_obstacle_cruise_planner/ utils.hpp"
15
+ #include " utils.hpp"
16
16
17
17
#include " object_recognition_utils/predicted_path_utils.hpp"
18
18
#include " tier4_autoware_utils/ros/marker_helper.hpp"
You can’t perform that action at this time.
0 commit comments