Private Types | |
typedef image_proc::RectifyConfig | Config |
typedef dynamic_reconfigure::Server < Config > | ReconfigureServer |
Private Member Functions | |
void | configCb (Config &config, uint32_t level) |
void | connectCb () |
void | imageCb (const sensor_msgs::ImageConstPtr &image_msg, const sensor_msgs::CameraInfoConstPtr &info_msg) |
virtual void | onInit () |
Private Attributes | |
Config | config_ |
boost::recursive_mutex | config_mutex_ |
boost::mutex | connect_mutex_ |
boost::shared_ptr < image_transport::ImageTransport > | it_ |
image_geometry::PinholeCameraModel | model_ |
image_transport::Publisher | pub_rect_ |
int | queue_size_ |
boost::shared_ptr < ReconfigureServer > | reconfigure_server_ |
image_transport::CameraSubscriber | sub_camera_ |
Definition at line 49 of file rectify.cpp.
typedef image_proc::RectifyConfig image_proc::RectifyNodelet::Config [private] |
Definition at line 61 of file rectify.cpp.
typedef dynamic_reconfigure::Server<Config> image_proc::RectifyNodelet::ReconfigureServer [private] |
Definition at line 62 of file rectify.cpp.
void image_proc::RectifyNodelet::configCb | ( | Config & | config, |
uint32_t | level | ||
) | [private] |
Definition at line 151 of file rectify.cpp.
void image_proc::RectifyNodelet::connectCb | ( | ) | [private] |
Definition at line 101 of file rectify.cpp.
void image_proc::RectifyNodelet::imageCb | ( | const sensor_msgs::ImageConstPtr & | image_msg, |
const sensor_msgs::CameraInfoConstPtr & | info_msg | ||
) | [private] |
Definition at line 113 of file rectify.cpp.
void image_proc::RectifyNodelet::onInit | ( | ) | [private, virtual] |
Implements nodelet::Nodelet.
Definition at line 79 of file rectify.cpp.
Config image_proc::RectifyNodelet::config_ [private] |
Definition at line 64 of file rectify.cpp.
boost::recursive_mutex image_proc::RectifyNodelet::config_mutex_ [private] |
Definition at line 60 of file rectify.cpp.
boost::mutex image_proc::RectifyNodelet::connect_mutex_ [private] |
Definition at line 56 of file rectify.cpp.
boost::shared_ptr<image_transport::ImageTransport> image_proc::RectifyNodelet::it_ [private] |
Definition at line 52 of file rectify.cpp.
Definition at line 67 of file rectify.cpp.
Definition at line 57 of file rectify.cpp.
int image_proc::RectifyNodelet::queue_size_ [private] |
Definition at line 54 of file rectify.cpp.
boost::shared_ptr<ReconfigureServer> image_proc::RectifyNodelet::reconfigure_server_ [private] |
Definition at line 63 of file rectify.cpp.
Definition at line 53 of file rectify.cpp.