#include "genicam_camera_nodelet.h"
#include "timestamp_corrector.h"
#include <rc_genicam_api/device.h>
#include <rc_genicam_api/stream.h>
#include <rc_genicam_api/buffer.h>
#include <rc_genicam_api/config.h>
#include <rc_genicam_api/pixel_formats.h>
#include <pluginlib/class_list_macros.h>
#include <exception>
#include <fstream>
#include <sstream>
#include <stdexcept>
#include <cctype>
#include <ros/ros.h>
#include <sensor_msgs/image_encodings.h>
Go to the source code of this file.
|
#define | ROS_HAS_STEADYTIME (ROS_VERSION_MINIMUM(1, 13, 1) || ((ROS_VERSION_MINOR == 12) && ROS_VERSION_PATCH >= 8)) |
|
◆ ROS_HAS_STEADYTIME
#define ROS_HAS_STEADYTIME (ROS_VERSION_MINIMUM(1, 13, 1) || ((ROS_VERSION_MINOR == 12) && ROS_VERSION_PATCH >= 8)) |