ros_gazebo_gym.task_envs.panda.markers
Contains several RViz markers used by the Panda task environments.
Submodules
Package Contents
Classes
RViz grasping cube marker. |
|
RViz object frame origin marker. |
|
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.
- 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.
- class ros_gazebo_gym.task_envs.panda.markers.FrameOriginMarker(*args, **kwargs)[source]
Bases:
ros_gazebo_gym.common.markers.TargetMarker
RViz object frame origin 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 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.
- 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 PuckMarker object.
- Parameters:
*args – Arguments passed to the
TargetMarker
super class.**kwargs – Keyword arguments that are passed to the
TargetMarker
super class.