Go to the documentation of this file.
15 #include <unordered_set>
19 #include <compass_msgs/Azimuth.h>
23 #include <geometry_msgs/Transform.h>
24 #include <geometry_msgs/TransformStamped.h>
25 #include <geometry_msgs/Vector3.h>
26 #include <gps_common/GPSFix.h>
32 #include <sensor_msgs/CameraInfo.h>
33 #include <sensor_msgs/Imu.h>
34 #include <sensor_msgs/MagneticField.h>
35 #include <sensor_msgs/NavSatFix.h>
36 #include <vision_msgs/Detection2DArray.h>
38 class AVFormatContext;
44 class MetadataManager;
56 std::shared_ptr<MetadataCache>
cache;
79 using Ptr = std::shared_ptr<MetadataExtractor>;
80 using ConstPtr = std::shared_ptr<const MetadataExtractor>;
93 virtual std::string
getName()
const = 0;
124 virtual cras::optional<std::string>
getCameraMake() {
return cras::nullopt; }
132 virtual cras::optional<std::string>
getLensMake() {
return cras::nullopt; }
136 virtual cras::optional<std::string>
getLensModel() {
return cras::nullopt; }
140 virtual cras::optional<int>
getRotation() {
return cras::nullopt; }
172 virtual cras::optional<DistortionData>
getDistortion() {
return cras::nullopt; }
180 virtual cras::optional<compass_msgs::Azimuth>
getAzimuth() {
return cras::nullopt; }
184 virtual cras::optional<sensor_msgs::MagneticField>
getMagneticField() {
return cras::nullopt; }
188 virtual cras::optional<RollPitch>
getRollPitch() {
return cras::nullopt; }
192 virtual cras::optional<geometry_msgs::Vector3>
getAcceleration() {
return cras::nullopt; }
200 virtual cras::optional<vision_msgs::Detection2DArray>
getFaces() {
return cras::nullopt; }
205 virtual cras::optional<sensor_msgs::CameraInfo>
getCameraInfo() {
return cras::nullopt; }
210 virtual cras::optional<sensor_msgs::Imu>
getImu() {
return cras::nullopt; }
260 using Ptr = std::shared_ptr<TimedMetadataListener>;
261 using ConstPtr = std::shared_ptr<const TimedMetadataListener>;
389 using Ptr = std::shared_ptr<TimedMetadataExtractor>;
390 using ConstPtr = std::shared_ptr<const TimedMetadataExtractor>;
423 const std::unordered_set<MetadataType>& availableMetadata)
const = 0;
std::pair< cras::optional< sensor_msgs::NavSatFix >, cras::optional< gps_common::GPSFix > > GNSSFixAndDetail
Configuration specifying what movie file to open and how.
Basic information about an open movie.
Time type denoting movie stream time.
Configuration specifying what movie file to open and how.
std::shared_ptr< const MovieInfo > ConstPtr
::cras::LogHelper::Ptr LogHelperPtr
MetadataType
Enum for supported metadata.
movie_publisher
Author(s): Martin Pecka
autogenerated on Wed May 28 2025 02:07:22