#include <ros/ros.h>
#include <sensor_msgs/LaserScan.h>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MarkerArray.h>
#include <iostream>
#include <sstream>
#include <cmath>
#include <pthread.h>
#include <find_moving_objects/MovingObject.h>
#include <find_moving_objects/MovingObjectArray.h>
Go to the source code of this file.
Macros | |
#define | MAX(X, Y) (X>Y?X:Y) |
#define | MIN(X, Y) (X<Y?X:Y) |
#define | WL(W) std::setw(W) << std::left |
#define | WR(W) std::setw(W) << std::right |
Functions | |
int | main (int argc, char **argv) |
void | moaCallback (const find_moving_objects::MovingObjectArray::ConstPtr &msg) |
void * | moaHandlerBody (void *arg) |
Variables | |
bool | g_available_moa = false |
pthread_cond_t | g_cond_moa = PTHREAD_COND_INITIALIZER |
std::vector< find_moving_objects::MovingObjectArray::ConstPtr > | g_msg_buffer_moa |
pthread_mutex_t | g_mutex_moa = PTHREAD_MUTEX_INITIALIZER |
ros::NodeHandle * | g_node |
int | g_nr_senders = 0 |
ros::Publisher | g_pub_moaf |
ros::Publisher | g_pub_objects_closest_point_markers |
ros::Publisher | g_pub_objects_velocity_arrows |
int | g_sender_index = -1 |
const double | TWO_PI = 2 * M_PI |
#define MAX | ( | X, | |
Y | |||
) | (X>Y?X:Y) |
Definition at line 66 of file moving_objects_confidence_enhancer_node.cpp.
#define MIN | ( | X, | |
Y | |||
) | (X<Y?X:Y) |
Definition at line 65 of file moving_objects_confidence_enhancer_node.cpp.
#define WL | ( | W | ) | std::setw(W) << std::left |
Definition at line 68 of file moving_objects_confidence_enhancer_node.cpp.
#define WR | ( | W | ) | std::setw(W) << std::right |
Definition at line 69 of file moving_objects_confidence_enhancer_node.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 552 of file moving_objects_confidence_enhancer_node.cpp.
void moaCallback | ( | const find_moving_objects::MovingObjectArray::ConstPtr & | msg | ) |
Definition at line 92 of file moving_objects_confidence_enhancer_node.cpp.
void* moaHandlerBody | ( | void * | arg | ) |
Definition at line 151 of file moving_objects_confidence_enhancer_node.cpp.
bool g_available_moa = false |
Definition at line 86 of file moving_objects_confidence_enhancer_node.cpp.
pthread_cond_t g_cond_moa = PTHREAD_COND_INITIALIZER |
Definition at line 85 of file moving_objects_confidence_enhancer_node.cpp.
std::vector<find_moving_objects::MovingObjectArray::ConstPtr> g_msg_buffer_moa |
Definition at line 83 of file moving_objects_confidence_enhancer_node.cpp.
pthread_mutex_t g_mutex_moa = PTHREAD_MUTEX_INITIALIZER |
Definition at line 84 of file moving_objects_confidence_enhancer_node.cpp.
ros::NodeHandle* g_node |
Definition at line 73 of file moving_objects_confidence_enhancer_node.cpp.
int g_nr_senders = 0 |
Definition at line 88 of file moving_objects_confidence_enhancer_node.cpp.
ros::Publisher g_pub_moaf |
Definition at line 79 of file moving_objects_confidence_enhancer_node.cpp.
ros::Publisher g_pub_objects_closest_point_markers |
Definition at line 77 of file moving_objects_confidence_enhancer_node.cpp.
ros::Publisher g_pub_objects_velocity_arrows |
Definition at line 78 of file moving_objects_confidence_enhancer_node.cpp.
int g_sender_index = -1 |
Definition at line 87 of file moving_objects_confidence_enhancer_node.cpp.
const double TWO_PI = 2 * M_PI |
Definition at line 70 of file moving_objects_confidence_enhancer_node.cpp.