$search
Classes | |
class | MoveArm |
struct | MoveArmParameters |
class | MoveArmSetup |
Configuration of actions that need to actuate parts of the robot. More... | |
Enumerations | |
enum | ControllerStatus { QUEUED, ACTIVE, SUCCESS, FAILED } |
enum | EnvironmentServerChecks { COLLISION_TEST = 1, PATH_CONSTRAINTS_TEST = 2, GOAL_CONSTRAINTS_TEST = 4, JOINT_LIMITS_TEST = 8, CHECK_FULL_TRAJECTORY = 16 } |
enum | MoveArmState { PLANNING, START_CONTROL, VISUALIZE_PLAN, MONITOR } |
Variables | |
static const std::string | 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 | 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 | 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 | 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 | DISPLAY_JOINT_GOAL_PUB_TOPIC = "display_joint_goal" |
static const std::string | DISPLAY_PATH_PUB_TOPIC = "display_path" |
static const double | MAX_TRAJECTORY_MONITORING_FREQUENCY = 100.0 |
static const double | MIN_TRAJECTORY_MONITORING_FREQUENCY = 1.0 |
static const std::string | 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 | |
static const std::string | SET_PLANNING_SCENE_DIFF_NAME = "/environment_server/set_planning_scene_diff" |
static const std::string | TRAJECTORY_FILTER = "/trajectory_filter_server/filter_trajectory_with_constraints" |
Definition at line 98 of file move_arm_simple_action.cpp.
COLLISION_TEST | |
PATH_CONSTRAINTS_TEST | |
GOAL_CONSTRAINTS_TEST | |
JOINT_LIMITS_TEST | |
CHECK_FULL_TRAJECTORY |
Definition at line 105 of file move_arm_simple_action.cpp.
Definition at line 91 of file move_arm_simple_action.cpp.
static const std::string move_arm::ARM_IK_NAME = "arm_ik" [static] |
the string used internally to access inverse kinematics service; this should be remaped in the launch file
Definition at line 66 of file move_arm_setup.h.
const std::string move_arm::CONTROL_CANCEL_NAME = "controller_cancel" [static] |
the string used internally to access control canceling service; this should be remaped in the launch file
Definition at line 60 of file move_arm_setup.h.
const std::string move_arm::CONTROL_QUERY_NAME = "controller_query" [static] |
the string used internally to access control querying service; this should be remaped in the launch file
Definition at line 57 of file move_arm_setup.h.
const std::string move_arm::CONTROL_START_NAME = "controller_start" [static] |
the string used internally to access control starting service; this should be remaped in the launch file
Definition at line 54 of file move_arm_setup.h.
const std::string move_arm::DISPLAY_JOINT_GOAL_PUB_TOPIC = "display_joint_goal" [static] |
Definition at line 126 of file move_arm_simple_action.cpp.
const std::string move_arm::DISPLAY_PATH_PUB_TOPIC = "display_path" [static] |
Definition at line 125 of file move_arm_simple_action.cpp.
const double move_arm::MAX_TRAJECTORY_MONITORING_FREQUENCY = 100.0 [static] |
Definition at line 132 of file move_arm_simple_action.cpp.
const double move_arm::MIN_TRAJECTORY_MONITORING_FREQUENCY = 1.0 [static] |
Definition at line 131 of file move_arm_simple_action.cpp.
const std::string move_arm::SEARCH_VALID_STATE_NAME = "get_valid_state" [static] |
the string used internally to access valid state searching service; this should be remaped in the launch file
Definition at line 63 of file move_arm_setup.h.
const std::string move_arm::SET_PLANNING_SCENE_DIFF_NAME = "/environment_server/set_planning_scene_diff" [static] |
Definition at line 130 of file move_arm_simple_action.cpp.
const std::string move_arm::TRAJECTORY_FILTER = "/trajectory_filter_server/filter_trajectory_with_constraints" [static] |
Definition at line 124 of file move_arm_simple_action.cpp.