#include <simple_robot_control/arm_control.h>#include <tf/transform_listener.h>#include <move_arm_msgs/utils.h>#include <ros/ros.h>#include <string>#include <vector>#include <ostream>#include "ros/serialization.h"#include "ros/builtin_message_traits.h"#include "ros/message_operations.h"#include "ros/message.h"#include "ros/time.h"#include "std_msgs/Header.h"#include "geometry_msgs/Pose.h"#include "geometry_msgs/Point.h"#include <tf/tf.h>#include "trajectory_msgs/JointTrajectory.h"#include <motion_planning_msgs/RobotState.h>#include <motion_planning_msgs/JointConstraint.h>#include <sensor_msgs/JointState.h>#include <motion_planning_msgs/OrientationConstraint.h>#include <motion_planning_msgs/SimplePoseConstraint.h>#include <motion_planning_msgs/PositionConstraint.h>#include <motion_planning_msgs/ArmNavigationErrorCodes.h>#include "ros/service_traits.h"#include "motion_planning_msgs/MotionPlanRequest.h"#include "motion_planning_msgs/RobotTrajectory.h"#include <move_arm_msgs/MoveArmGoal.h>

Go to the source code of this file.
Namespaces | |
| namespace | simple_robot_control |
Defines | |
| #define | HALF_SQRT_TWO 0.707106781 |
| #define HALF_SQRT_TWO 0.707106781 |
Definition at line 8 of file arm_control.cpp.