Go to the documentation of this file.
20 #include <compass_msgs/Azimuth.h>
23 #include <geometry_msgs/Transform.h>
27 #include <sensor_msgs/CameraInfo.h>
28 #include <sensor_msgs/Imu.h>
29 #include <sensor_msgs/MagneticField.h>
30 #include <vision_msgs/Detection2DArray.h>
36 struct CachingMetadataListener;
46 return lhs->getPriority() < rhs->getPriority();
81 void addExtractor(
const std::shared_ptr<MetadataExtractor>& extractor);
93 std::shared_ptr<MetadataCache>
getCache();
102 const std::unordered_set<MetadataType>& availableMetadata)
const override;
108 std::string
getName()
const override;
116 cras::optional<std::string>
getLensMake()
override;
126 cras::optional<std::pair<DistortionType, Distortion>>
getDistortion()
override;
129 cras::optional<compass_msgs::Azimuth>
getAzimuth()
override;
133 cras::optional<vision_msgs::Detection2DArray>
getFaces()
override;
134 cras::optional<sensor_msgs::CameraInfo>
getCameraInfo()
override;
135 cras::optional<sensor_msgs::Imu>
getImu()
override;
157 template<
typename T,
typename O = cras::optional<T>>
162 std::multiset<MetadataExtractor::Ptr, PriorityComparator>
extractors;
163 std::multiset<TimedMetadataExtractor::Ptr, PriorityComparator>
timedExtractors;
165 std::deque<std::pair<std::string, const MetadataExtractor*>>
callStack;
171 std::shared_ptr<MetadataCache>
cache;
std::pair< cras::optional< sensor_msgs::NavSatFix >, cras::optional< gps_common::GPSFix > > GNSSFixAndDetail
Configuration specifying what movie file to open and how.
std::string fn
The called function.
std::string getStackDescription() const
Get a human-readable representation of the whole call stack.
Time type denoting movie stream time.
RAII guard saving a function call to stack. Can be used to protect against infinite recursion.
decltype(MetadataManager::callStack) & stack
The stack to operate on.
std::shared_ptr< const MovieInfo > ConstPtr
::cras::LogHelper::Ptr LogHelperPtr
const MetadataExtractor * extractor
The extractor that calls the function.
StackGuard(decltype(MetadataManager::callStack)&stack, const std::string &fn, const MetadataExtractor *extractor)
Constructor.
bool operator()(const MetadataExtractor::ConstPtr &lhs, const MetadataExtractor::ConstPtr &rhs) const
MetadataType
Enum for supported metadata.
movie_publisher
Author(s): Martin Pecka
autogenerated on Wed May 28 2025 02:07:22