Skip to content

Commit

Permalink
Move constraint_sampler logger to the appropriate namespace
Browse files Browse the repository at this point in the history
  • Loading branch information
anasarrak committed Jun 13, 2019
1 parent 02f0eb3 commit 1611306
Show file tree
Hide file tree
Showing 2 changed files with 1 addition and 3 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -52,7 +52,7 @@
namespace constraint_samplers
{
MOVEIT_CLASS_FORWARD(ConstraintSampler);

static rclcpp::Logger LOGGER_CONSTRAINT_SAMPLERS = rclcpp::get_logger("moveit").get_child("constraint_samplers");
/**
* \brief ConstraintSampler is an abstract base class that allows the
* sampling of a kinematic state for a particular group of a robot.
Expand Down
2 changes: 0 additions & 2 deletions moveit_core/constraint_samplers/src/constraint_sampler.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -36,8 +36,6 @@

#include <moveit/constraint_samplers/constraint_sampler.h>

rclcpp::Logger LOGGER_CONSTRAINT_SAMPLERS = rclcpp::get_logger("moveit").get_child("constraint_samplers");

constraint_samplers::ConstraintSampler::ConstraintSampler(const planning_scene::PlanningSceneConstPtr& scene,
const std::string& group_name)
: is_valid_(false), scene_(scene), jmg_(scene->getRobotModel()->getJointModelGroup(group_name)), verbose_(false)
Expand Down

0 comments on commit 1611306

Please sign in to comment.