NavigationPathIKRatingModule implements the functionlities offered by IKRatingModule. More...
#include <NavigationPathIKRatingModule.h>

Public Member Functions | |
| double | getPanAngleRating (const geometry_msgs::Point &sourcePosition, const geometry_msgs::Point &targetPosition, double sourceRotationBase, double targetRotationBase) |
| NavigationPathIKRatingModule (RobotModelPtr robotModel) | |
| constructor of the NavigationPathIKRatingModule object | |
| virtual | ~NavigationPathIKRatingModule () |
| destructor of the NavigationPathIKRatingModule object. | |
Private Attributes | |
| DebugHelperPtr | mDebugHelperPtr |
| RobotModelPtr | mRobotModel |
NavigationPathIKRatingModule implements the functionlities offered by IKRatingModule.
Definition at line 35 of file NavigationPathIKRatingModule.h.
| robot_model_services::NavigationPathIKRatingModule::NavigationPathIKRatingModule | ( | RobotModelPtr | robotModel | ) |
constructor of the NavigationPathIKRatingModule object
Definition at line 24 of file NavigationPathIKRatingModule.cpp.
destructor of the NavigationPathIKRatingModule object.
Definition at line 29 of file NavigationPathIKRatingModule.cpp.
| double robot_model_services::NavigationPathIKRatingModule::getPanAngleRating | ( | const geometry_msgs::Point & | sourcePosition, |
| const geometry_msgs::Point & | targetPosition, | ||
| double | sourceRotationBase, | ||
| double | targetRotationBase | ||
| ) | [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 31 of file NavigationPathIKRatingModule.cpp.
Definition at line 58 of file NavigationPathIKRatingModule.h.
Definition at line 57 of file NavigationPathIKRatingModule.h.