what is use of gravity_vector in order to get requred torque in moveit?
I am following this page and the constructor defination given below?
what is the 3rd parameter and why do we use it ?
dynamics_solver::DynamicsSolver::DynamicsSolver(
const robot_model::RobotModelConstPtr &robot_model,
const std::string &group_name,
const geometry_msgs::Vector3 &gravity_vector
)
ubantu 18.04 Melodic
Thanks in advance
I'm not familiar with the package, but I would say, it might be to compute the
Torque due to gravity
. See (lines 298-304) here.