@@ -136,7 +136,7 @@ bool RunOutModule::modifyPathVelocity(
136
136
return true ;
137
137
}
138
138
139
- boost ::optional<DynamicObstacle> RunOutModule::detectCollision (
139
+ std ::optional<DynamicObstacle> RunOutModule::detectCollision (
140
140
const std::vector<DynamicObstacle> & dynamic_obstacles, const PathWithLaneId & path)
141
141
{
142
142
if (path.points .size () < 2 ) {
@@ -197,7 +197,7 @@ boost::optional<DynamicObstacle> RunOutModule::detectCollision(
197
197
return {};
198
198
}
199
199
200
- boost ::optional<DynamicObstacle> RunOutModule::findNearestCollisionObstacle (
200
+ std ::optional<DynamicObstacle> RunOutModule::findNearestCollisionObstacle (
201
201
const PathWithLaneId & path, const geometry_msgs::msg::Pose & base_pose,
202
202
std::vector<DynamicObstacle> & dynamic_obstacles) const
203
203
{
@@ -337,7 +337,7 @@ std::vector<DynamicObstacle> RunOutModule::checkCollisionWithObstacles(
337
337
338
338
// calculate the predicted pose of the obstacle on the predicted path with given travel time
339
339
// assume that the obstacle moves with constant velocity
340
- boost ::optional<geometry_msgs::msg::Pose> RunOutModule::calcPredictedObstaclePose (
340
+ std ::optional<geometry_msgs::msg::Pose> RunOutModule::calcPredictedObstaclePose (
341
341
const std::vector<PredictedPath> & predicted_paths, const float travel_time,
342
342
const float velocity_mps) const
343
343
{
@@ -509,7 +509,7 @@ bool RunOutModule::checkCollisionWithPolygon() const
509
509
}
510
510
511
511
std::optional<geometry_msgs::msg::Pose> RunOutModule::calcStopPoint (
512
- const boost ::optional<DynamicObstacle> & dynamic_obstacle, const PathWithLaneId & path,
512
+ const std ::optional<DynamicObstacle> & dynamic_obstacle, const PathWithLaneId & path,
513
513
const geometry_msgs::msg::Pose & current_pose, const float current_vel,
514
514
const float current_acc) const
515
515
{
@@ -625,7 +625,7 @@ void RunOutModule::insertStopPoint(
625
625
}
626
626
627
627
void RunOutModule::insertVelocityForState (
628
- const boost ::optional<DynamicObstacle> & dynamic_obstacle, const PlannerData planner_data,
628
+ const std ::optional<DynamicObstacle> & dynamic_obstacle, const PlannerData planner_data,
629
629
const PlannerParam & planner_param, const PathWithLaneId & smoothed_path,
630
630
PathWithLaneId & output_path)
631
631
{
@@ -684,7 +684,7 @@ void RunOutModule::insertVelocityForState(
684
684
}
685
685
686
686
void RunOutModule::insertStoppingVelocity (
687
- const boost ::optional<DynamicObstacle> & dynamic_obstacle,
687
+ const std ::optional<DynamicObstacle> & dynamic_obstacle,
688
688
const geometry_msgs::msg::Pose & current_pose, const float current_vel, const float current_acc,
689
689
PathWithLaneId & output_path)
690
690
{
@@ -739,7 +739,7 @@ void RunOutModule::applyMaxJerkLimit(
739
739
return ;
740
740
}
741
741
742
- const auto stop_point = path.points .at (stop_point_idx.get ()).point .pose .position ;
742
+ const auto stop_point = path.points .at (stop_point_idx.value ()).point .pose .position ;
743
743
const auto dist_to_stop_point =
744
744
motion_utils::calcSignedArcLength (path.points , current_pose.position , stop_point);
745
745
@@ -749,7 +749,7 @@ void RunOutModule::applyMaxJerkLimit(
749
749
current_vel, dist_to_stop_point);
750
750
751
751
// overwrite velocity with limited velocity
752
- run_out_utils::insertPathVelocityFromIndex (stop_point_idx.get (), jerk_limited_vel, path.points );
752
+ run_out_utils::insertPathVelocityFromIndex (stop_point_idx.value (), jerk_limited_vel, path.points );
753
753
}
754
754
755
755
std::vector<DynamicObstacle> RunOutModule::excludeObstaclesOutSideOfPartition (
@@ -782,7 +782,7 @@ std::vector<DynamicObstacle> RunOutModule::excludeObstaclesOutSideOfPartition(
782
782
783
783
void RunOutModule::publishDebugValue (
784
784
const PathWithLaneId & path, const std::vector<DynamicObstacle> extracted_obstacles,
785
- const boost ::optional<DynamicObstacle> & dynamic_obstacle,
785
+ const std ::optional<DynamicObstacle> & dynamic_obstacle,
786
786
const geometry_msgs::msg::Pose & current_pose) const
787
787
{
788
788
if (dynamic_obstacle) {
0 commit comments