Skip to content

Commit

Permalink
Fix humble
Browse files Browse the repository at this point in the history
  • Loading branch information
sjahr committed Oct 26, 2023
1 parent 40625e6 commit c4679dc
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion moveit_core/utils/src/logger.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -60,7 +60,7 @@ rclcpp::Logger makeChildLogger(const std::string& name)
static std::unordered_map<std::string, std::shared_ptr<rclcpp::Node>> child_nodes;
if (child_nodes.find(name) == child_nodes.end())
{
std::string ns = get_logger().get_name();
std::string ns = getLogger().get_name();
child_nodes[name] = std::make_shared<rclcpp::Node>(name, ns);
}
#endif
Expand Down

0 comments on commit c4679dc

Please sign in to comment.