Skip to content

Commit

Permalink
CI fixes Signed-off-by: Jakubach [email protected]
Browse files Browse the repository at this point in the history
Signed-off-by: Jakubach <[email protected]>
  • Loading branch information
Jakubach committed Jan 23, 2025
1 parent 5dcab94 commit a3da9e5
Show file tree
Hide file tree
Showing 3 changed files with 4 additions and 3 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -78,7 +78,7 @@ class Controller
const double & angular_distance_to_heading,
const geometry_msgs::msg::Twist & current_velocity,
const double & dt);

protected:
/**
* @brief Check if a trajectory is collision free.
Expand Down
3 changes: 2 additions & 1 deletion nav2_docking/opennav_docking/src/controller.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -79,7 +79,8 @@ Controller::Controller(
node->get_parameter("controller.v_angular_max", v_angular_max_);
node->get_parameter("controller.slowdown_radius", slowdown_radius_);
node->get_parameter("controller.rotate_to_heading_angular_vel", rotate_to_heading_angular_vel_);
node->get_parameter("controller.rotate_to_heading_max_angular_accel", rotate_to_heading_max_angular_accel_);
node->get_parameter("controller.rotate_to_heading_max_angular_accel",
rotate_to_heading_max_angular_accel_);
control_law_ = std::make_unique<nav2_graceful_controller::SmoothControlLaw>(
k_phi_, k_delta_, beta_, lambda_, slowdown_radius_, v_linear_min_, v_linear_max_,
v_angular_max_);
Expand Down
2 changes: 1 addition & 1 deletion nav2_docking/opennav_docking/src/docking_server.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -489,7 +489,7 @@ bool DockingServer::approachDock(Dock * dock, geometry_msgs::msg::PoseStamped &
// Make sure that the target pose is pointing at the robot when moving backwards
// This is to ensure that the robot doesn't try to dock from the wrong side
if (dock_backwards_) {
target_pose.pose.orientation =
target_pose.pose.orientation =
nav2_util::geometry_utils::orientationAroundZAxis(yaw + M_PI);
}

Expand Down

0 comments on commit a3da9e5

Please sign in to comment.