3D costmap as obstacle for MoveIt!
Dear Ros Users,
I am using MoveIt for controlling a robotic arm
Is there a way to use a 3D grid as costmap as obstacle for MoveIT planner? Thanks!
ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange |
Dear Ros Users,
I am using MoveIt for controlling a robotic arm
Is there a way to use a 3D grid as costmap as obstacle for MoveIT planner? Thanks!
While not entirely identical to the way the 2DCostmap works, the Octomap is probably the closest alternative for 3D. Usually, the Octomap is fed by a depth camera, but it is also possible to specify the occupied voxels in any other way. The occupied voxels are then treated as collision obstacles, so MoveIt! planners will avoid any collisions with these voxels.
Have a look at this tutorial to see how it is used with a depth camera. This will also function for any other node publishing sensor_msgs/PointCloud2
messages on the input topic.
Asked: 2016-12-02 03:33:31 -0600
Seen: 1,829 times
Last updated: Dec 02 '16
Voxelgrid where the true position of each voxel is returned
voxel_grid visualization in rviz
ros-fuerte-pcl: bug in libfiter.so? [closed]
PCL Tutorial voxel_grid Permission Denied
Planning sequence of motion using arm_navigation/moveit
Setting up ROS Groovy - can't launch roscore
How to install moveit on fuerte?
How (if possible) to use Groovy dependencies for Fuerte?
MoveIt: installation breaks kinematics_msgs?, bug trac is 404 [closed]