SimpleIKRatingModule.cpp
Go to the documentation of this file.
1 
21 #include <ros/ros.h>
22 
23 namespace robot_model_services {
26 
27  double SimpleIKRatingModule::getPanAngleRating(const geometry_msgs::Point &sourcePosition, const geometry_msgs::Point &targetPosition, double sourceRotationBase, double targetRotationBase)
28  {
29  //Substract the difference between source and target rotation
30  double rotDiff = fmod(targetRotationBase - sourceRotationBase, 2.0*M_PI);
31  if (rotDiff <= 0) {rotDiff += 2.0*M_PI;}
32  rotDiff = std::min(fabs(rotDiff), (double)(2.0f*M_PI-fabs(rotDiff)));
33  double rating = pow(0.6, rotDiff);
34  return rating;
35  }
36 }
37 
IKRatingModule is a generalization for the rating of the inverse kinematic parameters.
f
virtual ~SimpleIKRatingModule()
destructor of the SimpleDefaultIKRatingModule object.
this namespace contains all generally usable classes.
Definition: DebugHelper.hpp:27
double getPanAngleRating(const geometry_msgs::Point &sourcePosition, const geometry_msgs::Point &targetPosition, double sourceRotationBase, double targetRotationBase)
SimpleIKRatingModule()
constructor of the SimpleDefaultIKRatingModule object


asr_robot_model_services
Author(s): Aumann Florian, Borella Jocelyn, Heller Florian, Meißner Pascal, Schleicher Ralf, Stöckle Patrick, Stroh Daniel, Trautmann Jeremias, Walter Milena, Wittenbeck Valerij
autogenerated on Mon Jun 10 2019 12:49:59