Class Logger

Inheritance Relationships

Base Type

  • public rclcpp::Logger

Class Documentation

class Logger : public rclcpp::Logger

Modern fmt-style logger that extends rclcpp::Logger.

Public Functions

inline explicit Logger(const rclcpp::Logger &logger)

Construct a Logger from an existing rclcpp::Logger.

Parameters:

logger – The rclcpp::Logger to extend

inline Logger(const rclcpp::Logger &logger, const rclcpp::Clock &clock)

Construct a Logger with a specific clock for throttling features.

Parameters:
  • logger – The rclcpp::Logger to extend

  • clock – Clock used for throttling functionality

inline Logger(const rclcpp::Logger &logger, const rclcpp::Clock::ConstSharedPtr clock_ptr)

Construct a Logger with a specific clock for throttling features.

Parameters:
  • logger – The rclcpp::Logger to extend

  • clock_ptr – Clock pointer used for throttling functionality

template<typename ...Args>
inline void debug(const format_with_loc &format, Args&&... args) const
template<typename... Args, typename Unique = decltype([]() {  })> inline void debug_once (const format_with_loc &format, Args &&... args) const
template<typename... Args, typename Unique = decltype([]() {  })> inline void debug_throttle (const rclcpp::Duration &duration, const format_with_loc &format, Args &&... args) const
template<typename T, typename... Args, typename Unique = decltype([]() {  })> inline void debug_on_change (const T value, const format_with_loc &format, Args &&... args) const
template<typename TV, typename TT, typename... Args, typename Unique = decltype([]() {  })> inline void debug_on_change (const TV &value, const TT &threshold, const format_with_loc &format, Args &&... args) const
template<typename ...Args>
inline void info(const format_with_loc &format, Args&&... args) const
template<typename... Args, typename Unique = decltype([]() {  })> inline void info_once (const format_with_loc &format, Args &&... args) const
template<typename... Args, typename Unique = decltype([]() {  })> inline void info_throttle (const rclcpp::Duration &duration, const format_with_loc &format, Args &&... args) const
template<typename T, typename... Args, typename Unique = decltype([]() {  })> inline void info_on_change (const T value, const format_with_loc &format, Args &&... args) const
template<typename TV, typename TT, typename... Args, typename Unique = decltype([]() {  })> inline void info_on_change (const TV &value, const TT &threshold, const format_with_loc &format, Args &&... args) const
template<typename ...Args>
inline void warn(const format_with_loc &format, Args&&... args) const
template<typename... Args, typename Unique = decltype([]() {  })> inline void warn_once (const format_with_loc &format, Args &&... args) const
template<typename... Args, typename Unique = decltype([]() {  })> inline void warn_throttle (const rclcpp::Duration &duration, const format_with_loc &format, Args &&... args) const
template<typename T, typename... Args, typename Unique = decltype([]() {  })> inline void warn_on_change (const T value, const format_with_loc &format, Args &&... args) const
template<typename TV, typename TT, typename... Args, typename Unique = decltype([]() {  })> inline void warn_on_change (const TV &value, const TT &threshold, const format_with_loc &format, Args &&... args) const
template<typename ...Args>
inline void error(const format_with_loc &format, Args&&... args) const
template<typename... Args, typename Unique = decltype([]() {  })> inline void error_once (const format_with_loc &format, Args &&... args) const
template<typename... Args, typename Unique = decltype([]() {  })> inline void error_throttle (const rclcpp::Duration &duration, const format_with_loc &format, Args &&... args) const
template<typename T, typename... Args, typename Unique = decltype([]() {  })> inline void error_on_change (const T value, const format_with_loc &format, Args &&... args) const
template<typename TV, typename TT, typename... Args, typename Unique = decltype([]() {  })> inline void error_on_change (const TV &value, const TT &threshold, const format_with_loc &format, Args &&... args) const
template<typename ...Args>
inline void fatal(const format_with_loc &format, Args&&... args) const
template<typename... Args, typename Unique = decltype([]() {  })> inline void fatal_once (const format_with_loc &format, Args &&... args) const
template<typename... Args, typename Unique = decltype([]() {  })> inline void fatal_throttle (const rclcpp::Duration &duration, const format_with_loc &format, Args &&... args) const
template<typename T, typename... Args, typename Unique = decltype([]() {  })> inline void fatal_on_change (const T value, const format_with_loc &format, Args &&... args) const
template<typename TV, typename TT, typename... Args, typename Unique = decltype([]() {  })> inline void fatal_on_change (const TV &value, const TT &threshold, const format_with_loc &format, Args &&... args) const