Skip to content

Commit

Permalink
Remove anonymous namespace in header
Browse files Browse the repository at this point in the history
  • Loading branch information
sjahr committed Oct 23, 2023
1 parent ca23615 commit 8da7276
Showing 1 changed file with 0 additions and 4 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -54,8 +54,6 @@

namespace planning_pipeline
{
namespace
{
/**
* \brief Helper function template to apply all adapters of the given vector to the motion planning problem or solution
*
Expand Down Expand Up @@ -131,8 +129,6 @@ void loadPluginVector(const std::shared_ptr<rclcpp::Node>& node,
}
};

} // namespace

/** \brief This class facilitates loading planning plugins and planning adapter plugins. It implements functionality to
* use the loaded plugins in a motion planning pipeline consisting of PlanningRequestAdapters (Pre-processing), a
* Planner plugin and PlanningResponseAdapters (Post-processing).*/
Expand Down

0 comments on commit 8da7276

Please sign in to comment.