#include <planning_environment/monitors/kinematic_model_state_monitor.h>#include <planning_environment/util/kinematic_state_constraint_evaluator.h>#include <planning_models/kinematic_model.h>#include <planning_models/kinematic_state.h>#include <motion_planning_msgs/Constraints.h>#include <geometric_shapes_msgs/Shape.h>#include <geometric_shapes/bodies.h>#include <geometry_msgs/Pose.h>#include <iostream>#include <vector>#include <boost/scoped_ptr.hpp>#include <move_arm/MoveArmAction.h>

Go to the source code of this file.
Functions | |
| bool | currentStateSatisfiesPathConstraints (const planning_environment::KinematicModelStateMonitor &km, move_arm::MoveArmGoal &goal) |
| void | diffConfig (const planning_environment::KinematicModelStateMonitor &km, move_arm::MoveArmGoal &goal, double &dist, double &angle) |
| btTransform | effPosition (const planning_environment::KinematicModelStateMonitor &km, const move_arm::MoveArmGoal &goal) |
| bool | finalStateMatchesGoal (const planning_environment::KinematicModelStateMonitor &km, move_arm::MoveArmGoal &goal) |
| void | goalToState (const move_arm::MoveArmGoal &goal, planning_models::KinematicState &sp) |
| void | setupGoal (const std::vector< std::string > &names, move_arm::MoveArmGoal &goal) |
| bool currentStateSatisfiesPathConstraints | ( | const planning_environment::KinematicModelStateMonitor & | km, | |
| move_arm::MoveArmGoal & | goal | |||
| ) |
Definition at line 179 of file regression_test_arm_helpers.h.
| void diffConfig | ( | const planning_environment::KinematicModelStateMonitor & | km, | |
| move_arm::MoveArmGoal & | goal, | |||
| double & | dist, | |||
| double & | angle | |||
| ) |
Definition at line 104 of file regression_test_arm_helpers.h.
| btTransform effPosition | ( | const planning_environment::KinematicModelStateMonitor & | km, | |
| const move_arm::MoveArmGoal & | goal | |||
| ) |
Definition at line 96 of file regression_test_arm_helpers.h.
| bool finalStateMatchesGoal | ( | const planning_environment::KinematicModelStateMonitor & | km, | |
| move_arm::MoveArmGoal & | goal | |||
| ) |
Definition at line 163 of file regression_test_arm_helpers.h.
| void goalToState | ( | const move_arm::MoveArmGoal & | goal, | |
| planning_models::KinematicState & | sp | |||
| ) |
Definition at line 87 of file regression_test_arm_helpers.h.
| void setupGoal | ( | const std::vector< std::string > & | names, | |
| move_arm::MoveArmGoal & | goal | |||
| ) |
Definition at line 48 of file regression_test_arm_helpers.h.