Main Page
Namespaces
Classes
Files
File List
File Members
include
robot_model_services
rating
impl
NavigationPathIKRatingModule.h
Go to the documentation of this file.
1
20
#pragma once
21
22
#include "
robot_model_services/rating/IKRatingModule.h
"
23
#include "
robot_model_services/robot_model/RobotModel.hpp
"
24
#include "
robot_model_services/helper/DebugHelper.hpp
"
25
26
namespace
robot_model_services
{
35
class
NavigationPathIKRatingModule
:
public
IKRatingModule
{
36
public
:
40
NavigationPathIKRatingModule
(
RobotModelPtr
robotModel);
41
45
virtual
~NavigationPathIKRatingModule
();
46
55
double
getPanAngleRating
(
const
geometry_msgs::Point &sourcePosition,
const
geometry_msgs::Point &targetPosition,
double
sourceRotationBase,
double
targetRotationBase);
56
private
:
57
RobotModelPtr
mRobotModel
;
58
DebugHelperPtr
mDebugHelperPtr
;
59
};
60
64
typedef
boost::shared_ptr<NavigationPathIKRatingModule>
NavigationPathIKRatingModulePtr
;
65
}
robot_model_services::IKRatingModule
IKRatingModule is a generalization for the rating of the inverse kinematic parameters.
Definition:
IKRatingModule.h:34
robot_model_services::NavigationPathIKRatingModule
NavigationPathIKRatingModule implements the functionlities offered by IKRatingModule.
Definition:
NavigationPathIKRatingModule.h:35
DebugHelper.hpp
IKRatingModule.h
boost::shared_ptr< RobotModel >
robot_model_services::NavigationPathIKRatingModule::getPanAngleRating
double getPanAngleRating(const geometry_msgs::Point &sourcePosition, const geometry_msgs::Point &targetPosition, double sourceRotationBase, double targetRotationBase)
Definition:
NavigationPathIKRatingModule.cpp:31
robot_model_services
this namespace contains all generally usable classes.
Definition:
DebugHelper.hpp:27
robot_model_services::NavigationPathIKRatingModule::NavigationPathIKRatingModule
NavigationPathIKRatingModule(RobotModelPtr robotModel)
constructor of the NavigationPathIKRatingModule object
Definition:
NavigationPathIKRatingModule.cpp:24
RobotModel.hpp
robot_model_services::NavigationPathIKRatingModulePtr
boost::shared_ptr< NavigationPathIKRatingModule > NavigationPathIKRatingModulePtr
Definition for the shared pointer type of the class.
Definition:
NavigationPathIKRatingModule.h:64
robot_model_services::NavigationPathIKRatingModule::mDebugHelperPtr
DebugHelperPtr mDebugHelperPtr
Definition:
NavigationPathIKRatingModule.h:58
robot_model_services::NavigationPathIKRatingModule::mRobotModel
RobotModelPtr mRobotModel
Definition:
NavigationPathIKRatingModule.h:57
robot_model_services::NavigationPathIKRatingModule::~NavigationPathIKRatingModule
virtual ~NavigationPathIKRatingModule()
destructor of the NavigationPathIKRatingModule object.
Definition:
NavigationPathIKRatingModule.cpp:29
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