Public Member Functions | |
bool | callbackEndSave (std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res) |
Callbacks () | |
bool | callbackStartSave (std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res) |
void | callbackWithCameraInfo (const sensor_msgs::ImageConstPtr &image_msg, const sensor_msgs::CameraInfoConstPtr &info) |
void | callbackWithoutCameraInfo (const sensor_msgs::ImageConstPtr &image_msg) |
Private Member Functions | |
bool | saveImage (const sensor_msgs::ImageConstPtr &image_msg, std::string &filename) |
Private Attributes | |
size_t | count_ |
ros::Time | end_time_ |
bool | has_camera_info_ |
bool | is_first_image_ |
ros::Time | start_time_ |
Class to deal with which callback to call whether we have CameraInfo or not
Definition at line 58 of file image_saver.cpp.
|
inline |
Definition at line 60 of file image_saver.cpp.
|
inline |
Definition at line 74 of file image_saver.cpp.
|
inline |
Definition at line 63 of file image_saver.cpp.
|
inline |
Definition at line 117 of file image_saver.cpp.
|
inline |
Definition at line 84 of file image_saver.cpp.
|
inlineprivate |
Definition at line 144 of file image_saver.cpp.
|
private |
Definition at line 184 of file image_saver.cpp.
|
private |
Definition at line 186 of file image_saver.cpp.
|
private |
Definition at line 183 of file image_saver.cpp.
|
private |
Definition at line 182 of file image_saver.cpp.
|
private |
Definition at line 185 of file image_saver.cpp.