SimpleIKRatingModule uses the difference between the start and target angle for the rating. More...
#include <SimpleIKRatingModule.h>
Public Member Functions | |
double | getPanAngleRating (const geometry_msgs::Point &sourcePosition, const geometry_msgs::Point &targetPosition, double sourceRotationBase, double targetRotationBase) |
SimpleIKRatingModule () | |
constructor of the SimpleDefaultIKRatingModule object More... | |
virtual | ~SimpleIKRatingModule () |
destructor of the SimpleDefaultIKRatingModule object. More... | |
Public Member Functions inherited from robot_model_services::IKRatingModule | |
IKRatingModule () | |
constructor of the IKRatingModule object More... | |
virtual | ~IKRatingModule () |
destructor of the IKRatingModule object. More... | |
SimpleIKRatingModule uses the difference between the start and target angle for the rating.
Definition at line 36 of file SimpleIKRatingModule.h.
robot_model_services::SimpleIKRatingModule::SimpleIKRatingModule | ( | ) |
constructor of the SimpleDefaultIKRatingModule object
Definition at line 24 of file SimpleIKRatingModule.cpp.
|
virtual |
destructor of the SimpleDefaultIKRatingModule object.
Definition at line 25 of file SimpleIKRatingModule.cpp.
|
virtual |
sourcePosition | [in] the MILD's current position |
targetPosition | [in] the MILD's target position |
sourceRotationBase | [in] the MILD's current rotation |
targetRotationBase | [in] the MILD's target rotation |
Implements robot_model_services::IKRatingModule.
Definition at line 27 of file SimpleIKRatingModule.cpp.