Class WaypointNavigator
Defined in File waypoints_navigator.hpp
Inheritance Relationships
Base Type
public smacc2::ISmaccComponent
Class Documentation
-
class WaypointNavigator : public smacc2::ISmaccComponent
Public Functions
-
WaypointNavigator()
-
void onInitialize() override
-
template<typename TOrthogonal, typename TSourceObject>
inline void onOrthogonalAllocation()
-
void loadWayPointsFromFile(std::string filepath)
-
void loadWayPointsFromFile2(std::string filepath)
-
void setWaypoints(const std::vector<geometry_msgs::msg::Pose> &waypoints)
-
void sendNextGoal()
-
void stopWaitingResult()
-
const std::vector<geometry_msgs::msg::Pose> &getWaypoints() const
-
long getCurrentWaypointIndex() const
-
void rewind(int count)
-
WaypointNavigator()