ros_gazebo_gym.task_envs.panda.markers

Contains several RViz markers used by the Panda task environments.

Submodules

Package Contents

Classes

CubeMarker

RViz grasping cube marker.

FrameOriginMarker

RViz object frame origin marker.

PuckMarker

RViz sliding puck marker.

class ros_gazebo_gym.task_envs.panda.markers.CubeMarker(*args, **kwargs)[source]

Bases: ros_gazebo_gym.common.markers.TargetMarker

RViz grasping cube marker.

id

The marker object id.

Type:

int

type

The marker type.

Type:

str

action

The marker message action (add or remove).

Type:

float

scale

The marker scale.

Type:

geometry_msgs.Vector3

color

The marker color.

Type:

std_msgs.ColorRGBA

lifetime

The lifetime duration.

Type:

rospy.duration

frame_locked

Boolean specifying whether the marker frame is locked to the world.

Type:

bool

point

The marker points.

Type:

geometry_msgs.Point

text

The text that is used for text markers.

Type:

str

mesh_resource

Marker mess location.

Type:

str

mesh_use_embedded_materials

Boolean specifying whether we want to use a mesh.

Type:

bool

Important

If both the x, y, z positions and a Pose is supplied the x, y, z positions are used.

Initialize CubeMarker object.

Parameters:
  • *args – Arguments passed to the TargetMarker super class.

  • **kwargs – Keyword arguments that are passed to the TargetMarker super class.

class ros_gazebo_gym.task_envs.panda.markers.FrameOriginMarker(*args, **kwargs)[source]

Bases: ros_gazebo_gym.common.markers.TargetMarker

RViz object frame origin marker.

id

The marker object id.

Type:

int

type

The marker type.

Type:

str

action

The marker message action (add or remove).

Type:

float

scale

The marker scale.

Type:

geometry_msgs.Vector3

color

The marker color.

Type:

std_msgs.ColorRGBA

lifetime

The lifetime duration.

Type:

rospy.duration

frame_locked

Boolean specifying whether the marker frame is locked to the world.

Type:

bool

point

The marker points.

Type:

geometry_msgs.Point

text

The text that is used for text markers.

Type:

str

mesh_resource

Marker mess location.

Type:

str

mesh_use_embedded_materials

Boolean specifying whether we want to use a mesh.

Type:

bool

Important

If both the x, y, z positions and a Pose is supplied the x, y, z positions are used.

Initialize FrameOriginMarker object.

Parameters:
  • *args – Arguments passed to the TargetMarker super class.

  • **kwargs – Keyword arguments that are passed to the TargetMarker super class.

class ros_gazebo_gym.task_envs.panda.markers.PuckMarker(*args, **kwargs)[source]

Bases: ros_gazebo_gym.common.markers.TargetMarker

RViz sliding puck marker.

id

The marker object id.

Type:

int

type

The marker type.

Type:

str

action

The marker message action (add or remove).

Type:

float

scale

The marker scale.

Type:

geometry_msgs.Vector3

color

The marker color.

Type:

std_msgs.ColorRGBA

lifetime

The lifetime duration.

Type:

rospy.duration

frame_locked

Boolean specifying whether the marker frame is locked to the world.

Type:

bool

point

The marker points.

Type:

geometry_msgs.Point

text

The text that is used for text markers.

Type:

str

mesh_resource

Marker mess location.

Type:

str

mesh_use_embedded_materials

Boolean specifying whether we want to use a mesh.

Type:

bool

Important

If both the x, y, z positions and a Pose is supplied the x, y, z positions are used.

Initialize PuckMarker object.

Parameters:
  • *args – Arguments passed to the TargetMarker super class.

  • **kwargs – Keyword arguments that are passed to the TargetMarker super class.