Functions | |
def | og3d_to_og_msg |
convert occupancy_grid_3d object to OccupancyGrid message. | |
def | og_msg_to_og3d |
convert OccupancyGrid message to the occupancy_grid_3d object. | |
def | og_param_msg |
create an OccupancyGrid msg object for the purpose of setting the grid parameters for pc_to_og node. | |
Variables | |
list | og3d = param_list[0] |
list | param_list = [None, False] |
tuple | pts = og3d.grid_to_points() |
convert occupancy_grid_3d object to OccupancyGrid message.
sets the frame to base_link and stamp to the current time.
Definition at line 25 of file ros_occupancy_grid.py.
def point_cloud_ros.ros_occupancy_grid.og_msg_to_og3d | ( | og, | |
to_binary = True |
|||
) |
convert OccupancyGrid message to the occupancy_grid_3d object.
to_binary | - want the occupancy grid to be binarified. |
Definition at line 14 of file ros_occupancy_grid.py.
def point_cloud_ros.ros_occupancy_grid.og_param_msg | ( | center, | |
size, | |||
resolution, | |||
occupancy_threshold, | |||
frame_id | |||
) |
create an OccupancyGrid msg object for the purpose of setting the grid parameters for pc_to_og node.
center | - 3x1 np matrix. |
size | - 3x1 np matrix. |
resolution | - 3x1 np matrix. |
occupancy_threshold | - integer |
frame_id | - string. |
Definition at line 54 of file ros_occupancy_grid.py.
Definition at line 82 of file ros_occupancy_grid.py.
Definition at line 76 of file ros_occupancy_grid.py.
tuple point_cloud_ros::ros_occupancy_grid::pts = og3d.grid_to_points() |
Definition at line 84 of file ros_occupancy_grid.py.