Skip to content

Commit 47bbb1c

Browse files
authored
fix(autoware_behavior_velocity_stop_line_module): remove unused function (#9591)
Signed-off-by: Ryuta Kambe <ryuta.kambe@tier4.jp>
1 parent 90bf2d0 commit 47bbb1c

File tree

1 file changed

+0
-9
lines changed
  • planning/behavior_velocity_planner/autoware_behavior_velocity_stop_line_module/src

1 file changed

+0
-9
lines changed

planning/behavior_velocity_planner/autoware_behavior_velocity_stop_line_module/src/scene.cpp

-9
Original file line numberDiff line numberDiff line change
@@ -26,15 +26,6 @@
2626
namespace autoware::behavior_velocity_planner
2727
{
2828

29-
geometry_msgs::msg::Point getCenterOfStopLine(const lanelet::ConstLineString3d & stop_line)
30-
{
31-
geometry_msgs::msg::Point center_point;
32-
center_point.x = (stop_line[0].x() + stop_line[1].x()) / 2.0;
33-
center_point.y = (stop_line[0].y() + stop_line[1].y()) / 2.0;
34-
center_point.z = (stop_line[0].z() + stop_line[1].z()) / 2.0;
35-
return center_point;
36-
}
37-
3829
StopLineModule::StopLineModule(
3930
const int64_t module_id, lanelet::ConstLineString3d stop_line, const PlannerParam & planner_param,
4031
const rclcpp::Logger & logger, const rclcpp::Clock::SharedPtr clock)

0 commit comments

Comments
 (0)