Skip to content

Commit

Permalink
fix(autoware_behavior_velocity_stop_line_module): remove unused funct…
Browse files Browse the repository at this point in the history
…ion (autowarefoundation#9591)

Signed-off-by: Ryuta Kambe <[email protected]>
  • Loading branch information
veqcc authored Dec 9, 2024
1 parent 90bf2d0 commit 47bbb1c
Showing 1 changed file with 0 additions and 9 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -26,15 +26,6 @@
namespace autoware::behavior_velocity_planner
{

geometry_msgs::msg::Point getCenterOfStopLine(const lanelet::ConstLineString3d & stop_line)
{
geometry_msgs::msg::Point center_point;
center_point.x = (stop_line[0].x() + stop_line[1].x()) / 2.0;
center_point.y = (stop_line[0].y() + stop_line[1].y()) / 2.0;
center_point.z = (stop_line[0].z() + stop_line[1].z()) / 2.0;
return center_point;
}

StopLineModule::StopLineModule(
const int64_t module_id, lanelet::ConstLineString3d stop_line, const PlannerParam & planner_param,
const rclcpp::Logger & logger, const rclcpp::Clock::SharedPtr clock)
Expand Down

0 comments on commit 47bbb1c

Please sign in to comment.