#include <ros/ros.h>
#include <ros/package.h>
#include <std_msgs/UInt8.h>
#include <std_msgs/String.h>
#include <XnOpenNI.h>
#include <XnCppWrapper.h>
#include <XnVHandPointContext.h>
#include <XnVSessionManager.h>
#include <XnVSwipeDetector.h>
#include <XnVSteadyDetector.h>
#include <XnVPushDetector.h>
#include <XnVWaveDetector.h>
Go to the source code of this file.
Defines | |
#define | CHECK_ERRORS(rc, errors, what) |
#define | CHECK_RC(rc, what) |
Enumerations | |
enum | SessionState { IN_SESSION, NOT_IN_SESSION, QUICK_REFOCUS } |
Functions | |
void | CleanupExit () |
int | main (int argc, char **argv) |
void XN_CALLBACK_TYPE | NoHands (void *UserCxt) |
void | Publish_String (std::string str) |
void XN_CALLBACK_TYPE | Push_OnPush (XnFloat fVelocity, XnFloat fAngle, void *cxt) |
void XN_CALLBACK_TYPE | SessionEnd (void *UserCxt) |
void XN_CALLBACK_TYPE | SessionStart (const XnPoint3D &pFocus, void *UserCxt) |
void XN_CALLBACK_TYPE | Steady_OnSteady (XnUInt32 nId, XnFloat fVelocity, void *cxt) |
void XN_CALLBACK_TYPE | Swipe_SwipeDown (XnFloat fVelocity, XnFloat fAngle, void *cxt) |
void XN_CALLBACK_TYPE | Swipe_SwipeLeft (XnFloat fVelocity, XnFloat fAngle, void *cxt) |
void XN_CALLBACK_TYPE | Swipe_SwipeRight (XnFloat fVelocity, XnFloat fAngle, void *cxt) |
void XN_CALLBACK_TYPE | Swipe_SwipeUp (XnFloat fVelocity, XnFloat fAngle, void *cxt) |
Variables | |
xn::Context | g_Context |
XnVPushDetector * | g_pPushDetector |
XnVSessionManager * | g_pSessionManager = NULL |
XnVSteadyDetector * | g_pSteadyDetector |
XnVSwipeDetector * | g_pSwipeDetector |
XnVWaveDetector * | g_pWaveDetector |
SessionState | g_SessionState = NOT_IN_SESSION |
ros::Publisher | swipe_pub |
ros::Publisher | swipe_status_pub |
#define CHECK_ERRORS | ( | rc, | |
errors, | |||
what | |||
) |
if (rc == XN_STATUS_NO_NODE_PRESENT) \ { \ XnChar strError[1024]; \ errors.ToString(strError, 1024); \ printf("%s\n", strError); \ return (rc); \ }
Definition at line 118 of file openni_swipe.cpp.
#define CHECK_RC | ( | rc, | |
what | |||
) |
if (rc != XN_STATUS_OK) \ { \ printf("%s failed: %s\n", what, xnGetStatusString(rc)); \ return rc; \ }
Definition at line 111 of file openni_swipe.cpp.
enum SessionState |
Definition at line 28 of file openni_swipe.cpp.
void CleanupExit | ( | ) |
Definition at line 78 of file openni_swipe.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 127 of file openni_swipe.cpp.
void XN_CALLBACK_TYPE NoHands | ( | void * | UserCxt | ) |
Definition at line 105 of file openni_swipe.cpp.
void Publish_String | ( | std::string | str | ) |
Definition at line 38 of file openni_swipe.cpp.
void XN_CALLBACK_TYPE Push_OnPush | ( | XnFloat | fVelocity, |
XnFloat | fAngle, | ||
void * | cxt | ||
) |
Definition at line 73 of file openni_swipe.cpp.
void XN_CALLBACK_TYPE SessionEnd | ( | void * | UserCxt | ) |
Definition at line 99 of file openni_swipe.cpp.
void XN_CALLBACK_TYPE SessionStart | ( | const XnPoint3D & | pFocus, |
void * | UserCxt | ||
) |
Definition at line 93 of file openni_swipe.cpp.
void XN_CALLBACK_TYPE Steady_OnSteady | ( | XnUInt32 | nId, |
XnFloat | fVelocity, | ||
void * | cxt | ||
) |
Definition at line 67 of file openni_swipe.cpp.
void XN_CALLBACK_TYPE Swipe_SwipeDown | ( | XnFloat | fVelocity, |
XnFloat | fAngle, | ||
void * | cxt | ||
) |
Definition at line 51 of file openni_swipe.cpp.
void XN_CALLBACK_TYPE Swipe_SwipeLeft | ( | XnFloat | fVelocity, |
XnFloat | fAngle, | ||
void * | cxt | ||
) |
Definition at line 56 of file openni_swipe.cpp.
void XN_CALLBACK_TYPE Swipe_SwipeRight | ( | XnFloat | fVelocity, |
XnFloat | fAngle, | ||
void * | cxt | ||
) |
Definition at line 61 of file openni_swipe.cpp.
void XN_CALLBACK_TYPE Swipe_SwipeUp | ( | XnFloat | fVelocity, |
XnFloat | fAngle, | ||
void * | cxt | ||
) |
Definition at line 46 of file openni_swipe.cpp.
xn::Context g_Context |
Definition at line 36 of file openni_swipe.cpp.
XnVPushDetector* g_pPushDetector |
Definition at line 24 of file openni_swipe.cpp.
XnVSessionManager* g_pSessionManager = NULL |
Definition at line 22 of file openni_swipe.cpp.
XnVSteadyDetector* g_pSteadyDetector |
Definition at line 26 of file openni_swipe.cpp.
XnVSwipeDetector* g_pSwipeDetector |
Definition at line 23 of file openni_swipe.cpp.
XnVWaveDetector* g_pWaveDetector |
Definition at line 25 of file openni_swipe.cpp.
Definition at line 34 of file openni_swipe.cpp.
Definition at line 7 of file openni_swipe.cpp.
Definition at line 8 of file openni_swipe.cpp.