Skip to content

Commit b6e59e8

Browse files
Removed extra empty comment lines, and fixed redundant/misunderstood dynamic param callack code
1 parent b1ce023 commit b6e59e8

File tree

2 files changed

+0
-6
lines changed

2 files changed

+0
-6
lines changed

nav2_controller/include/nav2_controller/plugins/path_complete_goal_checker.hpp

Lines changed: 0 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -47,8 +47,6 @@ namespace nav2_controller
4747
/**
4848
* @class PathCompleteGoalChecker
4949
* @brief Goal Checker plugin that checks position delta, once path is shorter than a threshold.
50-
*
51-
*
5250
*/
5351
class PathCompleteGoalChecker : public SimpleGoalChecker
5452
{

nav2_controller/plugins/path_complete_goal_checker.cpp

Lines changed: 0 additions & 4 deletions
Original file line numberDiff line numberDiff line change
@@ -65,7 +65,6 @@ void PathCompleteGoalChecker::initialize(
6565
node->get_parameter(plugin_name + ".path_length_tolerance", path_length_tolerance_);
6666

6767
// Replace SimpleGoalChecker's callback for dynamic parameters
68-
node->remove_on_set_parameters_callback(dyn_params_handler_.get());
6968
dyn_params_handler_ = node->add_on_set_parameters_callback(
7069
std::bind(&PathCompleteGoalChecker::dynamicParametersCallback, this, _1));
7170
}
@@ -91,9 +90,6 @@ bool PathCompleteGoalChecker::isGoalReached(
9190
rcl_interfaces::msg::SetParametersResult
9291
PathCompleteGoalChecker::dynamicParametersCallback(std::vector<rclcpp::Parameter> parameters)
9392
{
94-
// call the base class (might be unnessesary since the base class will already bind this event)
95-
rcl_interfaces::msg::SetParametersResult result =
96-
SimpleGoalChecker::dynamicParametersCallback(parameters);
9793
for (auto & parameter : parameters) {
9894
const auto & type = parameter.get_type();
9995
const auto & name = parameter.get_name();

0 commit comments

Comments
 (0)