#include "jsk_perception/morphological_operator.h"#include <boost/assign.hpp>#include <jsk_topic_tools/log_utils.h>#include <cv_bridge/cv_bridge.h>#include <opencv2/opencv.hpp>#include <sensor_msgs/image_encodings.h>#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
Namespaces | |
| jsk_perception | |
| PLUGINLIB_EXPORT_CLASS | ( | jsk_perception::Dilate | , |
| nodelet::Nodelet | |||
| ) |
| PLUGINLIB_EXPORT_CLASS | ( | jsk_perception::Erode | , |
| nodelet::Nodelet | |||
| ) |
| PLUGINLIB_EXPORT_CLASS | ( | jsk_perception::Opening | , |
| nodelet::Nodelet | |||
| ) |
| PLUGINLIB_EXPORT_CLASS | ( | jsk_perception::Closing | , |
| nodelet::Nodelet | |||
| ) |
| PLUGINLIB_EXPORT_CLASS | ( | jsk_perception::MorphologicalGradient | , |
| nodelet::Nodelet | |||
| ) |
| PLUGINLIB_EXPORT_CLASS | ( | jsk_perception::TopHat | , |
| nodelet::Nodelet | |||
| ) |
| PLUGINLIB_EXPORT_CLASS | ( | jsk_perception::BlackHat | , |
| nodelet::Nodelet | |||
| ) |