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

Metadata extractor using lensfun backend. More...

#include <LensfunMetadataExtractor.h>

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

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::TimegetCreationTime ()
 
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< 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< 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 MetadataExtractorConstPtr
 
typedef std::shared_ptr< MetadataExtractorPtr
 
- Protected Attributes inherited from cras::HasLogger
::cras::LogHelperPtr log
 

Detailed Description

Metadata extractor using lensfun backend.

The extractor reads the following ROS parameters:

Definition at line 34 of file LensfunMetadataExtractor.h.

Constructor & Destructor Documentation

◆ LensfunMetadataExtractor()

movie_publisher::LensfunMetadataExtractor::LensfunMetadataExtractor ( const cras::LogHelperPtr log,
const std::weak_ptr< MetadataManager > &  manager,
size_t  width,
size_t  height,
bool  isStillImage,
const std::string &  extraDb = "" 
)
explicit

Constructor.

Parameters
[in]logLogger.
[in]managerMetadata manager.
[in]widthWidth of the movie [px].
[in]heightHeight of the movie [px].
[in]isStillImageWhether the movie is a still image (just one frame) or not.
[in]extraDbIf nonempty, the specified file or directory will be loaded as an additional lensfun database directory.

◆ ~LensfunMetadataExtractor()

movie_publisher::LensfunMetadataExtractor::~LensfunMetadataExtractor ( )
override

Member Function Documentation

◆ getCropFactor()

cras::optional<double> movie_publisher::LensfunMetadataExtractor::getCropFactor ( )
overridevirtual

◆ getDistortion()

cras::optional<std::pair<DistortionType, Distortion> > movie_publisher::LensfunMetadataExtractor::getDistortion ( )
overridevirtual

◆ getFocalLengthMM()

cras::optional<double> movie_publisher::LensfunMetadataExtractor::getFocalLengthMM ( )
overridevirtual

◆ getName()

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

◆ getPriority()

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

◆ getSensorSizeMM()

cras::optional<std::pair<double, double> > movie_publisher::LensfunMetadataExtractor::getSensorSizeMM ( )
overridevirtual

◆ warnIfDbOld()

void movie_publisher::LensfunMetadataExtractor::warnIfDbOld ( lfDatabase *  db)

Print a warning if the lensfun database is considered old and should be updated.

Parameters
[in]dbThe lensfun database.

Member Data Documentation

◆ data

std::unique_ptr<LensfunMetadataPrivate> movie_publisher::LensfunMetadataExtractor::data
private

PIMPL.

Definition at line 66 of file LensfunMetadataExtractor.h.


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


lensfun_metadata_extractor
Author(s): Martin Pecka
autogenerated on Wed May 28 2025 02:07:36