31 #define DEFAULT_LOGGER "ensenso_camera" 38 #include "rclcpp/rclcpp.hpp" 40 template <
typename... T>
46 template <
typename... T>
49 RCLCPP_DEBUG(nh->get_logging_interface()->get_logger(), arg,
args...);
52 template <
typename... T>
55 RCLCPP_DEBUG(rclcpp::get_logger(name),
args...);
58 template <
typename... T>
64 template <
typename... T>
67 RCLCPP_DEBUG_ONCE(nh->get_logging_interface()->get_logger(), arg,
args...);
73 template <
typename... T>
79 template <
typename... T>
86 template <
typename... T>
92 template <
typename... T>
98 template <
typename... T>
111 template <
typename... T>
117 template <
typename... T>
120 RCLCPP_INFO(nh->get_logging_interface()->get_logger(), arg,
args...);
123 template <
typename... T>
126 RCLCPP_INFO(rclcpp::get_logger(name),
args...);
129 template <
typename... T>
135 template <
typename... T>
138 RCLCPP_INFO_ONCE(nh->get_logging_interface()->get_logger(), arg,
args...);
141 template <
typename... T>
147 template <
typename... T>
154 template <
typename... T>
160 template <
typename... T>
166 template <
typename... T>
179 template <
typename... T>
185 template <
typename... T>
188 RCLCPP_WARN(nh->get_logging_interface()->get_logger(), arg,
args...);
191 template <
typename... T>
194 RCLCPP_WARN(rclcpp::get_logger(name),
args...);
197 template <
typename... T>
203 template <
typename... T>
206 RCLCPP_WARN_ONCE(nh->get_logging_interface()->get_logger(), arg,
args...);
209 template <
typename... T>
215 template <
typename... T>
222 template <
typename... T>
228 template <
typename... T>
234 template <
typename... T>
247 template <
typename... T>
253 template <
typename... T>
256 RCLCPP_ERROR(nh->get_logging_interface()->get_logger(), arg,
args...);
259 template <
typename... T>
262 RCLCPP_ERROR(rclcpp::get_logger(name),
args...);
265 template <
typename... T>
271 template <
typename... T>
274 RCLCPP_ERROR_ONCE(nh->get_logging_interface()->get_logger(), arg,
args...);
277 template <
typename... T>
283 template <
typename... T>
290 template <
typename... T>
296 template <
typename... T>
302 template <
typename... T>
void ENSENSO_WARN_ONCE(T... args)
void ENSENSO_ERROR(T... args)
void ENSENSO_DEBUG(T... args)
#define ROS_INFO_NAMED(name,...)
void ENSENSO_INFO(T... args)
#define ROS_WARN_NAMED(name,...)
#define ROS_INFO_ONCE(...)
void ENSENSO_INFO_NAMED(std::string name, T... args)
#define ROS_DEBUG_ONCE(...)
void ENSENSO_ERROR_NAMED(std::string name, T... args)
void ENSENSO_ERROR_ONCE(T... args)
void ENSENSO_INFO_ONCE(T... args)
#define ROS_DEBUG_NAMED(name,...)
#define ROS_WARN_ONCE(...)
void ENSENSO_DEBUG_ONCE(T... args)
#define ROS_ERROR_ONCE(...)
void ENSENSO_DEBUG_NAMED(std::string name, T... args)
void ENSENSO_WARN_NAMED(std::string name, T... args)
::ros::NodeHandle NodeHandle
void ENSENSO_WARN(T... args)
#define ROS_ERROR_NAMED(name,...)