Main Page
Namespaces
Classes
Files
File List
scripts
move_to_start.py
Go to the documentation of this file.
1
#!/usr/bin/env python
2
3
import
rospy
4
from
moveit_commander
import
MoveGroupCommander
5
from
actionlib_msgs.msg
import
GoalStatusArray
6
7
if
__name__ ==
'__main__'
:
8
rospy.init_node(
'move_to_start'
)
9
rospy.wait_for_message(
'move_group/status'
, GoalStatusArray)
10
commander = MoveGroupCommander(
'panda_arm'
)
11
commander.set_named_target(
'ready'
)
12
commander.go()
franka_example_controllers
Author(s): Franka Emika GmbH
autogenerated on Fri Oct 23 2020 03:47:17