#include <opencv2/highgui/highgui.hpp>#include <ros/ros.h>#include <cv_bridge/cv_bridge.h>#include <image_transport/image_transport.h>#include <time.h>#include <std_srvs/Empty.h>
Go to the source code of this file.
Functions | |
| void | IMcallback (const sensor_msgs::ImageConstPtr &image_msg, const sensor_msgs::CameraInfoConstPtr &info) |
| int | main (int argc, char **argv) |
| bool | save_image (std_srvs::Empty::Request &dummyr, std_srvs::Empty::Response &dummyq) |
Variables | |
| char | filename [255] |
| cv::Mat | image |
| std::string | path |
| void IMcallback | ( | const sensor_msgs::ImageConstPtr & | image_msg, |
| const sensor_msgs::CameraInfoConstPtr & | info | ||
| ) |
Definition at line 14 of file save_image.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 53 of file save_image.cpp.
| bool save_image | ( | std_srvs::Empty::Request & | dummyr, |
| std_srvs::Empty::Response & | dummyq | ||
| ) |
Definition at line 37 of file save_image.cpp.
| char filename[255] |
Definition at line 10 of file save_image.cpp.
| cv::Mat image |
Definition at line 12 of file save_image.cpp.
| std::string path |
Definition at line 11 of file save_image.cpp.