#include <ros/ros.h>#include "opencv_apps/nodelet.h"#include <image_transport/image_transport.h>#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/image_encodings.h>#include <opencv2/highgui/highgui.hpp>#include <opencv2/imgproc/imgproc.hpp>#include <dynamic_reconfigure/server.h>#include "opencv_apps/PhaseCorrConfig.h"#include "opencv_apps/Point2DStamped.h"#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
Classes | |
| class | phase_corr::PhaseCorrNodelet |
| class | opencv_apps::PhaseCorrNodelet |
Namespaces | |
| opencv_apps | |
| Demo code to calculate moments. | |
| phase_corr | |
Functions | |
| PLUGINLIB_EXPORT_CLASS (opencv_apps::PhaseCorrNodelet, nodelet::Nodelet) | |
| PLUGINLIB_EXPORT_CLASS (phase_corr::PhaseCorrNodelet, nodelet::Nodelet) | |
| PLUGINLIB_EXPORT_CLASS | ( | opencv_apps::PhaseCorrNodelet | , |
| nodelet::Nodelet | |||
| ) |
| PLUGINLIB_EXPORT_CLASS | ( | phase_corr::PhaseCorrNodelet | , |
| nodelet::Nodelet | |||
| ) |