Classes | Public Member Functions | Private Member Functions | Static Private Member Functions | Private Attributes
tracker_impl Class Reference

#include <tracker_impl.h>

List of all members.

Classes

struct  fulcrum

Public Member Functions

bool loadCalibFile (const char *srcFileName)
bool loadCalibFile (const char *srcFileName)
void start ()
void start ()
void stop ()
void stop ()
 tracker_impl (trackerID t, BirdTrack_impl *b, std::string trackerName)
 tracker_impl (trackerID t, BirdTrack_impl *b, std::string trackerName)
 ~tracker_impl ()
 ~tracker_impl ()

Private Member Functions

void getPbdObject (std::string name, double *data, asr_msgs::AsrObject &object)
void getTransform (double *data, tf::Transform &transform)
bool loadCalibration (const fulcrum cal[255], unsigned int length)
bool loadCalibration (const fulcrum cal[255], unsigned int length)
void printFulcrum (fulcrum fulc)
void printFulcrum (fulcrum fulc)
void workerThread ()
 this method is called by static method s_workerthread
void workerThread ()
 this method is called by static method s_workerthread
bool writeNotification (trackerID id, double *raw, double *calibrated)
bool writeNotification (kogmo_rtdb_obj_info_t &dataobj_info, double *)

Static Private Member Functions

static void * s_workerThread (void *arg)
 Thread is bound to this method.
static void * s_workerThread (void *arg)
 Thread is bound to this method.

Private Attributes

kogmo_rtdb_obj_e1_fobtracker_t * dataobj_data
kogmo_rtdb_obj_info_t dataobj_info_data
kogmo_rtdb_obj_info_t dataobj_info_raw
kogmo_rtdb_obj_e1_fobtracker_t * dataobj_raw
kogmo_rtdb_handle_t * dbc
kogmo_rtdb_connect_info_t dbinfo
ros::Publisher generalPublisher
BirdTrack_implmyBird
trackerID myID
transformCoordsmyTransformer
ros::NodeHandle node
kogmo_rtdb_objid_t oid
kogmo_rtdb_objid_t pid
unsigned int seqId
bool threadRunning
 flag switching on/off thread
tf::TransformBroadcaster transformPublisher
pthread_t workerThreadHandle
 Thread for delivering tracker data to nCenter.

Detailed Description

Definition at line 51 of file include/tracker_impl.h.


Constructor & Destructor Documentation

tracker_impl::tracker_impl ( trackerID  t,
BirdTrack_impl b,
std::string  trackerName 
)

initialize rtdb connection

tracker

thread initialize

Definition at line 42 of file kogmo_fob/trackerServer/tracker_impl.cc.

Definition at line 80 of file kogmo_fob/trackerServer/tracker_impl.cc.

tracker_impl::tracker_impl ( trackerID  t,
BirdTrack_impl b,
std::string  trackerName 
)

Member Function Documentation

void tracker_impl::getPbdObject ( std::string  name,
double *  data,
asr_msgs::AsrObject &  object 
) [private]

Definition at line 249 of file src/tracker_impl.cc.

void tracker_impl::getTransform ( double *  data,
tf::Transform transform 
) [private]

Definition at line 296 of file src/tracker_impl.cc.

bool tracker_impl::loadCalibFile ( const char *  srcFileName)

Definition at line 215 of file kogmo_fob/trackerServer/tracker_impl.cc.

bool tracker_impl::loadCalibFile ( const char *  srcFileName)
bool tracker_impl::loadCalibration ( const fulcrum  cal[255],
unsigned int  length 
) [private]

Definition at line 287 of file kogmo_fob/trackerServer/tracker_impl.cc.

bool tracker_impl::loadCalibration ( const fulcrum  cal[255],
unsigned int  length 
) [private]
void tracker_impl::printFulcrum ( fulcrum  fulc) [private]

Definition at line 279 of file kogmo_fob/trackerServer/tracker_impl.cc.

void tracker_impl::printFulcrum ( fulcrum  fulc) [private]
void * tracker_impl::s_workerThread ( void *  arg) [static, private]

Thread is bound to this method.

Definition at line 93 of file kogmo_fob/trackerServer/tracker_impl.cc.

static void* tracker_impl::s_workerThread ( void *  arg) [static, private]

Thread is bound to this method.

void tracker_impl::start ( void  )

start thread

Definition at line 190 of file kogmo_fob/trackerServer/tracker_impl.cc.

void tracker_impl::stop ( void  )

stop thread

Definition at line 205 of file kogmo_fob/trackerServer/tracker_impl.cc.

void tracker_impl::workerThread ( ) [private]

this method is called by static method s_workerthread

get data from gloveDevice

get data from fob

Definition at line 126 of file kogmo_fob/trackerServer/tracker_impl.cc.

void tracker_impl::workerThread ( ) [private]

this method is called by static method s_workerthread

bool tracker_impl::writeNotification ( trackerID  id,
double *  raw,
double *  calibrated 
) [private]

Definition at line 303 of file src/tracker_impl.cc.

bool tracker_impl::writeNotification ( kogmo_rtdb_obj_info_t &  dataobj_info,
double *  data 
) [private]

Definition at line 306 of file kogmo_fob/trackerServer/tracker_impl.cc.


Member Data Documentation

kogmo_rtdb_obj_e1_fobtracker_t* tracker_impl::dataobj_data [private]

Definition at line 82 of file kogmo_fob/trackerServer/tracker_impl.h.

kogmo_rtdb_obj_info_t tracker_impl::dataobj_info_data [private]

Definition at line 79 of file kogmo_fob/trackerServer/tracker_impl.h.

kogmo_rtdb_obj_info_t tracker_impl::dataobj_info_raw [private]

Definition at line 80 of file kogmo_fob/trackerServer/tracker_impl.h.

kogmo_rtdb_obj_e1_fobtracker_t* tracker_impl::dataobj_raw [private]

Definition at line 83 of file kogmo_fob/trackerServer/tracker_impl.h.

kogmo_rtdb_handle_t* tracker_impl::dbc [private]

Definition at line 76 of file kogmo_fob/trackerServer/tracker_impl.h.

kogmo_rtdb_connect_info_t tracker_impl::dbinfo [private]

Definition at line 77 of file kogmo_fob/trackerServer/tracker_impl.h.

Definition at line 95 of file include/tracker_impl.h.

Definition at line 64 of file include/tracker_impl.h.

Definition at line 63 of file include/tracker_impl.h.

Definition at line 65 of file include/tracker_impl.h.

Definition at line 94 of file include/tracker_impl.h.

kogmo_rtdb_objid_t tracker_impl::oid [private]

Definition at line 85 of file kogmo_fob/trackerServer/tracker_impl.h.

kogmo_rtdb_objid_t tracker_impl::pid [private]

Definition at line 86 of file kogmo_fob/trackerServer/tracker_impl.h.

unsigned int tracker_impl::seqId [private]

Definition at line 66 of file include/tracker_impl.h.

flag switching on/off thread

Definition at line 78 of file include/tracker_impl.h.

Definition at line 93 of file include/tracker_impl.h.

pthread_t tracker_impl::workerThreadHandle [private]

Thread for delivering tracker data to nCenter.

Definition at line 82 of file include/tracker_impl.h.


The documentation for this class was generated from the following files:


asr_flock_of_birds
Author(s): Bernhardt Andre, Engelmann Stephan, Giesler Björn, Heller Florian, Jäkel Rainer, Nguyen Trung, Pardowitz Michael, Weckesser Peter, Yi Xie, Zöllner Raoul
autogenerated on Sat Jun 8 2019 19:36:23