File tree 2 files changed +3
-4
lines changed
nav2_docking/opennav_docking
2 files changed +3
-4
lines changed Original file line number Diff line number Diff line change @@ -95,7 +95,7 @@ class DockingServer : public nav2_util::LifecycleNode
95
95
/* *
96
96
* @brief Perform a pure rotation to dock orientation.
97
97
*/
98
- void DockingServer::rotateToDock (const geometry_msgs::msg::PoseStamped & dock_pose)
98
+ void DockingServer::rotateToDock (const geometry_msgs::msg::PoseStamped & dock_pose);
99
99
100
100
101
101
/* *
@@ -255,7 +255,7 @@ void DockingServer::rotateToDock(const geometry_msgs::msg::PoseStamped & dock_po
255
255
// depending on the initial robot orientation and k_phi, k_delta.
256
256
bool initial_rotation_;
257
257
// Enable aproaching a docking station only with initial detection without updates
258
- bool backward_blind ;
258
+ bool backward_blind_ ;
259
259
260
260
// This is a class member so it can be accessed in publish feedback
261
261
rclcpp::Time action_start_time_;
Original file line number Diff line number Diff line change @@ -64,8 +64,7 @@ DockingServer::on_configure(const rclcpp_lifecycle::State & state)
64
64
get_parameter (" initial_rotation" , initial_rotation_);
65
65
get_parameter (" backward_blind" , backward_blind_);
66
66
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." );
69
68
return nav2_util::CallbackReturn::FAILURE;
70
69
} else {
71
70
// If you have backward_blind and dock_backward then
You can’t perform that action at this time.
0 commit comments