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::CameraInfoPtr 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 info_ts =
list_[i]->header.stamp.toNSec();
106 return sensor_msgs::CameraInfoPtr();
void setSize(size_t maxsize)
Set maximum size of the list.
std::vector< sensor_msgs::CameraInfoPtr > list_
int removeOld(const ros::Time ×tamp)
Remove all camera infos that have a timestamp that is older or equal than the given timestamp.
void setTolerance(uint64_t tolerance)
Set tolerance for finding corresponding timestamps.
sensor_msgs::CameraInfoPtr find(const ros::Time ×tamp) const
Returns the oldest camera info that has a timestamp within the tolerance of the given timestamp.
sensor_msgs::CameraInfoPtr add(const sensor_msgs::CameraInfoPtr &info)
Adds the given camera info to the internal list.
CameraInfoList()
Create a camera info list.
rc_genicam_camera
Author(s): Heiko Hirschmueller
autogenerated on Wed Mar 2 2022 00:49:18