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
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.
- 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 thex
,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.