Private Types | |
typedef image_proc::CropDecimateConfig | 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_in_ |
boost::shared_ptr < image_transport::ImageTransport > | it_out_ |
image_transport::CameraPublisher | pub_ |
int | queue_size_ |
boost::shared_ptr < ReconfigureServer > | reconfigure_server_ |
image_transport::CameraSubscriber | sub_ |
Definition at line 14 of file crop_decimate.cpp.
typedef image_proc::CropDecimateConfig image_proc::CropDecimateNodelet::Config [private] |
Definition at line 26 of file crop_decimate.cpp.
typedef dynamic_reconfigure::Server<Config> image_proc::CropDecimateNodelet::ReconfigureServer [private] |
Definition at line 27 of file crop_decimate.cpp.
void image_proc::CropDecimateNodelet::configCb | ( | Config & | config, |
uint32_t | level | ||
) | [private] |
Definition at line 299 of file crop_decimate.cpp.
void image_proc::CropDecimateNodelet::connectCb | ( | ) | [private] |
Definition at line 67 of file crop_decimate.cpp.
void image_proc::CropDecimateNodelet::imageCb | ( | const sensor_msgs::ImageConstPtr & | image_msg, |
const sensor_msgs::CameraInfoConstPtr & | info_msg | ||
) | [private] |
Definition at line 132 of file crop_decimate.cpp.
void image_proc::CropDecimateNodelet::onInit | ( | ) | [private, virtual] |
Implements nodelet::Nodelet.
Definition at line 41 of file crop_decimate.cpp.
Definition at line 29 of file crop_decimate.cpp.
boost::recursive_mutex image_proc::CropDecimateNodelet::config_mutex_ [private] |
Definition at line 25 of file crop_decimate.cpp.
boost::mutex image_proc::CropDecimateNodelet::connect_mutex_ [private] |
Definition at line 21 of file crop_decimate.cpp.
boost::shared_ptr<image_transport::ImageTransport> image_proc::CropDecimateNodelet::it_in_ [private] |
Definition at line 17 of file crop_decimate.cpp.
boost::shared_ptr<image_transport::ImageTransport> image_proc::CropDecimateNodelet::it_out_ [private] |
Definition at line 17 of file crop_decimate.cpp.
Definition at line 22 of file crop_decimate.cpp.
int image_proc::CropDecimateNodelet::queue_size_ [private] |
Definition at line 19 of file crop_decimate.cpp.
boost::shared_ptr<ReconfigureServer> image_proc::CropDecimateNodelet::reconfigure_server_ [private] |
Definition at line 28 of file crop_decimate.cpp.
Definition at line 18 of file crop_decimate.cpp.