Skip to content

Commit

Permalink
Removed extra empty comment lines, and fixed redundant/misunderstood …
Browse files Browse the repository at this point in the history
…dynamic param callack code
  • Loading branch information
josephduchesne committed Jan 15, 2025
1 parent b1ce023 commit b6e59e8
Show file tree
Hide file tree
Showing 2 changed files with 0 additions and 6 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -47,8 +47,6 @@ namespace nav2_controller
/**
* @class PathCompleteGoalChecker
* @brief Goal Checker plugin that checks position delta, once path is shorter than a threshold.
*
*
*/
class PathCompleteGoalChecker : public SimpleGoalChecker
{
Expand Down
4 changes: 0 additions & 4 deletions nav2_controller/plugins/path_complete_goal_checker.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -65,7 +65,6 @@ void PathCompleteGoalChecker::initialize(
node->get_parameter(plugin_name + ".path_length_tolerance", path_length_tolerance_);

// Replace SimpleGoalChecker's callback for dynamic parameters
node->remove_on_set_parameters_callback(dyn_params_handler_.get());
dyn_params_handler_ = node->add_on_set_parameters_callback(
std::bind(&PathCompleteGoalChecker::dynamicParametersCallback, this, _1));
}
Expand All @@ -91,9 +90,6 @@ bool PathCompleteGoalChecker::isGoalReached(
rcl_interfaces::msg::SetParametersResult
PathCompleteGoalChecker::dynamicParametersCallback(std::vector<rclcpp::Parameter> parameters)
{
// call the base class (might be unnessesary since the base class will already bind this event)
rcl_interfaces::msg::SetParametersResult result =
SimpleGoalChecker::dynamicParametersCallback(parameters);
for (auto & parameter : parameters) {
const auto & type = parameter.get_type();
const auto & name = parameter.get_name();
Expand Down

0 comments on commit b6e59e8

Please sign in to comment.