Go to the documentation of this file.
   37 #ifndef JSK_PERCEPTION_FISHEYE_TO_PANORAMA_H_ 
   38 #define JSK_PERCEPTION_FISHEYE_TO_PANORAMA_H_ 
   40 #include <jsk_topic_tools/diagnostic_nodelet.h> 
   41 #include <sensor_msgs/Image.h> 
   42 #include <sensor_msgs/CameraInfo.h> 
   48 #include <dynamic_reconfigure/server.h> 
   49 #include <jsk_perception/FisheyeConfig.h> 
   51 #include <opencv2/opencv.hpp> 
   55   class FisheyeToPanorama: 
public jsk_topic_tools::DiagnosticNodelet
 
   60       sensor_msgs::CameraInfo        
 
   62     typedef jsk_perception::FisheyeConfig 
Config;
 
   72     inline double interpolate(
double rate, 
double first, 
double second){
return (1.0 - rate) * first + rate * second;};
 
   73     virtual void rectify(
const sensor_msgs::Image::ConstPtr& image_msg);
 
  
void configCallback(Config &new_config, uint32_t level)
ros::Publisher pub_undistorted_bilinear_image_
boost::shared_ptr< dynamic_reconfigure::Server< Config > > srv_
ros::Publisher pub_undistorted_image_
jsk_perception::FisheyeConfig Config
ros::Subscriber sub_image_
double interpolate(double rate, double first, double second)
virtual ~FisheyeToPanorama()
virtual void unsubscribe()
message_filters::sync_policies::ApproximateTime< sensor_msgs::Image, sensor_msgs::CameraInfo > SyncPolicy
boost::shared_ptr< message_filters::Synchronizer< SyncPolicy > > sync_
virtual void rectify(const sensor_msgs::Image::ConstPtr &image_msg)
jsk_perception
Author(s): Manabu Saito, Ryohei Ueda 
autogenerated on Fri May 16 2025 03:11:17