Manager of multiple image metadata providers which can cooperate in parsing. More...
#include "metadata_extractor.h"#include <deque>#include <memory>#include <set>#include <string>#include <utility>#include <compass_msgs/Azimuth.h>#include <cras_cpp_common/log_utils.h>#include <cras_cpp_common/optional.hpp>#include <geometry_msgs/Transform.h>#include <movie_publisher/metadata_cache.h>#include <pluginlib/class_loader.hpp>#include <ros/time.h>#include <sensor_msgs/CameraInfo.h>#include <sensor_msgs/Imu.h>#include <sensor_msgs/MagneticField.h>#include <vision_msgs/Detection2DArray.h>

Go to the source code of this file.
Classes | |
| class | movie_publisher::MetadataManager |
| Manager of multiple image metadata providers which can cooperate in parsing. More... | |
| struct | movie_publisher::PriorityComparator |
| class | movie_publisher::StackGuard |
| RAII guard saving a function call to stack. Can be used to protect against infinite recursion. More... | |
Namespaces | |
| movie_publisher | |
Manager of multiple image metadata providers which can cooperate in parsing.
Definition in file metadata_manager.h.