Skip to content

Commit

Permalink
Formatting
Browse files Browse the repository at this point in the history
  • Loading branch information
sjahr authored Aug 12, 2024
1 parent 08eaab1 commit 331652f
Showing 1 changed file with 2 additions and 0 deletions.
2 changes: 2 additions & 0 deletions capabilities/src/execute_task_solution_capability.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -46,6 +46,7 @@
#include <fmt/format.h>

namespace {

// TODO: move to moveit::core::RobotModel
const moveit::core::JointModelGroup* findJointModelGroup(const moveit::core::RobotModel& model,
const std::vector<std::string>& joints) {
Expand Down Expand Up @@ -76,6 +77,7 @@ const moveit::core::JointModelGroup* findJointModelGroup(const moveit::core::Rob
return nullptr;
}
} // namespace

static const rclcpp::Logger LOGGER = rclcpp::get_logger("moveit_task_constructor_visualization.execute_task_solution");

namespace move_group {
Expand Down

0 comments on commit 331652f

Please sign in to comment.