Common base for all metadata extractors that utilize EXIF data. More...
#include <ExifBaseMetadataExtractor.h>
Public Member Functions | |
ExifBaseMetadataExtractor (const cras::LogHelperPtr &log, const std::weak_ptr< MetadataManager > &manager, size_t width, size_t height) | |
Constructor. More... | |
cras::optional< geometry_msgs::Vector3 > | getAcceleration () override |
cras::optional< compass_msgs::Azimuth > | getAzimuth () override |
cras::optional< std::string > | getCameraMake () override |
cras::optional< std::string > | getCameraModel () override |
cras::optional< std::string > | getCameraSerialNumber () override |
cras::optional< ros::Time > | getCreationTime () override |
cras::optional< double > | getCropFactor () override |
cras::optional< double > | getFocalLength35MM () override |
cras::optional< double > | getFocalLengthMM () override |
std::pair< cras::optional< sensor_msgs::NavSatFix >, cras::optional< gps_common::GPSFix > > | getGNSSPosition () override |
cras::optional< std::string > | getLensMake () override |
cras::optional< std::string > | getLensModel () override |
cras::optional< std::pair< double, double > > | getRollPitch () override |
cras::optional< int > | getRotation () override |
cras::optional< std::pair< double, double > > | getSensorSizeMM () override |
~ExifBaseMetadataExtractor () override | |
![]() | |
virtual cras::optional< geometry_msgs::Vector3 > | getAngularVelocity () |
virtual cras::optional< std::string > | getCameraGeneralName () |
virtual cras::optional< sensor_msgs::CameraInfo > | getCameraInfo () |
virtual cras::optional< std::string > | getCameraUniqueName () |
virtual cras::optional< DistortionData > | getDistortion () |
virtual cras::optional< vision_msgs::Detection2DArray > | getFaces () |
virtual cras::optional< double > | getFocalLengthPx () |
virtual cras::optional< sensor_msgs::Imu > | getImu () |
virtual cras::optional< IntrinsicMatrix > | getIntrinsicMatrix () |
virtual cras::optional< sensor_msgs::MagneticField > | getMagneticField () |
virtual std::string | getName () const =0 |
Return the name of the extractor. More... | |
virtual cras::optional< geometry_msgs::Transform > | getOpticalFrameTF () |
virtual int | getPriority () const =0 |
Return the priority of the extractor (for ordering in MetadataManager). More... | |
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) |
Protected Member Functions | |
compass_conversions::CompassConverter & | getCompassConverter () |
Get a helper for converting various azimuth representations and references. More... | |
virtual cras::optional< ExifData< ExifSRational > > | getExifAcceleration (size_t n) |
virtual cras::optional< ExifData< ExifAscii > > | getExifBodySerialNumber () |
virtual cras::optional< ExifData< ExifAscii > > | getExifDateTimeOriginal () |
virtual cras::optional< ExifData< ExifRational > > | getExifFocalLength () |
virtual cras::optional< ExifData< ExifShort > > | getExifFocalLength35MM () |
virtual cras::optional< ExifData< ExifShort > > | getExifFocalPlaneResUnit () |
virtual cras::optional< ExifData< ExifRational > > | getExifFocalPlaneXRes () |
virtual cras::optional< ExifData< ExifRational > > | getExifFocalPlaneYRes () |
virtual cras::optional< ExifData< ExifRational > > | getExifGpsAlt () |
virtual cras::optional< ExifData< ExifByte > > | getExifGpsAltRef () |
virtual cras::optional< ExifData< ExifAscii > > | getExifGpsDateStamp () |
virtual cras::optional< ExifData< ExifShort > > | getExifGpsDifferential () |
virtual cras::optional< ExifData< ExifRational > > | getExifGpsDOP () |
virtual cras::optional< ExifData< ExifRational > > | getExifGpsHPositioningError () |
virtual cras::optional< ExifData< ExifRational > > | getExifGpsImgDirection () |
virtual cras::optional< ExifData< ExifAscii > > | getExifGpsImgDirectionRef () |
virtual cras::optional< ExifData< ExifRational > > | getExifGpsLat (size_t n) |
virtual cras::optional< ExifData< ExifAscii > > | getExifGpsLatRef () |
virtual cras::optional< ExifData< ExifRational > > | getExifGpsLon (size_t n) |
virtual cras::optional< ExifData< ExifAscii > > | getExifGpsLonRef () |
virtual cras::optional< ExifData< ExifAscii > > | getExifGpsMeasureMode () |
virtual cras::optional< ExifData< ExifRational > > | getExifGpsSpeed () |
virtual cras::optional< ExifData< ExifAscii > > | getExifGpsSpeedRef () |
virtual cras::optional< ExifData< ExifRational > > | getExifGpsTimeStamp (size_t n) |
virtual cras::optional< ExifData< ExifRational > > | getExifGpsTrack () |
virtual cras::optional< ExifData< ExifAscii > > | getExifGpsTrackRef () |
virtual cras::optional< ExifData< ExifAscii > > | getExifLensMake () |
virtual cras::optional< ExifData< ExifAscii > > | getExifLensModel () |
virtual cras::optional< ExifData< ExifAscii > > | getExifLensSerialNumber () |
virtual cras::optional< ExifData< ExifAscii > > | getExifMake () |
virtual cras::optional< ExifData< ExifAscii > > | getExifModel () |
virtual cras::optional< ExifData< ExifAscii > > | getExifOffsetTimeOriginal () |
virtual cras::optional< ExifData< ExifShort > > | getExifOrientation () |
virtual cras::optional< ExifData< ExifSRational > > | getExifPitchAngle () |
virtual cras::optional< ExifData< ExifShort > > | getExifResUnit () |
virtual cras::optional< ExifData< ExifSRational > > | getExifRollAngle () |
virtual cras::optional< ExifData< ExifAscii > > | getExifSubSecTimeOriginal () |
virtual cras::optional< double > | getGPSAltitude () |
Construct altitude from GPSAltitude and GPSAltitudeRef. More... | |
virtual cras::optional< double > | getGPSImgDirection () |
GPS image direction from GPSImgDirection. More... | |
virtual cras::optional< std::string > | getGPSImgDirectionRef () |
Get the image direction reference. More... | |
virtual cras::optional< double > | getGPSLatitude () |
Construct latitude from GPSLatitude and GPSLatitudeRef. More... | |
virtual cras::optional< double > | getGPSLongitude () |
Construct latitude from GPSLongitude and GPSLongitudeRef. More... | |
virtual cras::optional< double > | getGPSSpeed () |
Construct ground speed from GPSSpeed and GPSSpeedRef. More... | |
virtual cras::optional< ros::Time > | getGPSTime () |
Get the GPS time corresponding to the current frame. More... | |
virtual cras::optional< double > | getGPSTrack () |
Construct GPS track (heading) from GPSTrack and GPSTrackRef. More... | |
Protected Attributes | |
size_t | height |
Height of the movie [px]. More... | |
size_t | width |
Width of the movie [px]. More... | |
![]() | |
::cras::LogHelperPtr | log |
Private Attributes | |
std::unique_ptr< ExifBaseMetadataExtractorPrivate > | data |
PIMPL. More... | |
Additional Inherited Members | |
![]() | |
using | ConstPtr = std::shared_ptr< const MetadataExtractor > |
using | Ptr = std::shared_ptr< MetadataExtractor > |
Common base for all metadata extractors that utilize EXIF data.
This base class contains implementations of the standard MetadataExtractor interface by combining various EXIF fields. Descendant classes are only responsible for reading the EXIF tags.
Definition at line 55 of file ExifBaseMetadataExtractor.h.
movie_publisher::ExifBaseMetadataExtractor::ExifBaseMetadataExtractor | ( | const cras::LogHelperPtr & | log, |
const std::weak_ptr< MetadataManager > & | manager, | ||
size_t | width, | ||
size_t | height | ||
) |
Constructor.
[in] | log | Logger. |
[in] | manager | Metadata manager. |
[in] | width | Width of the movie [px]. |
[in] | height | Height of the movie [px]. |
|
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 |
Reimplemented from movie_publisher::MetadataExtractor.
|
protected |
Get a helper for converting various azimuth representations and references.
Only call this method if you actually need the converter. Its construction is not free. It will be created lazily.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
inlineprotectedvirtual |
Definition at line 281 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 161 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 169 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 205 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 201 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 193 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 185 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 189 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 229 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 225 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 261 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 265 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 237 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 269 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 277 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 273 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 213 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 209 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 221 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 217 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 233 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 245 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 241 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 257 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 253 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 249 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 153 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 157 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 165 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 145 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 149 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 173 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 181 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 289 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 197 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 285 of file ExifBaseMetadataExtractor.h.
|
inlineprotectedvirtual |
Definition at line 177 of file ExifBaseMetadataExtractor.h.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
overridevirtual |
Reimplemented from movie_publisher::MetadataExtractor.
|
protectedvirtual |
Construct altitude from GPSAltitude and GPSAltitudeRef.
|
protectedvirtual |
GPS image direction from GPSImgDirection.
|
protectedvirtual |
Get the image direction reference.
|
protectedvirtual |
Construct latitude from GPSLatitude and GPSLatitudeRef.
|
protectedvirtual |
Construct latitude from GPSLongitude and GPSLongitudeRef.
|
protectedvirtual |
Construct ground speed from GPSSpeed and GPSSpeedRef.
|
protectedvirtual |
Get the GPS time corresponding to the current frame.
|
protectedvirtual |
Construct GPS track (heading) from GPSTrack and GPSTrackRef.
|
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 |
Reimplemented from movie_publisher::MetadataExtractor.
|
private |
PIMPL.
Definition at line 292 of file ExifBaseMetadataExtractor.h.
|
protected |
Height of the movie [px].
Definition at line 87 of file ExifBaseMetadataExtractor.h.
|
protected |
Width of the movie [px].
Definition at line 86 of file ExifBaseMetadataExtractor.h.