Variables | |
static const std::string | DEFAULT_ARM_GROUP = "sia20d_arm" |
static const std::string | DEFAULT_GRASP_ACTION_SERVICE = "/grasp_execution_action" |
static const std::string | DEFAULT_GRASP_PLANNING_SERVICE = "/plan_point_cluster_grasp" |
static const std::string | DEFAULT_GRIPPER_GROUP = "end_effector" |
static const std::string | DEFAULT_GRIPPER_LINK = "palm" |
static const std::string | DEFAULT_IK_PLUGING = "SIA20D_Mesh_manipulator_kinematics/IKFastKinematicsPlugin" |
static const std::string | DEFAULT_JOINT_STATES_TOPIC = "/joint_states" |
static const std::string | DEFAULT_MESH_DATABASE_SERVICE = "/objects_database_node/get_model_mesh" |
static const std::string | DEFAULT_MODEL_DATABASE_SERVICE = "/objects_database_node/get_model_description" |
static const std::string | DEFAULT_PATH_PLANNER_SERVICE = "/ompl_planning/plan_kinematic_path" |
static const std::string | DEFAULT_PLANNING_SCENE_SERVICE = "/environment_server/set_planning_scene_diff" |
static const std::string | DEFAULT_RECOGNITION_SERVICE = "/tabletop_object_recognition" |
static const std::string | DEFAULT_SEGMENTATION_SERVICE = "/tabletop_segmentation" |
static const std::string | DEFAULT_TRAJECTORY_ACTION_SERVICE = "/joint_trajectory_action" |
static const std::string | DEFAULT_TRAJECTORY_FILTER_SERVICE = "/trajectory_filter_server/filter_trajectory_with_constraints" |
static const std::string | DEFAULT_WRIST_LINK = "link_t" |
static const double | DF_PICK_APPROACH_DISTANCE = 0.1f |
static const double | DF_PLACE_APPROACH_DISTANCE = 0.1f |
static const double | DF_PLACE_RETREAT_DISTANCE = 0.1f |
static const std::string | PARAM_NAME_ARM_GROUP = "arm_group" |
static const std::string | PARAM_NAME_GRASP_ACTION_SERVICE = "grasp_action_service_name" |
static const std::string | PARAM_NAME_GRASP_PLANNING_SERVICE = "grasp_planning_service_name" |
static const std::string | PARAM_NAME_GRIPPER_GROUP = "gripper_group" |
static const std::string | PARAM_NAME_GRIPPER_LINK = "gripper_link" |
static const std::string | PARAM_NAME_IK_PLUGING = "arm_inverse_kinematics_plugin" |
static const std::string | PARAM_NAME_JOINT_STATES_TOPIC = "joint_state_topic" |
static const std::string | PARAM_NAME_MESH_DATABASE_SERVICE = "mesh_database_service_name" |
static const std::string | PARAM_NAME_MODEL_DATABASE_SERVICE = "model_database_service_name" |
static const std::string | PARAM_NAME_PATH_PLANNER_SERVICE = "planner_service_name" |
static const std::string | PARAM_NAME_PLANNING_SCENE_SERVICE = "planning_scene_service_name" |
static const std::string | PARAM_NAME_RECOGNITION_SERVICE = "recognition_service_name" |
static const std::string | PARAM_NAME_SEGMENTATION_SERVICE = "segmentation_service_name" |
static const std::string | PARAM_NAME_TRAJECTORY_ACTION_SERVICE = "joint_trajectory_service_name" |
static const std::string | PARAM_NAME_TRAJECTORY_FILTER_SERVICE = "trajectory_filter_service_name" |
static const std::string | PARAM_NAME_WRIST_LINK = "wrist_link" |
static const std::string | PARAM_PICK_APPROACH_DISTANCE = "/pick_approach_distance" |
static const std::string | PARAM_PLACE_APPROACH_DISTANCE = "/place_approach_distance" |
static const std::string | PARAM_PLACE_RETREAT_DISTANCE = "/place_retreat_distance" |
const std::string RobotNavigatorParameters::DEFAULT_ARM_GROUP = "sia20d_arm" [static] |
Definition at line 52 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_GRASP_ACTION_SERVICE = "/grasp_execution_action" [static] |
Definition at line 56 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_GRASP_PLANNING_SERVICE = "/plan_point_cluster_grasp" [static] |
Definition at line 62 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_GRIPPER_GROUP = "end_effector" [static] |
Definition at line 53 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_GRIPPER_LINK = "palm" [static] |
Definition at line 55 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_IK_PLUGING = "SIA20D_Mesh_manipulator_kinematics/IKFastKinematicsPlugin" [static] |
Definition at line 66 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_JOINT_STATES_TOPIC = "/joint_states" [static] |
Definition at line 67 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_MESH_DATABASE_SERVICE = "/objects_database_node/get_model_mesh" [static] |
Definition at line 63 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_MODEL_DATABASE_SERVICE = "/objects_database_node/get_model_description" [static] |
Definition at line 64 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_PATH_PLANNER_SERVICE = "/ompl_planning/plan_kinematic_path" [static] |
Definition at line 58 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_PLANNING_SCENE_SERVICE = "/environment_server/set_planning_scene_diff" [static] |
Definition at line 65 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_RECOGNITION_SERVICE = "/tabletop_object_recognition" [static] |
Definition at line 60 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_SEGMENTATION_SERVICE = "/tabletop_segmentation" [static] |
Definition at line 59 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_TRAJECTORY_ACTION_SERVICE = "/joint_trajectory_action" [static] |
Definition at line 57 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_TRAJECTORY_FILTER_SERVICE = "/trajectory_filter_server/filter_trajectory_with_constraints" [static] |
Definition at line 61 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::DEFAULT_WRIST_LINK = "link_t" [static] |
Definition at line 54 of file RobotNavigator.h.
const double RobotNavigatorParameters::DF_PICK_APPROACH_DISTANCE = 0.1f [static] |
Definition at line 68 of file RobotNavigator.h.
const double RobotNavigatorParameters::DF_PLACE_APPROACH_DISTANCE = 0.1f [static] |
Definition at line 69 of file RobotNavigator.h.
const double RobotNavigatorParameters::DF_PLACE_RETREAT_DISTANCE = 0.1f [static] |
Definition at line 70 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_ARM_GROUP = "arm_group" [static] |
Definition at line 73 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_GRASP_ACTION_SERVICE = "grasp_action_service_name" [static] |
Definition at line 77 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_GRASP_PLANNING_SERVICE = "grasp_planning_service_name" [static] |
Definition at line 83 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_GRIPPER_GROUP = "gripper_group" [static] |
Definition at line 74 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_GRIPPER_LINK = "gripper_link" [static] |
Definition at line 76 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_IK_PLUGING = "arm_inverse_kinematics_plugin" [static] |
Definition at line 87 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_JOINT_STATES_TOPIC = "joint_state_topic" [static] |
Definition at line 88 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_MESH_DATABASE_SERVICE = "mesh_database_service_name" [static] |
Definition at line 84 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_MODEL_DATABASE_SERVICE = "model_database_service_name" [static] |
Definition at line 85 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_PATH_PLANNER_SERVICE = "planner_service_name" [static] |
Definition at line 79 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_PLANNING_SCENE_SERVICE = "planning_scene_service_name" [static] |
Definition at line 86 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_RECOGNITION_SERVICE = "recognition_service_name" [static] |
Definition at line 82 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_SEGMENTATION_SERVICE = "segmentation_service_name" [static] |
Definition at line 81 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_TRAJECTORY_ACTION_SERVICE = "joint_trajectory_service_name" [static] |
Definition at line 78 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_TRAJECTORY_FILTER_SERVICE = "trajectory_filter_service_name" [static] |
Definition at line 80 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_NAME_WRIST_LINK = "wrist_link" [static] |
Definition at line 75 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_PICK_APPROACH_DISTANCE = "/pick_approach_distance" [static] |
Definition at line 89 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_PLACE_APPROACH_DISTANCE = "/place_approach_distance" [static] |
Definition at line 90 of file RobotNavigator.h.
const std::string RobotNavigatorParameters::PARAM_PLACE_RETREAT_DISTANCE = "/place_retreat_distance" [static] |
Definition at line 91 of file RobotNavigator.h.