8 : ReachabilityPlugin(
"dynamics_reachability")
14 if (!ReachabilityPlugin::loadParams(params))
28 const geometry_msgs::Vector3& v = next.getBodyVelocity();
35 const geometry_msgs::Vector3& v0 = current.getBodyVelocity();
36 const geometry_msgs::Vector3& v1 = next.getBodyVelocity();
38 geometry_msgs::Vector3 acc;
39 acc.x = (v1.x-v0.x)/next.getStepDuration();
40 acc.y = (v1.y-v0.y)/next.getStepDuration();
41 acc.z = (v1.z-v0.z)/next.getStepDuration();
51 #include <pluginlib/class_list_macros.h>