Go to the documentation of this file.
49 maxsize_ = std::max(
static_cast<size_t>(1), maxsize);
59 list_.push_back(image);
61 sensor_msgs::ImagePtr ret;
77 while (i <
list_.size())
81 list_.erase(
list_.begin() +
static_cast<int>(i));
95 for (
size_t i = 0; i <
list_.size(); i++)
97 uint64_t ts = timestamp.
toNSec();
98 uint64_t image_ts =
list_[i]->header.stamp.toNSec();
106 return sensor_msgs::ImagePtr();
int removeOld(const ros::Time ×tamp)
Remove all images that have a timestamp that is older or equal than the given timestamp.
sensor_msgs::ImagePtr find(const ros::Time ×tamp) const
Returns the oldest image that has a timestamp within the tolerance of the given timestamp.
sensor_msgs::ImagePtr add(const sensor_msgs::ImagePtr &image)
Adds the given image to the internal list.
std::vector< sensor_msgs::ImagePtr > list_
ImageList()
Create an image list.
void setSize(size_t maxsize)
Set maximum size of the list.
void setTolerance(uint64_t tolerance)
Set tolerance for finding corresponding timestamps.
rc_genicam_camera
Author(s): Heiko Hirschmueller
autogenerated on Wed Mar 2 2022 00:49:18