Skip to content

Commit

Permalink
code style
Browse files Browse the repository at this point in the history
Signed-off-by: goes <[email protected]>
  • Loading branch information
goes authored and goes committed Jul 17, 2024
1 parent b70bbbe commit e167aa4
Show file tree
Hide file tree
Showing 11 changed files with 11 additions and 11 deletions.
2 changes: 1 addition & 1 deletion nav2_costmap_2d/plugins/inflation_layer.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -78,7 +78,7 @@ InflationLayer::InflationLayer()

InflationLayer::~InflationLayer()
{
if(auto node = node_.lock()) {
if (auto node = node_.lock()) {
node->remove_on_set_parameters_callback(dyn_params_handler_.get());
}
dyn_params_handler_.reset();
Expand Down
2 changes: 1 addition & 1 deletion nav2_costmap_2d/plugins/obstacle_layer.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -62,7 +62,7 @@ namespace nav2_costmap_2d

ObstacleLayer::~ObstacleLayer()
{
if(auto node = node_.lock()) {
if (auto node = node_.lock()) {
node->remove_on_set_parameters_callback(dyn_params_handler_.get());
}
dyn_params_handler_.reset();
Expand Down
2 changes: 1 addition & 1 deletion nav2_costmap_2d/plugins/static_layer.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -112,7 +112,7 @@ StaticLayer::activate()
void
StaticLayer::deactivate()
{
if(auto node = node_.lock()) {
if (auto node = node_.lock()) {
node->remove_on_set_parameters_callback(dyn_params_handler_.get());
}
dyn_params_handler_.reset();
Expand Down
2 changes: 1 addition & 1 deletion nav2_costmap_2d/plugins/voxel_layer.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -116,7 +116,7 @@ void VoxelLayer::onInitialize()

VoxelLayer::~VoxelLayer()
{
if(auto node = node_.lock()) {
if (auto node = node_.lock()) {
node->remove_on_set_parameters_callback(dyn_params_handler_.get());
}
dyn_params_handler_.reset();
Expand Down
2 changes: 1 addition & 1 deletion nav2_mppi_controller/src/parameters_handler.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -28,7 +28,7 @@ ParametersHandler::ParametersHandler(

ParametersHandler::~ParametersHandler()
{
if(auto node = node_.lock()) {
if (auto node = node_.lock()) {
node->remove_on_set_parameters_callback(on_set_param_handler_.get());
}
on_set_param_handler_.reset();
Expand Down
2 changes: 1 addition & 1 deletion nav2_navfn_planner/src/navfn_planner.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -115,7 +115,7 @@ NavfnPlanner::deactivate()
RCLCPP_INFO(
logger_, "Deactivating plugin %s of type NavfnPlanner",
name_.c_str());
if(auto node = node_.lock()) {
if (auto node = node_.lock()) {
node->remove_on_set_parameters_callback(dyn_params_handler_.get());
}
dyn_params_handler_.reset();
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -124,7 +124,7 @@ void RotationShimController::deactivate()

primary_controller_->deactivate();

if(auto node = node_.lock()) {
if (auto node = node_.lock()) {
node->remove_on_set_parameters_callback(dyn_params_handler_.get());
}
dyn_params_handler_.reset();
Expand Down
2 changes: 1 addition & 1 deletion nav2_smac_planner/src/smac_planner_2d.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -178,7 +178,7 @@ void SmacPlanner2D::deactivate()
_costmap_downsampler->on_deactivate();
}
// shutdown dyn_param_handler
if(auto node = _node.lock()) {
if (auto node = _node.lock()) {
node->remove_on_set_parameters_callback(_dyn_params_handler.get());
}
_dyn_params_handler.reset();
Expand Down
2 changes: 1 addition & 1 deletion nav2_smac_planner/src/smac_planner_hybrid.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -312,7 +312,7 @@ void SmacPlannerHybrid::deactivate()
_costmap_downsampler->on_deactivate();
}
// shutdown dyn_param_handler
if(auto node = _node.lock()) {
if (auto node = _node.lock()) {
node->remove_on_set_parameters_callback(_dyn_params_handler.get());
}
_dyn_params_handler.reset();
Expand Down
2 changes: 1 addition & 1 deletion nav2_smac_planner/src/smac_planner_lattice.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -251,7 +251,7 @@ void SmacPlannerLattice::deactivate()
_planned_footprints_publisher->on_deactivate();
}
// shutdown dyn_param_handler
if(auto node = _node.lock()) {
if (auto node = _node.lock()) {
node->remove_on_set_parameters_callback(_dyn_params_handler.get());
}
_dyn_params_handler.reset();
Expand Down
2 changes: 1 addition & 1 deletion nav2_theta_star_planner/src/theta_star_planner.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -86,7 +86,7 @@ void ThetaStarPlanner::activate()
void ThetaStarPlanner::deactivate()
{
RCLCPP_INFO(logger_, "Deactivating plugin %s of type nav2_theta_star_planner", name_.c_str());
if(auto node = parent_node_.lock()) {
if (auto node = parent_node_.lock()) {
node->remove_on_set_parameters_callback(dyn_params_handler_.get());
}
dyn_params_handler_.reset();
Expand Down

0 comments on commit e167aa4

Please sign in to comment.