Skip to content

Commit 8faba15

Browse files
committed
clang-tidy: llvm-namespace-comment
1 parent 2153237 commit 8faba15

File tree

87 files changed

+190
-189
lines changed

Some content is hidden

Large Commits have some content hidden by default. Use the searchbox below for content that may be hidden.

87 files changed

+190
-189
lines changed

.clang-tidy

Lines changed: 1 addition & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -1,5 +1,6 @@
11
---
22
Checks: '-*,
3+
llvm-namespace-comment,
34
modernize-use-nullptr,
45
modernize-use-override,
56
modernize-use-using,

capabilities/src/execute_task_solution_capability.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -76,7 +76,7 @@ const moveit::core::JointModelGroup* findJointModelGroup(const moveit::core::Rob
7676

7777
return nullptr;
7878
}
79-
}
79+
} // namespace
8080

8181
namespace move_group {
8282

core/include/moveit/task_constructor/container.h

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -227,5 +227,5 @@ class WrapperBase : public ParallelContainerBase
227227
protected:
228228
WrapperBase(WrapperBasePrivate* impl, Stage::pointer&& child = Stage::pointer());
229229
};
230-
}
231-
}
230+
} // namespace task_constructor
231+
} // namespace moveit

core/include/moveit/task_constructor/container_p.h

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -264,5 +264,5 @@ class MergerPrivate : public ParallelContainerBasePrivate
264264
void sendBackward(SubTrajectory&& t, const InterfaceState* to);
265265
};
266266
PIMPL_FUNCTIONS(Merger)
267-
}
268-
}
267+
} // namespace task_constructor
268+
} // namespace moveit

core/include/moveit/task_constructor/introspection.h

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -112,5 +112,5 @@ class Introspection
112112
/// retrieve solution with given id
113113
const SolutionBase* solutionFromId(uint id) const;
114114
};
115-
}
116-
}
115+
} // namespace task_constructor
116+
} // namespace moveit

core/include/moveit/task_constructor/marker_tools.h

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -43,5 +43,5 @@ void generateVisualMarkers(const moveit::core::RobotState& robot_state, const Ma
4343
/** generate marker msgs to visualize the planning scene, calling the given callback for each of them
4444
* calls generateMarkersForRobot() and generateMarkersForObjects() */
4545
void generateMarkersForScene(const planning_scene::PlanningSceneConstPtr& scene, const MarkerCallback& callback);
46-
}
47-
}
46+
} // namespace task_constructor
47+
} // namespace moveit

core/include/moveit/task_constructor/merge.h

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -58,5 +58,5 @@ moveit::core::JointModelGroup* merge(const std::vector<const moveit::core::Joint
5858
robot_trajectory::RobotTrajectoryPtr
5959
merge(const std::vector<robot_trajectory::RobotTrajectoryConstPtr>& sub_trajectories,
6060
const moveit::core::RobotState& base_state, moveit::core::JointModelGroup*& merged_group);
61-
}
62-
}
61+
} // namespace task_constructor
62+
} // namespace moveit

core/include/moveit/task_constructor/solvers/cartesian_path.h

Lines changed: 3 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -70,6 +70,6 @@ class CartesianPath : public PlannerInterface
7070
robot_trajectory::RobotTrajectoryPtr& result,
7171
const moveit_msgs::Constraints& path_constraints = moveit_msgs::Constraints()) override;
7272
};
73-
}
74-
}
75-
}
73+
} // namespace solvers
74+
} // namespace task_constructor
75+
} // namespace moveit

core/include/moveit/task_constructor/solvers/joint_interpolation.h

Lines changed: 3 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -64,6 +64,6 @@ class JointInterpolationPlanner : public PlannerInterface
6464
robot_trajectory::RobotTrajectoryPtr& result,
6565
const moveit_msgs::Constraints& path_constraints = moveit_msgs::Constraints()) override;
6666
};
67-
}
68-
}
69-
}
67+
} // namespace solvers
68+
} // namespace task_constructor
69+
} // namespace moveit

core/include/moveit/task_constructor/solvers/pipeline_planner.h

Lines changed: 3 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -75,6 +75,6 @@ class PipelinePlanner : public PlannerInterface
7575
protected:
7676
planning_pipeline::PlanningPipelinePtr planner_;
7777
};
78-
}
79-
}
80-
}
78+
} // namespace solvers
79+
} // namespace task_constructor
80+
} // namespace moveit

0 commit comments

Comments
 (0)