We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent 3d3d1b7 commit 08eaab1Copy full SHA for 08eaab1
capabilities/src/execute_task_solution_capability.cpp
@@ -46,7 +46,6 @@
46
#include <fmt/format.h>
47
48
namespace {
49
-const rclcpp::Logger LOGGER = rclcpp::get_logger("moveit_task_constructor_visualization.execute_task_solution");
50
// TODO: move to moveit::core::RobotModel
51
const moveit::core::JointModelGroup* findJointModelGroup(const moveit::core::RobotModel& model,
52
const std::vector<std::string>& joints) {
@@ -77,6 +76,7 @@ const moveit::core::JointModelGroup* findJointModelGroup(const moveit::core::Rob
77
76
return nullptr;
78
}
79
} // namespace
+static const rclcpp::Logger LOGGER = rclcpp::get_logger("moveit_task_constructor_visualization.execute_task_solution");
80
81
namespace move_group {
82
0 commit comments