Go to the documentation of this file.
36 #ifndef RC_GENICAM_CAMERA_CAMERAINFOLIST
37 #define RC_GENICAM_CAMERA_CAMERAINFOLIST
40 #include <sensor_msgs/CameraInfo.h>
75 sensor_msgs::CameraInfoPtr
add(
const sensor_msgs::CameraInfoPtr& info);
95 sensor_msgs::CameraInfoPtr
find(
const ros::Time& timestamp)
const;
100 std::vector<sensor_msgs::CameraInfoPtr>
list_;
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