#include <ros/ros.h>
#include <cortex_stream/cortex.h>
#include <map>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MarkerArray.h>
#include <std_msgs/ColorRGBA.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/Vector3.h>
#include <boost/thread.hpp>
#include <boost/lexical_cast.hpp>
#include <limits>
Go to the source code of this file.
Classes | |
struct | MocapInterface::BodyDefinition |
class | MocapInterface |
Functions | |
void | CortexDataHandler (sFrameOfData *frame, void *params) |
void | CortexErrorMsgHandler (int iLevel, const char *szMsg, void *) |
int | main (int argc, char **argv) |
Variables | |
ros::Publisher | marker_pub |
void CortexDataHandler | ( | sFrameOfData * | frame, |
void * | params | ||
) |
Definition at line 109 of file cortex_stream.cpp.
void CortexErrorMsgHandler | ( | int | iLevel, |
const char * | szMsg, | ||
void * | |||
) |
Definition at line 190 of file cortex_stream.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 275 of file cortex_stream.cpp.
Definition at line 35 of file cortex_stream.cpp.