#!/usr/bin/env python

import rospy
from moveit_ros_planning_interface._moveit_move_group_interface import (
    MoveGroupInterface,
)

group = MoveGroupInterface("manipulator", "robot_description", rospy.get_namespace())
Пример #2
0
 def setUpClass(self):
     self.group = MoveGroupInterface(self.PLANNING_GROUP,
                                     "robot_description")
Пример #3
0
 def setUpClass(self):
     self.group = MoveGroupInterface(self.PLANNING_GROUP,
                                     "robot_description",
                                     rospy.get_namespace())
Пример #4
0
#!/usr/bin/env python

from moveit_ros_planning_interface._moveit_move_group_interface import MoveGroupInterface
group = MoveGroupInterface("manipulator", "robot_description")