Go to the source code of this file.
Functions | |
void | camera_cb (const sensor_msgs::ImageConstPtr &img, const sensor_msgs::CameraInfoConstPtr &info) |
int | main (int argc, char **argv) |
void | timer_cb (const ros::TimerEvent &e) |
Variables | |
image_transport::CameraPublisher | camera_pub |
image_transport::CameraSubscriber | camera_sub |
sensor_msgs::Image | current_image |
sensor_msgs::CameraInfo | current_info |
boost::mutex | mutex |
void camera_cb | ( | const sensor_msgs::ImageConstPtr & | img, |
const sensor_msgs::CameraInfoConstPtr & | info | ||
) |
Definition at line 23 of file synchronizedcamerathrottler.cc.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 37 of file synchronizedcamerathrottler.cc.
void timer_cb | ( | const ros::TimerEvent & | e | ) |
Definition at line 31 of file synchronizedcamerathrottler.cc.
Definition at line 15 of file synchronizedcamerathrottler.cc.
Definition at line 14 of file synchronizedcamerathrottler.cc.
sensor_msgs::Image current_image |
Definition at line 20 of file synchronizedcamerathrottler.cc.
sensor_msgs::CameraInfo current_info |
Definition at line 21 of file synchronizedcamerathrottler.cc.
Definition at line 18 of file synchronizedcamerathrottler.cc.