Functions
hek_teleop.cpp File Reference

The ROS hek_teleop node class implementation. More...

#include <sys/types.h>
#include <stdlib.h>
#include <unistd.h>
#include <stdio.h>
#include <math.h>
#include <string.h>
#include <string>
#include <map>
#include <boost/bind.hpp>
#include "boost/assign.hpp"
#include "ros/ros.h"
#include "actionlib/server/simple_action_server.h"
#include "trajectory_msgs/JointTrajectory.h"
#include "sensor_msgs/JointState.h"
#include "industrial_msgs/RobotStatus.h"
#include "hekateros_control/HekJointStateExtended.h"
#include "hekateros_control/HekRobotStatusExtended.h"
#include "hekateros_control/Calibrate.h"
#include "hekateros_control/ClearAlarms.h"
#include "hekateros_control/CloseGripper.h"
#include "hekateros_control/EStop.h"
#include "hekateros_control/Freeze.h"
#include "hekateros_control/GetProductInfo.h"
#include "hekateros_control/GotoBalancedPos.h"
#include "hekateros_control/GotoParkedPos.h"
#include "hekateros_control/GotoZeroPt.h"
#include "hekateros_control/IsAlarmed.h"
#include "hekateros_control/IsCalibrated.h"
#include "hekateros_control/IsDescLoaded.h"
#include "hekateros_control/OpenGripper.h"
#include "hekateros_control/Release.h"
#include "hekateros_control/ResetEStop.h"
#include "hekateros_control/SetRobotMode.h"
#include "hekateros_control/Stop.h"
#include "hid/ConnStatus.h"
#include "hid/Controller360State.h"
#include "hid/LEDPattern.h"
#include "hid/RumbleCmd.h"
#include "hid/SetLED.h"
#include "hid/SetRumble.h"
#include "rnr/rnrconfig.h"
#include "rnr/log.h"
#include "rnr/hid/HIDXbox360.h"
#include "Hekateros/hekateros.h"
#include "Hekateros/hekXmlCfg.h"
#include "Hekateros/hekRobot.h"
#include "Hekateros/hekUtils.h"
#include "hek_teleop.h"
Include dependency graph for hek_teleop.cpp:

Go to the source code of this file.

Functions

static string JointNameBaseRot ("base_rot")
static string JointNameElbow ("elbow")
static string JointNameGrip ("grip")
static string JointNameShoulder ("shoulder")
static string JointNameWristPitch ("wrist_pitch")
static string JointNameWristRot ("wrist_rot")

Detailed Description

The ROS hek_teleop node class implementation.

$LastChangedDate$ $Rev$

Author:
Daniel Packard (daniel@roadnarrows.com)
Robin Knight (robin.knight@roadnarrows.com)
Copyright:
(C) 2013-2014 RoadNarrows (http://www.roadnarrows.com)
All Rights Reserved

Definition in file hek_teleop.cpp.


Function Documentation

static string JointNameBaseRot ( "base_rot"  ) [static]
static string JointNameElbow ( "elbow"  ) [static]
static string JointNameGrip ( "grip"  ) [static]
static string JointNameShoulder ( "shoulder"  ) [static]
static string JointNameWristPitch ( "wrist_pitch"  ) [static]
static string JointNameWristRot ( "wrist_rot"  ) [static]


hekateros_control
Author(s): Robin Knight , Daniel Packard
autogenerated on Mon Oct 6 2014 00:36:42