Extractor of metadata from an open LibAV stream. More...
#include <LibavStreamMetadataExtractor.h>

Public Member Functions | |
| cras::optional< std::string > | getCameraMake () override |
| cras::optional< std::string > | getCameraModel () override |
| cras::optional< ros::Time > | getCreationTime () override |
| std::pair< cras::optional< sensor_msgs::NavSatFix >, cras::optional< gps_common::GPSFix > > | getGNSSPosition () 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... | |
| cras::optional< int > | getRotation () override |
| LibavStreamMetadataExtractor (const cras::LogHelperPtr &log, const AVFormatContext *avFormatContext, size_t streamIndex) | |
| Constructor. More... | |
| ~LibavStreamMetadataExtractor () override | |
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 > | 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 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< 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 () |
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::unique_ptr< LibavStreamMetadataPrivate > | data |
| PIMPL. 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 |
Extractor of metadata from an open LibAV stream.
Definition at line 29 of file LibavStreamMetadataExtractor.h.
| movie_publisher::LibavStreamMetadataExtractor::LibavStreamMetadataExtractor | ( | const cras::LogHelperPtr & | log, |
| const AVFormatContext * | avFormatContext, | ||
| size_t | streamIndex | ||
| ) |
Constructor.
| [in] | log | Logger. |
| [in] | avFormatContext | LibAV context of the open movie. |
| [in] | streamIndex | Index of the stream in the open movie. |
|
override |
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
overridevirtual |
|
overridevirtual |
Return the priority of the extractor (for ordering in MetadataManager).
Implements movie_publisher::MetadataExtractor.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
private |
PIMPL.
Definition at line 51 of file LibavStreamMetadataExtractor.h.