Main Page
Namespaces
Classes
Files
File List
File Members
src
rating
impl
SimpleIKRatingModule.cpp
Go to the documentation of this file.
1
20
#include "
robot_model_services/rating/impl/SimpleIKRatingModule.h
"
21
#include <
ros/ros.h
>
22
23
namespace
robot_model_services
{
24
SimpleIKRatingModule::SimpleIKRatingModule
() :
IKRatingModule
() {}
25
SimpleIKRatingModule::~SimpleIKRatingModule
() { }
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.0
f
*M_PI-fabs(rotDiff)));
33
double
rating = pow(0.6, rotDiff);
34
return
rating;
35
}
36
}
37
robot_model_services::IKRatingModule
IKRatingModule is a generalization for the rating of the inverse kinematic parameters.
Definition:
IKRatingModule.h:34
f
f
SimpleIKRatingModule.h
robot_model_services::SimpleIKRatingModule::~SimpleIKRatingModule
virtual ~SimpleIKRatingModule()
destructor of the SimpleDefaultIKRatingModule object.
Definition:
SimpleIKRatingModule.cpp:25
robot_model_services
this namespace contains all generally usable classes.
Definition:
DebugHelper.hpp:27
robot_model_services::SimpleIKRatingModule::getPanAngleRating
double getPanAngleRating(const geometry_msgs::Point &sourcePosition, const geometry_msgs::Point &targetPosition, double sourceRotationBase, double targetRotationBase)
Definition:
SimpleIKRatingModule.cpp:27
ros.h
robot_model_services::SimpleIKRatingModule::SimpleIKRatingModule
SimpleIKRatingModule()
constructor of the SimpleDefaultIKRatingModule object
Definition:
SimpleIKRatingModule.cpp:24
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