log_polar_nodelet.h
Go to the documentation of this file.
1 // -*- mode: C++ -*-
2 
3 #ifndef LOG_POLAR_NODELET_H_
4 #define LOG_POLAR_NODELET_H_
5 
7 #include "resized_image_transport/LogPolarConfig.h"
8 
10 {
12  {
13  public:
14  protected:
15  typedef dynamic_reconfigure::Server<LogPolarConfig> ReconfigureServer;
17 
20 
21  protected:
22  void onInit();
23  void initReconfigure();
24  void initParams();
25  void config_cb (LogPolarConfig &config, uint32_t level);
26  void process(const sensor_msgs::ImageConstPtr &src_img, const sensor_msgs::CameraInfoConstPtr &src_info,
27  sensor_msgs::ImagePtr &dst_img, sensor_msgs::CameraInfo &dst_info);
28  };
29 }
30 #endif
void process(const sensor_msgs::ImageConstPtr &src_img, const sensor_msgs::CameraInfoConstPtr &src_info, sensor_msgs::ImagePtr &dst_img, sensor_msgs::CameraInfo &dst_info)
boost::shared_ptr< ReconfigureServer > reconfigure_server_
dynamic_reconfigure::Server< LogPolarConfig > ReconfigureServer
void config_cb(LogPolarConfig &config, uint32_t level)


resized_image_transport
Author(s): Yohei Kakiuchi
autogenerated on Mon May 3 2021 03:03:39