9 #include <boost/optional.hpp> 10 #include <gazebo/physics/Joint.hh> double getDesiredPosition(const franka::RobotMode &mode) const
Decide what the desired position of this joint is based on:
int type
The type of joint, i.e.
double collision_threshold
Above which threshold forces or torques will be interpreted as "collisions" by isInCollision.
joint_limits_interface::JointLimits limits
Joint limits.
double getDesiredTorque(const franka::RobotMode &mode) const
Decide what the desired torque of this joint is:
control_toolbox::Pid velocity_controller
The PID gains used for the controller, when in "velocity" control mode.
void update(const ros::Duration &dt)
Calculate all members such as accelerations, jerks velocities by differentiation. ...
double desired_position
The current desired position that is used for the PID controller when the joints control method is "P...
double contact_threshold
Above which threshold forces or torques will be interpreted as "contacts" by isInContact.
double jerk
The currently acting jerk acting on this this joint in either or .
double velocity
The current velocity of this joint either in or .
double stop_position
Position used as desired position if control_method is none.
double acceleration
The currently acting acceleration on this joint in either or .
gazebo::physics::JointPtr handle
A pointer to the underlying gazebo handle. Must be non-null for update to work.
bool isInCollision() const
Is the joint currently in contact with something?
ControlMethod
Specifies the current control method of the joint.
double getLinkMass() const
Get the total link mass of this joint's child.
std::string name
Name of this joint. Should be unique in whole simulation.
bool isInContact() const
Is the joint currently in contact with something?
A data container holding all relevant information about a robotic joint.
double effort
The current total force or torque acting on this joint in either or .
Eigen::Vector3d axis
The axis of rotation/translation of this joint in local coordinates.
double getDesiredVelocity(const franka::RobotMode &mode) const
Decide what the desired velocity of this joint is based on:
control_toolbox::Pid position_controller
The PID gains used for the controller, when in "position" control mode.
double gravity
The currently acting gravity force or torque acting on this joint in or .
double getDesiredAcceleration(const franka::RobotMode &mode) const
Decide what the desired acceleration of this joint is based on:
double position
The current position of this joint either in or .
double command
The currently applied command from a controller acting on this joint either in or without gravity...
double desired_velocity
The current desired velocity that is used for the PID controller when the joints control method is "V...
boost::optional< ControlMethod > control_method
Decides whether the joint is doing torque control or if the position or velocity should be controlled...