Public Member Functions | Private Attributes | List of all members
movie_publisher::FilenameMetadataExtractor Class Reference

Extractor of metadata from filename. More...

#include <FilenameMetadataExtractor.h>

Inheritance diagram for movie_publisher::FilenameMetadataExtractor:
Inheritance graph
[legend]

Public Member Functions

 FilenameMetadataExtractor (const cras::LogHelperPtr &log, const std::string &filename)
 Constructor. More...
 
cras::optional< ros::TimegetCreationTime () override
 
std::string getName () const override
 Return the name of the extractor. More...
 
int getPriority () const override
 Return the priority of the extractor (for ordering in MetadataManager). More...
 
- Public Member Functions inherited from movie_publisher::MetadataExtractor
virtual cras::optional< geometry_msgs::Vector3 > getAcceleration ()
 
virtual cras::optional< geometry_msgs::Vector3 > getAngularVelocity ()
 
virtual cras::optional< compass_msgs::Azimuth > getAzimuth ()
 
virtual cras::optional< std::string > getCameraGeneralName ()
 
virtual cras::optional< sensor_msgs::CameraInfo > getCameraInfo ()
 
virtual cras::optional< std::string > getCameraMake ()
 
virtual cras::optional< std::string > getCameraModel ()
 
virtual cras::optional< std::string > getCameraSerialNumber ()
 
virtual cras::optional< std::string > getCameraUniqueName ()
 
virtual cras::optional< double > getCropFactor ()
 
virtual cras::optional< DistortionDatagetDistortion ()
 
virtual cras::optional< vision_msgs::Detection2DArray > getFaces ()
 
virtual cras::optional< double > getFocalLength35MM ()
 
virtual cras::optional< double > getFocalLengthMM ()
 
virtual cras::optional< double > getFocalLengthPx ()
 
virtual GNSSFixAndDetail getGNSSPosition ()
 
virtual cras::optional< sensor_msgs::Imu > getImu ()
 
virtual cras::optional< IntrinsicMatrixgetIntrinsicMatrix ()
 
virtual cras::optional< std::string > getLensMake ()
 
virtual cras::optional< std::string > getLensModel ()
 
virtual cras::optional< sensor_msgs::MagneticField > getMagneticField ()
 
virtual cras::optional< geometry_msgs::Transform > getOpticalFrameTF ()
 
virtual cras::optional< RollPitchgetRollPitch ()
 
virtual cras::optional< intgetRotation ()
 
virtual cras::optional< SensorSizegetSensorSizeMM ()
 
virtual cras::optional< geometry_msgs::Transform > getZeroRollPitchTF ()
 
 MetadataExtractor (const cras::LogHelperPtr &log)
 Constructor. More...
 
virtual void processPacket (const AVPacket *packet)
 Optional processing of libav packets as they are read from the movie file. More...
 
virtual ~MetadataExtractor ()
 
- Public Member Functions inherited from cras::HasLogger
::cras::LogHelperConstPtr getCrasLogger () const
 
 HasLogger (const ::cras::LogHelperPtr &log)
 
void setCrasLogger (const ::cras::LogHelperPtr &log)
 

Private Attributes

std::string filename
 Filename of the movie. More...
 

Additional Inherited Members

- Public Types inherited from movie_publisher::MetadataExtractor
using ConstPtr = std::shared_ptr< const MetadataExtractor >
 
using Ptr = std::shared_ptr< MetadataExtractor >
 
- Protected Attributes inherited from cras::HasLogger
::cras::LogHelperPtr log
 

Detailed Description

Extractor of metadata from filename.

Definition at line 23 of file FilenameMetadataExtractor.h.

Constructor & Destructor Documentation

◆ FilenameMetadataExtractor()

movie_publisher::FilenameMetadataExtractor::FilenameMetadataExtractor ( const cras::LogHelperPtr log,
const std::string &  filename 
)

Constructor.

Parameters
[in]logLogger.
[in]filenameFilename of the movie.

Member Function Documentation

◆ getCreationTime()

cras::optional<ros::Time> movie_publisher::FilenameMetadataExtractor::getCreationTime ( )
overridevirtual
Returns
The global time corresponding to the first frame of the movie stream.

Reimplemented from movie_publisher::MetadataExtractor.

◆ getName()

std::string movie_publisher::FilenameMetadataExtractor::getName ( ) const
overridevirtual

Return the name of the extractor.

Returns
The name.

Implements movie_publisher::MetadataExtractor.

◆ getPriority()

int movie_publisher::FilenameMetadataExtractor::getPriority ( ) const
overridevirtual

Return the priority of the extractor (for ordering in MetadataManager).

Returns
The priority. Lower values have more priority. Usually between 0 and 100.

Implements movie_publisher::MetadataExtractor.

Member Data Documentation

◆ filename

std::string movie_publisher::FilenameMetadataExtractor::filename
private

Filename of the movie.

Definition at line 38 of file FilenameMetadataExtractor.h.


The documentation for this class was generated from the following file:


movie_publisher
Author(s): Martin Pecka
autogenerated on Wed May 28 2025 02:07:22