robot-interface.l: send angle-vector only once, some controller-table had multiple definition for one method, we ignore them (#308) * test/test-pr2eus-moveit.test only runs on indigo * fix when two controller has same action instance * add dummy controller for #308 * send angle-vector only once, some controller-table had multiple definition for one method, we ignore them
[pr2eus_moveit] fix bug in angle-vector-motion-plan (#309) * fix bug in angle-vector-motion-plan error occur when (length controller-actions) != (length (send self ctype))
this case happens when you init robot-interface with :default-controller, but send av with :rarm-controller.
[pr2eus_moveit] fix typo in total-time condition (#310)
[pr2eus_moveit] fix typo in robot-moveit.l (#306 ) * [(:angle-vector-motion-plan] controller-type -> ctype
Contributors: Kei Okada, Shingo Kitagawa
pr2eus_moveit/euslisp/robot-moveit.l: support tm :fast in :angle-vector-motion-plan (#297 ) * add :scale for :fast in :angle-vector-motion-plan * add trajectory_constraints commentout
trajectory_constraints is not used in motion planning. see https://github.com/ros-planning/moveit_msgs/issues/2
pr2eus_moveit/euslisp/robot-moveit.l: add angle-vector-sequence-motion-plan test (#293 ) * set longer time-limit for moveit test
pass ctype in angle-vector-motion-plan (#292 )
advertise CollisionObject with latch=t (#290 )
Contributors: Kei Okada, Shingo Kitagawa
robot-moveit.l * enable set default planner in moveit-env initialization (#280 ) * [pr2eus_moveit] pass start-offset-time as starttime to :send-trajectory (#276) * pass start-offset-time to :send-trajectory * angle-vector-motion-plan return angle-vector (#268) * angle-vector-motion-plan accepts angle-vector seq
modify :angle-vector-motion-plan to accept angle-vector-sequence set (butlast avs) as TrajectoryConstraints (#259)
collision-object-publisher.l * [pr2eus_moveit/collision-object-publisher] support body class object (#269) * fix bug in collision-object-publisher :wipe-all (#267) * remove unused key in collision-object-publisher (#266)
Contributors: Naoya Yamaguchi, Kei Okada, Shingo Kitagawa