Extractor of metadata from filesystem properties of the movie file. More...
#include <FileMetadataExtractor.h>
Public Member Functions | |
FileMetadataExtractor (const cras::LogHelperPtr &log, const std::string &filename) | |
Constructor. More... | |
cras::optional< ros::Time > | getCreationTime () 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... | |
![]() | |
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< DistortionData > | getDistortion () |
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< IntrinsicMatrix > | getIntrinsicMatrix () |
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< RollPitch > | getRollPitch () |
virtual cras::optional< int > | getRotation () |
virtual cras::optional< SensorSize > | getSensorSizeMM () |
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 () |
![]() | |
::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 | |
![]() | |
using | ConstPtr = std::shared_ptr< const MetadataExtractor > |
using | Ptr = std::shared_ptr< MetadataExtractor > |
![]() | |
::cras::LogHelperPtr | log |
Extractor of metadata from filesystem properties of the movie file.
Definition at line 23 of file FileMetadataExtractor.h.
movie_publisher::FileMetadataExtractor::FileMetadataExtractor | ( | const cras::LogHelperPtr & | log, |
const std::string & | filename | ||
) |
Constructor.
[in] | log | Logger. |
[in] | filename | Filename of the movie. |
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
overridevirtual |
|
overridevirtual |
Return the priority of the extractor (for ordering in MetadataManager).
Implements movie_publisher::MetadataExtractor.
|
private |
Filename of the movie.
Definition at line 38 of file FileMetadataExtractor.h.