Metadata cache. More...
#include <memory>
#include <string>
#include <compass_msgs/Azimuth.h>
#include <cras_cpp_common/optional.hpp>
#include <geometry_msgs/Transform.h>
#include <gps_common/GPSFix.h>
#include <movie_publisher/metadata_type.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/Imu.h>
#include <sensor_msgs/MagneticField.h>
#include <sensor_msgs/NavSatFix.h>
#include <vision_msgs/Detection2DArray.h>
Go to the source code of this file.
Classes | |
struct | movie_publisher::LatestMetadataCache |
Latest metadata of each type. More... | |
struct | movie_publisher::MetadataCache |
Metadata cache. More... | |
struct | movie_publisher::TimedMetadataCache |
Metadata cache. More... | |
Namespaces | |
movie_publisher | |
Functions | |
template<typename M > | |
static bool | movie_publisher::CompareStamp (const TimedMetadata< M > &a, const StreamTime &b) |
Compare TimedMetadata according to their stamps (in decreasing order). More... | |
template<typename M > | |
auto | movie_publisher::findLastUpToStamp (const std::vector< TimedMetadata< M >> &data, const StreamTime &stamp) |
Find index of the latest data from data that have their timestamp less than or equal to stamp . More... | |
template<typename M > | |
cras::optional< TimedMetadata< M > > | movie_publisher::findLastUpToStamp (const std::vector< TimedMetadata< M >> &data, const StreamTime &stamp, const cras::optional< M > &defaultVal) |
Find the latest data from data that have their timestamp less than or equal to stamp . More... | |
Metadata cache.
Definition in file metadata_cache.h.