Enum ActuatorType
Defined in File data.hpp
Enum Documentation
-
enum class mujoco_ros2_control::ActuatorType
Maps to MuJoCo actuator types:
MOTOR for MuJoCo motor actuator
POSITION for MuJoCo position actuator
VELOCITY for MuJoCo velocity actuator
CUSTOM for MuJoCo general actuator or other types
Note
the MuJoCo types are as per the MuJoCo documentation: https://mujoco.readthedocs.io/en/latest/XMLreference.html#actuator
Values:
-
enumerator UNKNOWN
-
enumerator MOTOR
-
enumerator POSITION
-
enumerator VELOCITY
-
enumerator CUSTOM