Only released in EOL distros:
Package Summary
fast_plane_detector
- Author: Jeannette Bohg
- License: BSD
- Repository: wg-ros-pkg
- Source: svn https://code.ros.org/svn/wg-ros-pkg/stacks/tabletop_object_perception/tags/tabletop_object_perception-0.4.3
Package Summary
fast_plane_detector
- Author: Jeannette Bohg
- License: BSD
- Source: svn https://code.ros.org/svn/wg-ros-pkg/stacks/pr2_object_manipulation/branches/0.5-branch
pr2_object_manipulation: active_realtime_segmentation | fast_plane_detection | manipulation_worlds | object_recognition_gui | object_segmentation_gui | pick_and_place_demo_app | pr2_create_object_model | pr2_grasp_adjust | pr2_gripper_grasp_controller | pr2_gripper_grasp_planner_cluster | pr2_gripper_reactive_approach | pr2_gripper_sensor_action | pr2_gripper_sensor_controller | pr2_gripper_sensor_msgs | pr2_handy_tools | pr2_interactive_gripper_pose_action | pr2_interactive_manipulation | pr2_interactive_object_detection | pr2_manipulation_controllers | pr2_marker_control | pr2_navigation_controllers | pr2_object_manipulation_launch | pr2_object_manipulation_msgs | pr2_pick_and_place_demos | pr2_pick_and_place_tutorial | pr2_tabletop_manipulation_launch | pr2_wrappers | rgbd_assembler | robot_self_filter_color | segmented_clutter_grasp_planner | tabletop_collision_map_processing | tabletop_object_detector | tf_throttle
Package Summary
fast_plane_detector
- Author: Jeannette Bohg
- License: BSD
- Source: svn https://code.ros.org/svn/wg-ros-pkg/stacks/pr2_object_manipulation/branches/0.6-branch
Package Summary
fast_plane_detector
- Author: Jeannette Bohg
- License: BSD
- Source: svn https://code.ros.org/svn/wg-ros-pkg/stacks/pr2_object_manipulation/trunk
Overview
This package provides a real time plane detection method extracted from the package active_realtime_segmentation where it is used to find the most likely table plane in the scene. However, any plane pose can be detected. The plane detection is based on RANSAC and uses a disparity map as input.
Starting the Fast Plane Detector
The following launch file will read in disparity maps from a given topic (by default it takes /narrow_stereo_textured/disparity) and outputs the table plane parameters as well as a disparity image with the detected table plane filtered out.
roslaunch fast_plane_detection fast_plane_detection_jean.launch
To detect a local plane in a region around a specific pixel position in the image, run the following ros node.
rosrun fast_plane_detection fast_region_plane_detector_jean disparity_in:=/plane_detection/disparity disparity_image_topic:=/narrow_stereo_textured/disparity cam_info_in:=/narrow_stereo_textured/left/camera_info
Here it takes as input the topics, on which the node launched by the previous launch file is publishing.
Example Results
The following results are extracted from the following disparity map originating from the textured light stereo on the PR2.
When using the real time table plane detector, the following disparity map in which all the values belonging to the detected table are removed is the result.
Given a specific pixel position and a size of region around that, the disparity map can be masked and a plane fit to the local region.
The detected planes can be visualised in Rviz.