Public Member Functions | Private Attributes | List of all members
movie_publisher::LatestMetadataCache Struct Referencefinal

Latest metadata of each type. More...

#include <metadata_cache.h>

Public Member Functions

void clear ()
 
cras::optional< cras::optional< geometry_msgs::Vector3 > > & getAcceleration ()
 
const cras::optional< cras::optional< geometry_msgs::Vector3 > > & getAcceleration () const
 
cras::optional< cras::optional< geometry_msgs::Vector3 > > & getAngularVelocity ()
 
const cras::optional< cras::optional< geometry_msgs::Vector3 > > & getAngularVelocity () const
 
cras::optional< cras::optional< compass_msgs::Azimuth > > & getAzimuth ()
 
const cras::optional< cras::optional< compass_msgs::Azimuth > > & getAzimuth () const
 
cras::optional< cras::optional< std::string > > & getCameraGeneralName ()
 
const cras::optional< cras::optional< std::string > > & getCameraGeneralName () const
 
cras::optional< cras::optional< sensor_msgs::CameraInfo > > & getCameraInfo ()
 
const cras::optional< cras::optional< sensor_msgs::CameraInfo > > & getCameraInfo () const
 
cras::optional< cras::optional< std::string > > & getCameraMake ()
 
const cras::optional< cras::optional< std::string > > & getCameraMake () const
 
cras::optional< cras::optional< std::string > > & getCameraModel ()
 
const cras::optional< cras::optional< std::string > > & getCameraModel () const
 
cras::optional< cras::optional< std::string > > & getCameraSerialNumber ()
 
const cras::optional< cras::optional< std::string > > & getCameraSerialNumber () const
 
cras::optional< cras::optional< std::string > > & getCameraUniqueName ()
 
const cras::optional< cras::optional< std::string > > & getCameraUniqueName () const
 
cras::optional< cras::optional< ros::Time > > & getCreationTime ()
 
const cras::optional< cras::optional< ros::Time > > & getCreationTime () const
 
cras::optional< cras::optional< double > > & getCropFactor ()
 
const cras::optional< cras::optional< double > > & getCropFactor () const
 
cras::optional< cras::optional< DistortionData > > & getDistortion ()
 
const cras::optional< cras::optional< DistortionData > > & getDistortion () const
 
cras::optional< cras::optional< vision_msgs::Detection2DArray > > & getFaces ()
 
const cras::optional< cras::optional< vision_msgs::Detection2DArray > > & getFaces () const
 
cras::optional< cras::optional< double > > & getFocalLength35MM ()
 
const cras::optional< cras::optional< double > > & getFocalLength35MM () const
 
cras::optional< cras::optional< double > > & getFocalLengthMM ()
 
const cras::optional< cras::optional< double > > & getFocalLengthMM () const
 
cras::optional< cras::optional< double > > & getFocalLengthPx ()
 
const cras::optional< cras::optional< double > > & getFocalLengthPx () const
 
cras::optional< GNSSFixAndDetail > & getGNSSPosition ()
 
const cras::optional< GNSSFixAndDetail > & getGNSSPosition () const
 
cras::optional< cras::optional< sensor_msgs::Imu > > & getImu ()
 
const cras::optional< cras::optional< sensor_msgs::Imu > > & getImu () const
 
cras::optional< cras::optional< IntrinsicMatrix > > & getIntrinsicMatrix ()
 
const cras::optional< cras::optional< IntrinsicMatrix > > & getIntrinsicMatrix () const
 
cras::optional< cras::optional< std::string > > & getLensMake ()
 
const cras::optional< cras::optional< std::string > > & getLensMake () const
 
cras::optional< cras::optional< std::string > > & getLensModel ()
 
const cras::optional< cras::optional< std::string > > & getLensModel () const
 
cras::optional< cras::optional< sensor_msgs::MagneticField > > & getMagneticField ()
 
const cras::optional< cras::optional< sensor_msgs::MagneticField > > & getMagneticField () const
 
cras::optional< cras::optional< geometry_msgs::Transform > > & getOpticalFrameTF ()
 
const cras::optional< cras::optional< geometry_msgs::Transform > > & getOpticalFrameTF () const
 
cras::optional< cras::optional< RollPitch > > & getRollPitch ()
 
const cras::optional< cras::optional< RollPitch > > & getRollPitch () const
 
cras::optional< cras::optional< int > > & getRotation ()
 
const cras::optional< cras::optional< int > > & getRotation () const
 
cras::optional< cras::optional< SensorSize > > & getSensorSizeMM ()
 
const cras::optional< cras::optional< SensorSize > > & getSensorSizeMM () const
 
cras::optional< cras::optional< geometry_msgs::Transform > > & getZeroRollPitchTF ()
 
const cras::optional< cras::optional< geometry_msgs::Transform > > & getZeroRollPitchTF () const
 
 LatestMetadataCache ()
 
 ~LatestMetadataCache ()
 

Private Attributes

std::shared_ptr< Impl > data
 PIMPL. More...
 

Detailed Description

Latest metadata of each type.

Definition at line 32 of file metadata_cache.h.

Constructor & Destructor Documentation

◆ LatestMetadataCache()

movie_publisher::LatestMetadataCache::LatestMetadataCache ( )

◆ ~LatestMetadataCache()

movie_publisher::LatestMetadataCache::~LatestMetadataCache ( )

Member Function Documentation

◆ clear()

void movie_publisher::LatestMetadataCache::clear ( )

◆ getAcceleration() [1/2]

cras::optional<cras::optional<geometry_msgs::Vector3> >& movie_publisher::LatestMetadataCache::getAcceleration ( )

◆ getAcceleration() [2/2]

const cras::optional<cras::optional<geometry_msgs::Vector3> >& movie_publisher::LatestMetadataCache::getAcceleration ( ) const

◆ getAngularVelocity() [1/2]

cras::optional<cras::optional<geometry_msgs::Vector3> >& movie_publisher::LatestMetadataCache::getAngularVelocity ( )

◆ getAngularVelocity() [2/2]

const cras::optional<cras::optional<geometry_msgs::Vector3> >& movie_publisher::LatestMetadataCache::getAngularVelocity ( ) const

◆ getAzimuth() [1/2]

cras::optional<cras::optional<compass_msgs::Azimuth> >& movie_publisher::LatestMetadataCache::getAzimuth ( )

◆ getAzimuth() [2/2]

const cras::optional<cras::optional<compass_msgs::Azimuth> >& movie_publisher::LatestMetadataCache::getAzimuth ( ) const

◆ getCameraGeneralName() [1/2]

cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getCameraGeneralName ( )

◆ getCameraGeneralName() [2/2]

const cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getCameraGeneralName ( ) const

◆ getCameraInfo() [1/2]

cras::optional<cras::optional<sensor_msgs::CameraInfo> >& movie_publisher::LatestMetadataCache::getCameraInfo ( )

◆ getCameraInfo() [2/2]

const cras::optional<cras::optional<sensor_msgs::CameraInfo> >& movie_publisher::LatestMetadataCache::getCameraInfo ( ) const

◆ getCameraMake() [1/2]

cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getCameraMake ( )

◆ getCameraMake() [2/2]

const cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getCameraMake ( ) const

◆ getCameraModel() [1/2]

cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getCameraModel ( )

◆ getCameraModel() [2/2]

const cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getCameraModel ( ) const

◆ getCameraSerialNumber() [1/2]

cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getCameraSerialNumber ( )

◆ getCameraSerialNumber() [2/2]

const cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getCameraSerialNumber ( ) const

◆ getCameraUniqueName() [1/2]

cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getCameraUniqueName ( )

◆ getCameraUniqueName() [2/2]

const cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getCameraUniqueName ( ) const

◆ getCreationTime() [1/2]

cras::optional<cras::optional<ros::Time> >& movie_publisher::LatestMetadataCache::getCreationTime ( )

◆ getCreationTime() [2/2]

const cras::optional<cras::optional<ros::Time> >& movie_publisher::LatestMetadataCache::getCreationTime ( ) const

◆ getCropFactor() [1/2]

cras::optional<cras::optional<double> >& movie_publisher::LatestMetadataCache::getCropFactor ( )

◆ getCropFactor() [2/2]

const cras::optional<cras::optional<double> >& movie_publisher::LatestMetadataCache::getCropFactor ( ) const

◆ getDistortion() [1/2]

cras::optional<cras::optional<DistortionData> >& movie_publisher::LatestMetadataCache::getDistortion ( )

◆ getDistortion() [2/2]

const cras::optional<cras::optional<DistortionData> >& movie_publisher::LatestMetadataCache::getDistortion ( ) const

◆ getFaces() [1/2]

cras::optional<cras::optional<vision_msgs::Detection2DArray> >& movie_publisher::LatestMetadataCache::getFaces ( )

◆ getFaces() [2/2]

const cras::optional<cras::optional<vision_msgs::Detection2DArray> >& movie_publisher::LatestMetadataCache::getFaces ( ) const

◆ getFocalLength35MM() [1/2]

cras::optional<cras::optional<double> >& movie_publisher::LatestMetadataCache::getFocalLength35MM ( )

◆ getFocalLength35MM() [2/2]

const cras::optional<cras::optional<double> >& movie_publisher::LatestMetadataCache::getFocalLength35MM ( ) const

◆ getFocalLengthMM() [1/2]

cras::optional<cras::optional<double> >& movie_publisher::LatestMetadataCache::getFocalLengthMM ( )

◆ getFocalLengthMM() [2/2]

const cras::optional<cras::optional<double> >& movie_publisher::LatestMetadataCache::getFocalLengthMM ( ) const

◆ getFocalLengthPx() [1/2]

cras::optional<cras::optional<double> >& movie_publisher::LatestMetadataCache::getFocalLengthPx ( )

◆ getFocalLengthPx() [2/2]

const cras::optional<cras::optional<double> >& movie_publisher::LatestMetadataCache::getFocalLengthPx ( ) const

◆ getGNSSPosition() [1/2]

cras::optional<GNSSFixAndDetail>& movie_publisher::LatestMetadataCache::getGNSSPosition ( )

◆ getGNSSPosition() [2/2]

const cras::optional<GNSSFixAndDetail>& movie_publisher::LatestMetadataCache::getGNSSPosition ( ) const

◆ getImu() [1/2]

cras::optional<cras::optional<sensor_msgs::Imu> >& movie_publisher::LatestMetadataCache::getImu ( )

◆ getImu() [2/2]

const cras::optional<cras::optional<sensor_msgs::Imu> >& movie_publisher::LatestMetadataCache::getImu ( ) const

◆ getIntrinsicMatrix() [1/2]

cras::optional<cras::optional<IntrinsicMatrix> >& movie_publisher::LatestMetadataCache::getIntrinsicMatrix ( )

◆ getIntrinsicMatrix() [2/2]

const cras::optional<cras::optional<IntrinsicMatrix> >& movie_publisher::LatestMetadataCache::getIntrinsicMatrix ( ) const

◆ getLensMake() [1/2]

cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getLensMake ( )

◆ getLensMake() [2/2]

const cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getLensMake ( ) const

◆ getLensModel() [1/2]

cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getLensModel ( )

◆ getLensModel() [2/2]

const cras::optional<cras::optional<std::string> >& movie_publisher::LatestMetadataCache::getLensModel ( ) const

◆ getMagneticField() [1/2]

cras::optional<cras::optional<sensor_msgs::MagneticField> >& movie_publisher::LatestMetadataCache::getMagneticField ( )

◆ getMagneticField() [2/2]

const cras::optional<cras::optional<sensor_msgs::MagneticField> >& movie_publisher::LatestMetadataCache::getMagneticField ( ) const

◆ getOpticalFrameTF() [1/2]

cras::optional<cras::optional<geometry_msgs::Transform> >& movie_publisher::LatestMetadataCache::getOpticalFrameTF ( )

◆ getOpticalFrameTF() [2/2]

const cras::optional<cras::optional<geometry_msgs::Transform> >& movie_publisher::LatestMetadataCache::getOpticalFrameTF ( ) const

◆ getRollPitch() [1/2]

cras::optional<cras::optional<RollPitch> >& movie_publisher::LatestMetadataCache::getRollPitch ( )

◆ getRollPitch() [2/2]

const cras::optional<cras::optional<RollPitch> >& movie_publisher::LatestMetadataCache::getRollPitch ( ) const

◆ getRotation() [1/2]

cras::optional<cras::optional<int> >& movie_publisher::LatestMetadataCache::getRotation ( )

◆ getRotation() [2/2]

const cras::optional<cras::optional<int> >& movie_publisher::LatestMetadataCache::getRotation ( ) const

◆ getSensorSizeMM() [1/2]

cras::optional<cras::optional<SensorSize> >& movie_publisher::LatestMetadataCache::getSensorSizeMM ( )

◆ getSensorSizeMM() [2/2]

const cras::optional<cras::optional<SensorSize> >& movie_publisher::LatestMetadataCache::getSensorSizeMM ( ) const

◆ getZeroRollPitchTF() [1/2]

cras::optional<cras::optional<geometry_msgs::Transform> >& movie_publisher::LatestMetadataCache::getZeroRollPitchTF ( )

◆ getZeroRollPitchTF() [2/2]

const cras::optional<cras::optional<geometry_msgs::Transform> >& movie_publisher::LatestMetadataCache::getZeroRollPitchTF ( ) const

Member Data Documentation

◆ data

std::shared_ptr<Impl> movie_publisher::LatestMetadataCache::data
private

PIMPL.

Definition at line 121 of file metadata_cache.h.


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


movie_publisher
Author(s): Martin Pecka
autogenerated on Wed May 28 2025 02:07:22