Go to the source code of this file.
|
int | main (int argc, char **argv) |
|
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
Definition at line 11 of file wam7_test.cpp.
17 auto wam7 = std::make_shared<Robot>(
"wam7");
18 wam7->initialize(
"package://barrett_model/robots/wam_7dof_wam_bhand.urdf.xacro",
19 "package://barrett_wam_moveit_config/config/wam7_hand.srdf",
20 "package://barrett_wam_moveit_config/config/joint_limits.yaml",
21 "package://barrett_wam_moveit_config/config/kinematics.yaml"
25 wam7->loadKinematics(
"arm");
28 auto scene = std::make_shared<Scene>(wam7);
32 auto planner = std::make_shared<OMPL::OMPLPipelinePlanner>(wam7);
36 planner->initialize(
"package://barrett_wam_moveit_config/config/ompl_planning.yaml",
41 request.setStartConfiguration({0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0});
42 request.setGoalConfiguration({0.0, 1.0, 0.0, 1.0, 0.0, 0.0, 0.0});
43 request.setConfig(
"BKPIECE");
47 if (res.
error_code_.val != moveit_msgs::MoveItErrorCodes::SUCCESS)
A helper class to build motion planning requests for a robowflex::Planner.
Settings descriptor for settings provided by the default MoveIt! OMPL planning pipeline.
bool simplify_solutions
Whether or not planner should simplify solutions.
RAII-pattern for starting up ROS.
Functions for loading and animating scenes in Blender.
moveit_msgs::MoveItErrorCodes error_code_