#include <ros/ros.h>#include <mongo/client/dbclient.h>#include <mongodb_store/util.h>#include <sensor_msgs/CompressedImage.h>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| void | msg_callback (const sensor_msgs::CompressedImage::ConstPtr &msg) |
| void | print_count (const ros::TimerEvent &te) |
Variables | |
| std::string | collection |
| unsigned int | drop_counter |
| static pthread_mutex_t | drop_counter_mutex = PTHREAD_MUTEX_INITIALIZER |
| unsigned int | in_counter |
| static pthread_mutex_t | in_counter_mutex = PTHREAD_MUTEX_INITIALIZER |
| DBClientConnection * | mongodb_conn |
| unsigned int | out_counter |
| static pthread_mutex_t | out_counter_mutex = PTHREAD_MUTEX_INITIALIZER |
| unsigned int | qsize |
| static pthread_mutex_t | qsize_mutex = PTHREAD_MUTEX_INITIALIZER |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 97 of file mongodb_log_cimg.cpp.
| void msg_callback | ( | const sensor_msgs::CompressedImage::ConstPtr & | msg | ) |
Definition at line 46 of file mongodb_log_cimg.cpp.
| void print_count | ( | const ros::TimerEvent & | te | ) |
Definition at line 71 of file mongodb_log_cimg.cpp.
| std::string collection |
Definition at line 34 of file mongodb_log_cimg.cpp.
| unsigned int drop_counter |
Definition at line 39 of file mongodb_log_cimg.cpp.
|
static |
Definition at line 43 of file mongodb_log_cimg.cpp.
| unsigned int in_counter |
Definition at line 36 of file mongodb_log_cimg.cpp.
|
static |
Definition at line 41 of file mongodb_log_cimg.cpp.
| DBClientConnection* mongodb_conn |
Definition at line 33 of file mongodb_log_cimg.cpp.
| unsigned int out_counter |
Definition at line 37 of file mongodb_log_cimg.cpp.
|
static |
Definition at line 42 of file mongodb_log_cimg.cpp.
| unsigned int qsize |
Definition at line 38 of file mongodb_log_cimg.cpp.
|
static |
Definition at line 44 of file mongodb_log_cimg.cpp.