#include <boost/thread.hpp>
#include <boost/noncopyable.hpp>
#include <ros/ros.h>
#include <actionlib/server/simple_action_server.h>
#include <urdf/model.h>
#include <tf/transform_broadcaster.h>
#include <std_msgs/Int8.h>
#include <metralabs_msgs/IDAndFloat.h>
#include <metralabs_msgs/SchunkStatus.h>
#include <sensor_msgs/JointState.h>
#include <trajectory_msgs/JointTrajectory.h>
#include <control_msgs/JointTrajectoryControllerState.h>
#include <control_msgs/FollowJointTrajectoryAction.h>
#include "RobotArm.h"
#include "AmtecProtocolArm.h"
#include "SchunkProtocolArm.h"
#include "LWA3ArmUASHH.h"
#include "PowerCubeArmUUISRC.h"
Go to the source code of this file.
Define Documentation
Value:( (value)==0 ? 0 : \
( \
(value)>0 ? \
( (value) > (lim) ? (value) : (0) ) : \
( (value) < -(lim) ? (value) : (0) ) \
) \
)
Value:( (value)==0 ? 0 : \
( \
(value)>0 ? \
std::max((value), (def)) : \
std::min((value), -(def)) \
) \
)