utility.h
Go to the documentation of this file.
1 
18 #ifndef RECOGNIZER_PREDICTION_UTILITY_H
19 #define RECOGNIZER_PREDICTION_UTILITY_H
20 #include <ISM/common_type/Pose.hpp>
21 #include <ISM/common_type/Point.hpp>
22 
23 #include <asr_msgs/AsrAttributedPoint.h>
24 #include <std_msgs/ColorRGBA.h>
25 namespace pose_prediction_ism {
26 ISM::Point attributedPoint2ismPoint(asr_msgs::AsrAttributedPoint attributedPoint);
34 asr_msgs::AsrAttributedPoint ismPosePtr2attributedPoint(ISM::PosePtr ismPosePtr,
35  std::string type,
36  std::string identifier );
37 }
38 #endif
ISM::Point attributedPoint2ismPoint(asr_msgs::AsrAttributedPoint attributedPoint)
Definition: utility.cpp:22
asr_msgs::AsrAttributedPoint ismPosePtr2attributedPoint(ISM::PosePtr ismPosePtr, std::string type, std::string identifier)
Definition: utility.cpp:30


asr_lib_pose_prediction_ism
Author(s): Heizmann Heinrich, Heller Florian, Meißner Pascal, Stöckle Patrick
autogenerated on Thu Jan 9 2020 07:19:57