Functions | |
| def | annotations_to_viz_markers |
| def | anntation_to_viz_marker |
| def | laser_scan_to_point_cloud |
| converter Function | |
| def rocon_qt_library.utils.converts.annotations_to_viz_markers | ( | annotations | ) |
world_canvas_msgs.Annotations to visualization_msgs.MarkerArray
Definition at line 38 of file converts.py.
| def rocon_qt_library.utils.converts.anntation_to_viz_marker | ( | a, | |
| marker_id | |||
| ) |
Definition at line 52 of file converts.py.
| def rocon_qt_library.utils.converts.laser_scan_to_point_cloud | ( | laser_scan_msg, | |
density = 100 |
|||
| ) |
converter Function
Change type
:param sensor_msgs.LaserScan laser_scan_msg: laser scans data (r, theta) type
:param int intensity: laser scans data (r, theta) type
Definition at line 19 of file converts.py.