as2_python_api.behavior_actions.traj_generation_behavior module

TrajGeneration Behavior.

class as2_python_api.behavior_actions.traj_generation_behavior.TrajGenerationBehavior(drone: DroneInterfaceBase)

Bases: BehaviorHandler

FollowPath Behavior.

modify(path: list | tuple | nav_msgs.msg.Path | as2_msgs.msg.PoseWithID, speed: float, yaw_mode: int, yaw_angle: float, frame_id: str = 'earth')

Modify behavior.

start(path: list | tuple | nav_msgs.msg.Path | as2_msgs.msg.PoseWithID, speed: float, yaw_mode: int, yaw_angle: float, frame_id: str = 'earth', wait_result: bool = True) bool

Start behavior.