ros_gazebo_gym.common.markers
Contains several RViz markers.
Submodules
Package Contents
Classes
RViz goal sample region marker.  | 
|
RViz target goal marker.  | 
|
RViz text overlay.  | 
- class ros_gazebo_gym.common.markers.SampleRegionMarker(x=0, y=0, z=0, x_min=None, y_min=None, z_min=None, x_max=None, y_max=None, z_max=None, frame_id=None, *args, **kwargs)[source]
 Bases:
visualization_msgs.msg.MarkerRViz goal sample region marker.
- color
 The marker color.
- Type:
 std_msgs.ColorRGBA
- lifetime
 The lifetime duration.
- Type:
 :rospy.Duration
- point
 The marker points.
- Type:
 geometry_msgs.Point
Important
The x, y, z min/max values take precedence over x y z position values, which take precedence over position and scale values.
Initialize SampleRegionMarker object.
- Parameters:
 x_min (float, optional) – The min x position of the marker. Defaults to
None.y_min (float, optional) – The min y position of the marker. Defaults to
None.z_min (float, optional) – The min z position of the marker. Defaults to
None.x_max (float, optional) – The max x position of the marker. Defaults to
None.y_max (float, optional) – The max y position of the marker. Defaults to
None.z_max (float, optional) – The max z position of the marker. Defaults to
None.frame_id (str, optional) – The frame the position/orientation are relative to. Defaults to
None.*args – Arguments passed to the
Markersuper class.**kwargs – Keyword arguments that are passed to the
Markersuper class.
- Raises:
 Exception – Thrown when the ROS time is not initialised.
- property x
 Retrieve the marker x position.
- property y
 Retrieve the marker y position.
- property z
 Retrieve the marker z position.
- property x_min
 Retrieve the value of x_min.
- property y_min
 Retrieve the value of y_min.
- property z_min
 Retrieve the value of z_min.
- property x_max
 Retrieve the value of x_max.
- property y_max
 Retrieve the value of y_max.
- property z_max
 Retrieve the value of z_max.
- property scale
 Get marker scale.
- property pose
 Retrieve marker pose.
- class ros_gazebo_gym.common.markers.TargetMarker(x=0, y=0, z=0, frame_id=None, *args, **kwargs)[source]
 Bases:
visualization_msgs.msg.MarkerRViz target goal marker.
- scale
 The marker scale.
- Type:
 geometry_msgs.Vector3
- color
 The marker color.
- Type:
 std_msgs.ColorRGBA
- lifetime
 The lifetime duration.
- Type:
 rospy.duration
- point
 The marker points.
- Type:
 geometry_msgs.Point
Important
If both the x,y,z positions and a Pose is supplied the x,y,z positions are used.
Initialize TargetMarker object.
- Parameters:
 x (int, optional) – The target marker x position. Defaults to
0.y (int, optional) – The target marker y position. Defaults to
0.z (int, optional) – The target marker z position. Defaults to
0.frame_id (str, optional) – The frame the position/orientation are relative to. Defaults to
None.*args – Arguments passed to the
Markersuper class.**kwargs – Keyword arguments that are passed to the
Markersuper class.
- Raises:
 Exception – Thrown when the ROS time is not initialised.
- property x
 Retrieve the marker x position.
- property y
 Retrieve the marker y position.
- property z
 Retrieve the marker z position.
- property pose
 Retrieve the marker pose.
- class ros_gazebo_gym.common.markers.TextOverlay(*args, **kwargs)[source]
 Bases:
jsk_rviz_plugins.msg.OverlayTextRViz text overlay.
Note
When no width or height are supplied it makes sure that the display fits all the text.
- bg_color
 The overlay background color.
- Type:
 std_msgs.ColorRGBA
- fg_color
 The text color.
- Type:
 std_msgs.ColorRGBA
Initialize text overlay object.
- property text_size
 Retrieve the text size.