Metadata extractor using lensfun backend. More...
#include <LensfunMetadataExtractor.h>

Public Member Functions | |
| cras::optional< double > | getCropFactor () override |
| cras::optional< std::pair< DistortionType, Distortion > > | getDistortion () override |
| cras::optional< double > | getFocalLengthMM () override |
| std::string | getName () const override |
| int | getPriority () const override |
| cras::optional< std::pair< double, double > > | getSensorSizeMM () override |
| LensfunMetadataExtractor (const cras::LogHelperPtr &log, const std::weak_ptr< MetadataManager > &manager, size_t width, size_t height, bool isStillImage, const std::string &extraDb="") | |
| Constructor. More... | |
| void | warnIfDbOld (lfDatabase *db) |
| Print a warning if the lensfun database is considered old and should be updated. More... | |
| ~LensfunMetadataExtractor () 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 > | getCameraMake () |
| virtual cras::optional< std::string > | getCameraModel () |
| virtual cras::optional< std::string > | getCameraSerialNumber () |
| virtual cras::optional< std::string > | getCameraUniqueName () |
| virtual cras::optional< ros::Time > | getCreationTime () |
| virtual cras::optional< vision_msgs::Detection2DArray > | getFaces () |
| virtual cras::optional< double > | getFocalLength35MM () |
| 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< geometry_msgs::Transform > | getZeroRollPitchTF () |
| MetadataExtractor (const cras::LogHelperPtr &log) | |
| virtual void | processPacket (const AVPacket *packet) |
| 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< LensfunMetadataPrivate > | data |
| PIMPL. More... | |
Additional Inherited Members | |
Public Types inherited from movie_publisher::MetadataExtractor | |
| typedef std::shared_ptr< const MetadataExtractor > | ConstPtr |
| typedef std::shared_ptr< MetadataExtractor > | Ptr |
Protected Attributes inherited from cras::HasLogger | |
| ::cras::LogHelperPtr | log |
Metadata extractor using lensfun backend.
The extractor reads the following ROS parameters:
~lensfun_extra_db (string, optional): If nonempty, the specified file or directory will be loaded as an additional lensfun database directory. Definition at line 34 of file LensfunMetadataExtractor.h.
|
explicit |
Constructor.
| [in] | log | Logger. |
| [in] | manager | Metadata manager. |
| [in] | width | Width of the movie [px]. |
| [in] | height | Height of the movie [px]. |
| [in] | isStillImage | Whether the movie is a still image (just one frame) or not. |
| [in] | extraDb | If nonempty, the specified file or directory will be loaded as an additional lensfun database directory. |
|
override |
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
overridevirtual |
Implements movie_publisher::MetadataExtractor.
|
overridevirtual |
Implements movie_publisher::MetadataExtractor.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
| void movie_publisher::LensfunMetadataExtractor::warnIfDbOld | ( | lfDatabase * | db | ) |
Print a warning if the lensfun database is considered old and should be updated.
| [in] | db | The lensfun database. |
|
private |
PIMPL.
Definition at line 66 of file LensfunMetadataExtractor.h.