Skip to content

Commit

Permalink
CI fixes
Browse files Browse the repository at this point in the history
Signed-off-by: jakubach <[email protected]>
  • Loading branch information
Jakubach committed Nov 13, 2024
1 parent b706459 commit 034b258
Showing 1 changed file with 0 additions and 2 deletions.
2 changes: 0 additions & 2 deletions nav2_docking/opennav_docking/src/docking_server.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -418,8 +418,6 @@ void DockingServer::doInitialPerception(Dock * dock, geometry_msgs::msg::PoseSta
}
}



void DockingServer::rotateToDock(const geometry_msgs::msg::PoseStamped & dock_pose)

Check warning on line 421 in nav2_docking/opennav_docking/src/docking_server.cpp

View check run for this annotation

Codecov / codecov/patch

nav2_docking/opennav_docking/src/docking_server.cpp#L421

Added line #L421 was not covered by tests
{
rclcpp::Rate loop_rate(controller_frequency_);
Expand Down

0 comments on commit 034b258

Please sign in to comment.