|
virtual cras::expected< void, std::string > | onClose () |
| Callback telling the processor that a movie has been closed. More...
|
|
virtual cras::expected< void, std::string > | onMetadataReady (const std::shared_ptr< TimedMetadataExtractor > &metadataExtractor) |
| Callback telling the processor that static metadata have been extracted and timed metadata are ready. More...
|
|
virtual cras::expected< void, std::string > | onOpen (const MovieInfo::ConstPtr &info, const MovieOpenConfig &config) |
| Callback telling the processor that a movie has been opened for reading. More...
|
|
virtual cras::expected< void, std::string > | onSeek (const StreamTime &time) |
| Callback telling the processor that a movie has been seeked to the given time. More...
|
|
virtual cras::expected< void, std::string > | processAzimuth (const compass_msgs::Azimuth &azimuthMsg) |
| Process the azimuth message. More...
|
|
virtual cras::expected< void, std::string > | processCameraInfo (const sensor_msgs::CameraInfo &cameraInfoMsg) |
| Process camera info. More...
|
|
virtual cras::expected< void, std::string > | processFaces (const vision_msgs::Detection2DArray &facesMsg) |
| Process the face detections message. More...
|
|
virtual cras::expected< void, std::string > | processFrame (const sensor_msgs::ImageConstPtr &image, const MoviePlaybackState &playbackState) |
| Process the frame read by MovieReader::nextFrame(). More...
|
|
virtual cras::expected< void, std::string > | processGps (const gps_common::GPSFix &gpsMsg) |
| Process the GPSFix message. More...
|
|
virtual cras::expected< void, std::string > | processImage (const sensor_msgs::ImageConstPtr &image, const cras::optional< sensor_msgs::CameraInfo > &cameraInfoMsg) |
| Process the image and its camera info. More...
|
|
virtual cras::expected< void, std::string > | processImu (const sensor_msgs::Imu &imuMsg) |
| Process the IMU message. More...
|
|
virtual cras::expected< void, std::string > | processMagneticField (const sensor_msgs::MagneticField &magneticFieldMsg) |
| Process the magnetic field message. More...
|
|
virtual cras::expected< void, std::string > | processNavSatFix (const sensor_msgs::NavSatFix &navSatFixMsg) |
| Process the NavSatFix message. More...
|
|
virtual cras::expected< void, std::string > | processOpticalTf (const geometry_msgs::TransformStamped &opticalTfMsg) |
| Process the optical frame TF message. More...
|
|
virtual cras::expected< void, std::string > | processZeroRollPitchTf (const geometry_msgs::TransformStamped &zeroRollPitchTfMsg) |
| Process the zero roll/pitch TF message. More...
|
|
virtual | ~MovieMetadataProcessor () |
|
Base for consumers of movie metadata.
Callbacks for each type of metadata will be called when the metadata is available and the movie advances.
- Note
- The difference between TimedMetadataListener and MovieMetadataProcessor is the level of abstraction on which they work. TimedMetadataListener connects Movie and TimedMetadataExtractors so that the Movie class gets info about the metadata it has. MovieMetadataProcessor is then the interface between Movie and "the outer world", i.e. users of the Movie class. Usually, TimedMetadataListener will be mostly used internally in this library, while MovieMetadataProcessor will be used publicly by other classes outside this package. Also, the timestamps in TimedMetadataListener are always stream timestamps, while in MovieMetadataProcessor they should already correspond to ROS time according to the defined conversion function.
Definition at line 44 of file movie_metadata_processor.h.