ros_gazebo_gym.task_envs.panda.markers.cube_marker

Contains a class that can be used for displaying a marker for the cube object in RViz.

Note

This class overloads the ros_gazebo_gym.common.markers.target_marker.TargetMarker class in order to pre-initialize some of its attributes. Most importantly, a pose offset was applied to align the marker frame with the object frame.

Module Contents

Classes

CubeMarker

RViz grasping cube marker.

class ros_gazebo_gym.task_envs.panda.markers.cube_marker.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.