#include <list>#include <string>#include <ros/ros.h>#include <tf/tfMessage.h>#include <tf/LinearMath/Quaternion.h>#include <mongo/client/dbclient.h>#include <mongodb_store/util.h>
Go to the source code of this file.
Classes | |
| struct | PoseStampedMemoryEntry |
Functions | |
| int | main (int argc, char **argv) |
| void | msg_callback (const tf::tfMessage::ConstPtr &msg) |
| void | print_count (const ros::TimerEvent &te) |
| bool | shouldLogTransform (std::vector< geometry_msgs::TransformStamped >::const_iterator t) |
Variables | |
| bool | bAlwaysLog |
| std::string | collection |
| unsigned int | drop_counter |
| static pthread_mutex_t | drop_counter_mutex = PTHREAD_MUTEX_INITIALIZER |
| float | fAngularDistanceThreshold |
| float | fTimeDistanceThreshold |
| float | fVectorialDistanceThreshold |
| unsigned int | in_counter |
| static pthread_mutex_t | in_counter_mutex = PTHREAD_MUTEX_INITIALIZER |
| list< PoseStampedMemoryEntry > | lstPoseStampedMemory |
| 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 |
| std::string | topic |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 203 of file mongodb_log_tf.cpp.
| void msg_callback | ( | const tf::tfMessage::ConstPtr & | msg | ) |
Definition at line 133 of file mongodb_log_tf.cpp.
| void print_count | ( | const ros::TimerEvent & | te | ) |
Definition at line 180 of file mongodb_log_tf.cpp.
| bool shouldLogTransform | ( | std::vector< geometry_msgs::TransformStamped >::const_iterator | t | ) |
Definition at line 67 of file mongodb_log_tf.cpp.
| bool bAlwaysLog |
Definition at line 51 of file mongodb_log_tf.cpp.
| std::string collection |
Definition at line 54 of file mongodb_log_tf.cpp.
| unsigned int drop_counter |
Definition at line 60 of file mongodb_log_tf.cpp.
|
static |
Definition at line 64 of file mongodb_log_tf.cpp.
| float fAngularDistanceThreshold |
Definition at line 48 of file mongodb_log_tf.cpp.
| float fTimeDistanceThreshold |
Definition at line 49 of file mongodb_log_tf.cpp.
| float fVectorialDistanceThreshold |
Definition at line 47 of file mongodb_log_tf.cpp.
| unsigned int in_counter |
Definition at line 57 of file mongodb_log_tf.cpp.
|
static |
Definition at line 62 of file mongodb_log_tf.cpp.
| list<PoseStampedMemoryEntry> lstPoseStampedMemory |
Definition at line 50 of file mongodb_log_tf.cpp.
| DBClientConnection* mongodb_conn |
Definition at line 53 of file mongodb_log_tf.cpp.
| unsigned int out_counter |
Definition at line 58 of file mongodb_log_tf.cpp.
|
static |
Definition at line 63 of file mongodb_log_tf.cpp.
| unsigned int qsize |
Definition at line 59 of file mongodb_log_tf.cpp.
|
static |
Definition at line 65 of file mongodb_log_tf.cpp.
| std::string topic |
Definition at line 55 of file mongodb_log_tf.cpp.