From 206c27d78a6fc0b4407423222c45fe7ced14398a Mon Sep 17 00:00:00 2001 From: Anasarrak Date: Thu, 13 Jun 2019 11:20:21 +0200 Subject: [PATCH] Moving default_contraint_sampler logger into the namespace --- .../constraint_samplers/src/default_constraint_samplers.cpp | 3 +-- 1 file changed, 1 insertion(+), 2 deletions(-) diff --git a/moveit_core/constraint_samplers/src/default_constraint_samplers.cpp b/moveit_core/constraint_samplers/src/default_constraint_samplers.cpp index 2423b5c064..35db35d5b9 100644 --- a/moveit_core/constraint_samplers/src/default_constraint_samplers.cpp +++ b/moveit_core/constraint_samplers/src/default_constraint_samplers.cpp @@ -39,10 +39,9 @@ #include #include -rclcpp::Logger LOGGER_DEFAULT_CONTRAINT_SAMPLERS = rclcpp::get_logger("moveit").get_child("constraint_samplers"); - namespace constraint_samplers { + static rclcpp::Logger LOGGER_DEFAULT_CONTRAINT_SAMPLERS = rclcpp::get_logger("moveit").get_child("constraint_samplers"); bool JointConstraintSampler::configure(const moveit_msgs::msg::Constraints& constr) { // construct the constraints