Skip to content

Commit e1a6598

Browse files
committed
Build fixes
Signed-off-by: Jakubach <[email protected]>
1 parent 5cd1739 commit e1a6598

File tree

2 files changed

+3
-4
lines changed

2 files changed

+3
-4
lines changed

nav2_docking/opennav_docking/include/opennav_docking/docking_server.hpp

+2-2
Original file line numberDiff line numberDiff line change
@@ -95,7 +95,7 @@ class DockingServer : public nav2_util::LifecycleNode
9595
/**
9696
* @brief Perform a pure rotation to dock orientation.
9797
*/
98-
void DockingServer::rotateToDock(const geometry_msgs::msg::PoseStamped & dock_pose)
98+
void DockingServer::rotateToDock(const geometry_msgs::msg::PoseStamped & dock_pose);
9999

100100

101101
/**
@@ -255,7 +255,7 @@ void DockingServer::rotateToDock(const geometry_msgs::msg::PoseStamped & dock_po
255255
// depending on the initial robot orientation and k_phi, k_delta.
256256
bool initial_rotation_;
257257
// Enable aproaching a docking station only with initial detection without updates
258-
bool backward_blind;
258+
bool backward_blind_;
259259

260260
// This is a class member so it can be accessed in publish feedback
261261
rclcpp::Time action_start_time_;

nav2_docking/opennav_docking/src/docking_server.cpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -64,8 +64,7 @@ DockingServer::on_configure(const rclcpp_lifecycle::State & state)
6464
get_parameter("initial_rotation", initial_rotation_);
6565
get_parameter("backward_blind", backward_blind_);
6666
if(backward_blind_ && !dock_backwards_){
67-
RCLCPP_ERROR(get_logger(), "Docking server configuration is invalid.
68-
backward_blind is enabled when dock_backwards is disabled.");
67+
RCLCPP_ERROR(get_logger(), "backward_blind is enabled when dock_backwards is disabled.");
6968
return nav2_util::CallbackReturn::FAILURE;
7069
} else{
7170
// If you have backward_blind and dock_backward then

0 commit comments

Comments
 (0)