NavigationPathIKRatingModule.h
Go to the documentation of this file.
00001 
00020 #pragma once
00021 
00022 #include "robot_model_services/rating/IKRatingModule.h"
00023 #include "robot_model_services/robot_model/RobotModel.hpp"
00024 #include "robot_model_services/helper/DebugHelper.hpp"
00025 
00026 namespace robot_model_services {
00035     class NavigationPathIKRatingModule : public IKRatingModule {
00036     public:
00040         NavigationPathIKRatingModule(RobotModelPtr robotModel);
00041 
00045         virtual ~NavigationPathIKRatingModule();
00046 
00055         double getPanAngleRating(const geometry_msgs::Point &sourcePosition, const geometry_msgs::Point &targetPosition, double sourceRotationBase, double targetRotationBase);
00056     private:
00057         RobotModelPtr mRobotModel;
00058         DebugHelperPtr mDebugHelperPtr;
00059     };
00060 
00064     typedef boost::shared_ptr<NavigationPathIKRatingModule> NavigationPathIKRatingModulePtr;
00065 }


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