Functions | |
| def | simple_viz_marker |
| return a Marker message object | |
Variables | |
| tuple | center = np.matrix([0.8, 0., 0.8]) |
| tuple | color = (0., 1., 0., 1.) |
| string | frame_id = 'base_link' |
| tuple | marker = simple_viz_marker(center.A1, scale, color, shape, frame_id) |
| tuple | marker_pub = rospy.Publisher('/occupancy_grid_viz_marker', Marker) |
| int | occupancy_threshold = 5 |
| tuple | og_param |
| tuple | og_param_pub = rospy.Publisher('/og_params', OccupancyGrid) |
| tuple | r = rospy.Rate(2) |
| tuple | resolution = np.matrix([0.005, 0.005, 0.005]) |
| tuple | scale = (0.02, 0.02, 0.02) |
| string | shape = 'sphere' |
| tuple | size = np.matrix([0.4, 0.4, 0.4]) |
| def set_og_params.simple_viz_marker | ( | loc, | |
| scale, | |||
| color, | |||
| shape, | |||
| frame_id | |||
| ) |
return a Marker message object
| loc | - (x,y,z) |
| scale | - (x,y,z) |
| color | - (r,g,b,a) |
| shape | - 'sphere' |
| frame_id | - string. |
Definition at line 18 of file set_og_params.py.
| tuple set_og_params::center = np.matrix([0.8, 0., 0.8]) |
Definition at line 52 of file set_og_params.py.
| tuple set_og_params::color = (0., 1., 0., 1.) |
Definition at line 61 of file set_og_params.py.
| string set_og_params::frame_id = 'base_link' |
Definition at line 58 of file set_og_params.py.
| tuple set_og_params::marker = simple_viz_marker(center.A1, scale, color, shape, frame_id) |
Definition at line 63 of file set_og_params.py.
| tuple set_og_params::marker_pub = rospy.Publisher('/occupancy_grid_viz_marker', Marker) |
Definition at line 48 of file set_og_params.py.
Definition at line 57 of file set_og_params.py.
| tuple set_og_params::og_param |
00001 rog.og_param_msg(center, size, resolution, 00002 occupancy_threshold, frame_id)
Definition at line 64 of file set_og_params.py.
| tuple set_og_params::og_param_pub = rospy.Publisher('/og_params', OccupancyGrid) |
Definition at line 47 of file set_og_params.py.
| tuple set_og_params::r = rospy.Rate(2) |
Definition at line 67 of file set_og_params.py.
| tuple set_og_params::resolution = np.matrix([0.005, 0.005, 0.005]) |
Definition at line 56 of file set_og_params.py.
| tuple set_og_params::scale = (0.02, 0.02, 0.02) |
Definition at line 60 of file set_og_params.py.
| string set_og_params::shape = 'sphere' |
Definition at line 62 of file set_og_params.py.
| tuple set_og_params::size = np.matrix([0.4, 0.4, 0.4]) |
Definition at line 54 of file set_og_params.py.