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

Metadata cache. More...

#include <metadata_cache.h>

Public Member Functions

std::vector< TimedMetadata< geometry_msgs::Vector3 > > & acceleration ()
 
const std::vector< TimedMetadata< geometry_msgs::Vector3 > > & acceleration () const
 
std::vector< TimedMetadata< geometry_msgs::Vector3 > > & angularVelocity ()
 
const std::vector< TimedMetadata< geometry_msgs::Vector3 > > & angularVelocity () const
 
std::vector< TimedMetadata< compass_msgs::Azimuth > > & azimuth ()
 
const std::vector< TimedMetadata< compass_msgs::Azimuth > > & azimuth () const
 
std::vector< TimedMetadata< sensor_msgs::CameraInfo > > & cameraInfo ()
 
const std::vector< TimedMetadata< sensor_msgs::CameraInfo > > & cameraInfo () const
 
void clear ()
 
std::vector< TimedMetadata< double > > & cropFactor ()
 
const std::vector< TimedMetadata< double > > & cropFactor () const
 
std::vector< TimedMetadata< std::pair< DistortionType, Distortion > > > & distortion ()
 
const std::vector< TimedMetadata< std::pair< DistortionType, Distortion > > > & distortion () const
 
std::vector< TimedMetadata< vision_msgs::Detection2DArray > > & faces ()
 
const std::vector< TimedMetadata< vision_msgs::Detection2DArray > > & faces () const
 
std::vector< TimedMetadata< double > > & focalLength35MM ()
 
const std::vector< TimedMetadata< double > > & focalLength35MM () const
 
std::vector< TimedMetadata< double > > & focalLengthMM ()
 
const std::vector< TimedMetadata< double > > & focalLengthMM () const
 
std::vector< TimedMetadata< double > > & focalLengthPx ()
 
const std::vector< TimedMetadata< double > > & focalLengthPx () const
 
std::vector< TimedMetadata< GNSSFixAndDetail > > & gnssPosition ()
 
const std::vector< TimedMetadata< GNSSFixAndDetail > > & gnssPosition () const
 
std::vector< TimedMetadata< sensor_msgs::Imu > > & imu ()
 
const std::vector< TimedMetadata< sensor_msgs::Imu > > & imu () const
 
std::vector< TimedMetadata< IntrinsicMatrix > > & intrinsicMatrix ()
 
const std::vector< TimedMetadata< IntrinsicMatrix > > & intrinsicMatrix () const
 
std::vector< TimedMetadata< sensor_msgs::MagneticField > > & magneticField ()
 
const std::vector< TimedMetadata< sensor_msgs::MagneticField > > & magneticField () const
 
std::vector< TimedMetadata< geometry_msgs::Transform > > & opticalFrameTF ()
 
const std::vector< TimedMetadata< geometry_msgs::Transform > > & opticalFrameTF () const
 
std::vector< TimedMetadata< RollPitch > > & rollPitch ()
 
const std::vector< TimedMetadata< RollPitch > > & rollPitch () const
 
std::vector< TimedMetadata< int > > & rotation ()
 
const std::vector< TimedMetadata< int > > & rotation () const
 
std::vector< TimedMetadata< SensorSize > > & sensorSizeMM ()
 
const std::vector< TimedMetadata< SensorSize > > & sensorSizeMM () const
 
 TimedMetadataCache ()
 
std::vector< TimedMetadata< geometry_msgs::Transform > > & zeroRollPitchTF ()
 
const std::vector< TimedMetadata< geometry_msgs::Transform > > & zeroRollPitchTF () const
 
 ~TimedMetadataCache ()
 

Private Attributes

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

Detailed Description

Metadata cache.

Definition at line 128 of file metadata_cache.h.

Constructor & Destructor Documentation

◆ TimedMetadataCache()

movie_publisher::TimedMetadataCache::TimedMetadataCache ( )

◆ ~TimedMetadataCache()

movie_publisher::TimedMetadataCache::~TimedMetadataCache ( )

Member Function Documentation

◆ acceleration() [1/2]

std::vector<TimedMetadata<geometry_msgs::Vector3> >& movie_publisher::TimedMetadataCache::acceleration ( )

◆ acceleration() [2/2]

const std::vector<TimedMetadata<geometry_msgs::Vector3> >& movie_publisher::TimedMetadataCache::acceleration ( ) const

◆ angularVelocity() [1/2]

std::vector<TimedMetadata<geometry_msgs::Vector3> >& movie_publisher::TimedMetadataCache::angularVelocity ( )

◆ angularVelocity() [2/2]

const std::vector<TimedMetadata<geometry_msgs::Vector3> >& movie_publisher::TimedMetadataCache::angularVelocity ( ) const

◆ azimuth() [1/2]

std::vector<TimedMetadata<compass_msgs::Azimuth> >& movie_publisher::TimedMetadataCache::azimuth ( )

◆ azimuth() [2/2]

const std::vector<TimedMetadata<compass_msgs::Azimuth> >& movie_publisher::TimedMetadataCache::azimuth ( ) const

◆ cameraInfo() [1/2]

std::vector<TimedMetadata<sensor_msgs::CameraInfo> >& movie_publisher::TimedMetadataCache::cameraInfo ( )

◆ cameraInfo() [2/2]

const std::vector<TimedMetadata<sensor_msgs::CameraInfo> >& movie_publisher::TimedMetadataCache::cameraInfo ( ) const

◆ clear()

void movie_publisher::TimedMetadataCache::clear ( )

◆ cropFactor() [1/2]

std::vector<TimedMetadata<double> >& movie_publisher::TimedMetadataCache::cropFactor ( )

◆ cropFactor() [2/2]

const std::vector<TimedMetadata<double> >& movie_publisher::TimedMetadataCache::cropFactor ( ) const

◆ distortion() [1/2]

std::vector<TimedMetadata<std::pair<DistortionType, Distortion> > >& movie_publisher::TimedMetadataCache::distortion ( )

◆ distortion() [2/2]

const std::vector<TimedMetadata<std::pair<DistortionType, Distortion> > >& movie_publisher::TimedMetadataCache::distortion ( ) const

◆ faces() [1/2]

std::vector<TimedMetadata<vision_msgs::Detection2DArray> >& movie_publisher::TimedMetadataCache::faces ( )

◆ faces() [2/2]

const std::vector<TimedMetadata<vision_msgs::Detection2DArray> >& movie_publisher::TimedMetadataCache::faces ( ) const

◆ focalLength35MM() [1/2]

std::vector<TimedMetadata<double> >& movie_publisher::TimedMetadataCache::focalLength35MM ( )

◆ focalLength35MM() [2/2]

const std::vector<TimedMetadata<double> >& movie_publisher::TimedMetadataCache::focalLength35MM ( ) const

◆ focalLengthMM() [1/2]

std::vector<TimedMetadata<double> >& movie_publisher::TimedMetadataCache::focalLengthMM ( )

◆ focalLengthMM() [2/2]

const std::vector<TimedMetadata<double> >& movie_publisher::TimedMetadataCache::focalLengthMM ( ) const

◆ focalLengthPx() [1/2]

std::vector<TimedMetadata<double> >& movie_publisher::TimedMetadataCache::focalLengthPx ( )

◆ focalLengthPx() [2/2]

const std::vector<TimedMetadata<double> >& movie_publisher::TimedMetadataCache::focalLengthPx ( ) const

◆ gnssPosition() [1/2]

std::vector<TimedMetadata<GNSSFixAndDetail> >& movie_publisher::TimedMetadataCache::gnssPosition ( )

◆ gnssPosition() [2/2]

const std::vector<TimedMetadata<GNSSFixAndDetail> >& movie_publisher::TimedMetadataCache::gnssPosition ( ) const

◆ imu() [1/2]

std::vector<TimedMetadata<sensor_msgs::Imu> >& movie_publisher::TimedMetadataCache::imu ( )

◆ imu() [2/2]

const std::vector<TimedMetadata<sensor_msgs::Imu> >& movie_publisher::TimedMetadataCache::imu ( ) const

◆ intrinsicMatrix() [1/2]

std::vector<TimedMetadata<IntrinsicMatrix> >& movie_publisher::TimedMetadataCache::intrinsicMatrix ( )

◆ intrinsicMatrix() [2/2]

const std::vector<TimedMetadata<IntrinsicMatrix> >& movie_publisher::TimedMetadataCache::intrinsicMatrix ( ) const

◆ magneticField() [1/2]

std::vector<TimedMetadata<sensor_msgs::MagneticField> >& movie_publisher::TimedMetadataCache::magneticField ( )

◆ magneticField() [2/2]

const std::vector<TimedMetadata<sensor_msgs::MagneticField> >& movie_publisher::TimedMetadataCache::magneticField ( ) const

◆ opticalFrameTF() [1/2]

std::vector<TimedMetadata<geometry_msgs::Transform> >& movie_publisher::TimedMetadataCache::opticalFrameTF ( )

◆ opticalFrameTF() [2/2]

const std::vector<TimedMetadata<geometry_msgs::Transform> >& movie_publisher::TimedMetadataCache::opticalFrameTF ( ) const

◆ rollPitch() [1/2]

std::vector<TimedMetadata<RollPitch> >& movie_publisher::TimedMetadataCache::rollPitch ( )

◆ rollPitch() [2/2]

const std::vector<TimedMetadata<RollPitch> >& movie_publisher::TimedMetadataCache::rollPitch ( ) const

◆ rotation() [1/2]

std::vector<TimedMetadata<int> >& movie_publisher::TimedMetadataCache::rotation ( )

◆ rotation() [2/2]

const std::vector<TimedMetadata<int> >& movie_publisher::TimedMetadataCache::rotation ( ) const

◆ sensorSizeMM() [1/2]

std::vector<TimedMetadata<SensorSize> >& movie_publisher::TimedMetadataCache::sensorSizeMM ( )

◆ sensorSizeMM() [2/2]

const std::vector<TimedMetadata<SensorSize> >& movie_publisher::TimedMetadataCache::sensorSizeMM ( ) const

◆ zeroRollPitchTF() [1/2]

std::vector<TimedMetadata<geometry_msgs::Transform> >& movie_publisher::TimedMetadataCache::zeroRollPitchTF ( )

◆ zeroRollPitchTF() [2/2]

const std::vector<TimedMetadata<geometry_msgs::Transform> >& movie_publisher::TimedMetadataCache::zeroRollPitchTF ( ) const

Member Data Documentation

◆ data

std::unique_ptr<Impl> movie_publisher::TimedMetadataCache::data
private

PIMPL.

Definition at line 193 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