29 #ifndef SWRI_ROUTE_UTIL_ROUTE_POINT_INLINE_H_ 30 #define SWRI_ROUTE_UTIL_ROUTE_POINT_INLINE_H_ 32 #include <boost/lexical_cast.hpp> 63 geometry_msgs::Point p;
95 geometry_msgs::Quaternion q;
126 geometry_msgs::Pose
pose;
147 marti_nav_msgs::RoutePosition
position;
149 position.distance = 0.0;
177 template <
typename T>
184 #endif // SWRI_ROUTE_UTIL_ROUTE_POINT_INLINE_H_ void setPose(const tf::Pose &pose)
void setStopPointDelay(double delay)
static void pointMsgToTF(const geometry_msgs::Point &msg_v, Point &bt_v)
void setStopPoint(bool value)
marti_nav_msgs::RoutePosition routePosition() const
T getTypedProperty(const std::string &name) const
void setPosition(const tf::Vector3 &position)
tf::Quaternion orientation_
const geometry_msgs::Quaternion orientationMsg() const
void setId(const std::string &id)
static void quaternionMsgToTF(const geometry_msgs::Quaternion &msg, Quaternion &bt)
static void quaternionTFToMsg(const Quaternion &bt, geometry_msgs::Quaternion &msg)
const std::string & id() const
const geometry_msgs::Point positionMsg() const
void setOrientation(const tf::Quaternion &orientation)
const tf::Vector3 & position() const
const tf::Quaternion & orientation() const
std::string getProperty(const std::string &name) const
geometry_msgs::Pose poseMsg() const
double stopPointDelay() const
static void pointTFToMsg(const Point &bt_v, geometry_msgs::Point &msg_v)