#include <ros/ros.h>
#include <arm_control_msgs/TrajectoryStart.h>
#include <arm_control_msgs/TrajectoryQuery.h>
#include <arm_control_msgs/TrajectoryCancel.h>
#include <planning_environment/monitors/planning_monitor.h>
Go to the source code of this file.
Classes | |
class | move_arm::MoveArmSetup |
Configuration of actions that need to actuate parts of the robot. | |
Namespaces | |
namespace | move_arm |
Variables | |
static const std::string | move_arm::ARM_IK_NAME = "arm_ik" |
the string used internally to access inverse kinematics service; this should be remaped in the launch file | |
static const std::string | move_arm::CONTROL_CANCEL_NAME = "controller_cancel" |
the string used internally to access control canceling service; this should be remaped in the launch file | |
static const std::string | move_arm::CONTROL_QUERY_NAME = "controller_query" |
the string used internally to access control querying service; this should be remaped in the launch file | |
static const std::string | move_arm::CONTROL_START_NAME = "controller_start" |
the string used internally to access control starting service; this should be remaped in the launch file | |
static const std::string | move_arm::SEARCH_VALID_STATE_NAME = "get_valid_state" |
the string used internally to access valid state searching service; this should be remaped in the launch file |