Skip to content

Commit

Permalink
Merge pull request #6 from AcutronicRobotics/collision_detection_fcl
Browse files Browse the repository at this point in the history
Update logger name
  • Loading branch information
ahcorde authored Feb 25, 2019
2 parents 5484c2a + 6ffad79 commit 9e033d0
Show file tree
Hide file tree
Showing 3 changed files with 3 additions and 3 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -50,7 +50,7 @@
#include <boost/thread/mutex.hpp>
#include <memory>

rclcpp::Logger logger = rclcpp::get_logger("collision_detection_fcl");
rclcpp::Logger logger = rclcpp::get_logger("collision_detection.fcl");

namespace collision_detection
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -41,7 +41,7 @@
#include <fcl/broadphase/broadphase_dynamic_AABB_tree.h>
#endif

rclcpp::Logger logger = rclcpp::get_logger("collision_detection_fcl");
rclcpp::Logger logger = rclcpp::get_logger("collision_detection.fcl");

namespace collision_detection
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -52,7 +52,7 @@

#include <boost/bind.hpp>

rclcpp::Logger logger = rclcpp::get_logger("collision_detection_fcl");
rclcpp::Logger logger = rclcpp::get_logger("collision_detection.fcl");

namespace collision_detection
{
Expand Down

0 comments on commit 9e033d0

Please sign in to comment.