Class DroneSwarm
Defined in File drone_swarm.hpp
Class Documentation
-
class DroneSwarm
Public Functions
-
inline ~DroneSwarm()
-
std::shared_ptr<rclcpp_action::ClientGoalHandle<as2_msgs::action::FollowReference>> initFollowReference()
Initialize the follow refrence.
- Returns:
std::shared_ptr<rclcpp_action::ClientGoalHandle<as2_msgs::action::FollowReference>> Future of the FollowReference behavior
-
bool stopFollowReference()
Send request to stop following the refernce in the swarm.
- Returns:
bool Response of the service
-
bool checkPosition()
Check if the drones are in their reference position.
- Returns:
bool Return true if the drones are less than 0.3 meters from the reference
-
bool updateStaticTf(geometry_msgs::msg::Pose pose)
Update the static tf of the drones.
- Parameters:
pose – The new reference pose
-
inline ~DroneSwarm()