#include "AttentionAlgorithm.h"
#include "XMLTag.h"
#include <pluginlib/class_loader.h>
#include <time.h>
#include "RemoteAttention.h"
#include <std_msgs/UInt64.h>
Go to the source code of this file.
Namespaces | |
namespace | cop |
all functionality of the project cognitive perception is in the cop namespace Have a closer look to the interfaces that are provided by cognitive_perception: | |
Defines | |
#define | TRACKING_POSSIBLE_MS 2 |
Variables | |
pluginlib::ClassLoader < AttentionAlgorithm > | s_attalg_loader ("cognitive_perception","AttentionAlgorithm") |
#define TRACKING_POSSIBLE_MS 2 |
Definition at line 33 of file AttentionAlgorithm.cpp.
pluginlib::ClassLoader<AttentionAlgorithm> s_attalg_loader("cognitive_perception","AttentionAlgorithm") |