Go to the documentation of this file.00001
00020 #ifndef IKRATINGMODULE_H
00021 #define IKRATINGMODULE_H
00022
00023 #include "nav_msgs/Path.h"
00024
00025 namespace robot_model_services {
00034 class IKRatingModule {
00035 public:
00039 IKRatingModule();
00040
00044 virtual ~IKRatingModule();
00045
00054 virtual double getPanAngleRating(const geometry_msgs::Point &sourcePosition, const geometry_msgs::Point &targetPosition, double sourceRotationBase, double targetRotationBase) = 0;
00055 };
00056
00060 typedef boost::shared_ptr<IKRatingModule> IKRatingModulePtr;
00061 }
00062
00063 #endif
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 Sat Jun 8 2019 18:24:52