Go to the documentation of this file.
48 #ifndef UEYE_CAM_NODELET_HPP_
49 #define UEYE_CAM_NODELET_HPP_
53 #include <dynamic_reconfigure/server.h>
55 #include <sensor_msgs/Image.h>
56 #include <sensor_msgs/CameraInfo.h>
57 #include <sensor_msgs/SetCameraInfo.h>
58 #include <ueye_cam/UEyeCamConfig.h>
59 #include <boost/thread/mutex.hpp>
104 void configCallback(ueye_cam::UEyeCamConfig& config, uint32_t level);
112 virtual INT
syncCamConfig(std::string dft_mode_str =
"mono8");
141 bool setCamInfo(sensor_msgs::SetCameraInfo::Request& req,
142 sensor_msgs::SetCameraInfo::Response& rsp);
constexpr static int DEFAULT_IMAGE_HEIGHT
ueye_cam::UEyeCamConfig cam_params_
sensor_msgs::Image ros_image_
boost::recursive_mutex ros_cfg_mutex_
ros::Time getImageTickTimestamp()
virtual void handleTimeout()
virtual ~UEyeCamNodelet()
constexpr static int DEFAULT_IMAGE_WIDTH
constexpr static double DEFAULT_FRAME_RATE
const static std::map< INT, std::string > ENCODING_DICTIONARY
uint64_t prev_output_frame_idx_
boost::mutex output_rate_mutex_
ros::Time init_publish_time_
virtual INT syncCamConfig(std::string dft_mode_str="mono8")
std::string timeout_topic_
constexpr static double DEFAULT_EXPOSURE
ReconfigureServer * ros_cfg_
constexpr static unsigned int RECONFIGURE_RUNNING
unsigned long long int timeout_count_
const static std::string DEFAULT_COLOR_MODE
unsigned int ros_frame_count_
sensor_msgs::CameraInfo ros_cam_info_
std::string cam_intr_filename_
ros::Publisher timeout_pub_
std::string cam_params_filename_
constexpr static unsigned int RECONFIGURE_CLOSE
dynamic_reconfigure::Server< ueye_cam::UEyeCamConfig > ReconfigureServer
std::thread frame_grab_thread_
void configCallback(ueye_cam::UEyeCamConfig &config, uint32_t level)
constexpr static int DEFAULT_PIXEL_CLOCK
ros::ServiceServer set_cam_info_srv_
const static std::string DEFAULT_FRAME_NAME
bool fillMsgData(sensor_msgs::Image &img) const
const static std::string DEFAULT_TIMEOUT_TOPIC
uint64_t init_clock_tick_
bool setCamInfo(sensor_msgs::SetCameraInfo::Request &req, sensor_msgs::SetCameraInfo::Response &rsp)
constexpr static int DEFAULT_FLASH_DURATION
const static std::string DEFAULT_CAMERA_TOPIC
INT parseROSParams(ros::NodeHandle &local_nh)
image_transport::CameraPublisher ros_cam_pub_
constexpr static unsigned int RECONFIGURE_STOP
virtual INT disconnectCam()
ros::Time getImageTimestamp()
const static std::string DEFAULT_CAMERA_NAME
void loadIntrinsicsFile()
bool saveIntrinsicsFile()
ueye_cam
Author(s): Anqi Xu
autogenerated on Tue Mar 8 2022 03:50:09