#include <unordered_map>#include <cv_bridge/cv_bridge.h>#include <geometry_msgs/Transform.h>#include <image_transport/image_transport.h>#include <ros/ros.h>#include <sensor_msgs/CameraInfo.h>#include <sensor_msgs/Image.h>#include <sensor_msgs/distortion_models.h>#include <sensor_msgs/image_encodings.h>#include <tf2/LinearMath/Quaternion.h>#include <clpe_ros_msgs/ClpeCameraInfo.h>#include "errors.hpp"

Go to the source code of this file.
Classes | |
| class | clpe::ClpeNode< ClpeClientApi > |
Namespaces | |
| clpe | |
Enumerations | |
| enum | clpe::CalibrationModel : uint32_t { clpe::CalibrationModel::Jhang = 0, clpe::CalibrationModel::FishEye = 1 } |
Functions | |
| static constexpr std::array< const char *, 7 > | clpe::kSupportedEncodings ({ "bgr8", "bgra8", "rgb8", "rgba8", "mono16", "jpeg", "yuv422", }) |
| static constexpr std::array< const char *, 2 > | clpe::kSupportedSlaves ({ "y", "n", }) |
| static constexpr std::array< const char *, 2 > | clpe::kSupportedTimeStamps ({ "xavier", "local", }) |
Variables | |
| static int | clpe::caminfo = 0 |
| static int | clpe::image_height = 0 |
| static int | clpe::image_width = 0 |
| static constexpr const char * | clpe::kCamBaseFrame [] |
| static constexpr const char * | clpe::kCamEnable [] |
| static constexpr const char * | clpe::kCamInfoLatch [] |
| static constexpr const char * | clpe::kCamInfoQueueSize [] |
| static constexpr const char * | clpe::kCamLatch [] |
| static constexpr const char * | clpe::kCamPose [] |
| static constexpr const char * | clpe::kCamQueueSize [] |
| static constexpr const char * | clpe::kEncoding = "encoding" |
| static constexpr const char * | clpe::kPassword = "password" |
| static constexpr const char * | clpe::kSlave = "slave" |
| static constexpr const char * | clpe::kTimeStamp = "timestamp" |