/**************************************************************************** * * Copyright (c) 2022 PX4 Development Team. All rights reserved. * * Redistribution and use in source and binary forms, with or without * modification, are permitted provided that the following conditions * are met: * * 1. Redistributions of source code must retain the above copyright * notice, this list of conditions and the following disclaimer. * 2. Redistributions in binary form must reproduce the above copyright * notice, this list of conditions and the following disclaimer in * the documentation and/or other materials provided with the * distribution. * 3. Neither the name PX4 nor the names of its contributors may be * used to endorse or promote products derived from this software * without specific prior written permission. * * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE * COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, * BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS * OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED * AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN * ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE * POSSIBILITY OF SUCH DAMAGE. * ****************************************************************************/ #pragma once #include "autopilot_tester.h" #include #include #include // Simulate a target moving on a straight line in X+ direction class FollowTargetSimulator { public: FollowTargetSimulator(std::array initial_position_ned, mavsdk::Telemetry::GroundTruth home); ~FollowTargetSimulator(); // Integrate simulator by one time step // This moves the target on a line void update(float delta_t_s); // Retrieve noisy version of position state in NED coordinate frame // The noise is deterministic and changes whenever the update() function is called std::array get_position_ned_noisy(); // Retrieve ground truth of position state in NED coordinate frame std::array get_position_ground_truth_ned(); // Retrieve noisy version of velocity state in NED coordinate frame // The noise is deterministic and changes whenever the update() function is called std::array get_velocity_ned_noisy(); // Retrieve ground truth of velocity state in NED coordinate frame std::array get_velocity_ned_ground_truth(); // Retrieve noisy version of position state in global coordinate frame (lat, lon, alt) // The noise is deterministic and changes whenever the update() function is called std::array get_position_global_noisy(); // Retrieve ground truth of position state in global coordinate frame (lat, lon, alt) std::array get_position_global_ground_truth(); // Run checks whether the drone has the correct angle towards the target, specified by the follow-me configuration void check_follow_angle(FollowMe::Config config, std::array drone_pos_ned, std::array target_pos_ned, float tolerance); private: // Retrieve estimate with the option to add deterministic gaussian noise // // @param add_noise: Add gaussian noise to the state. Noise is deterministic and changes with each inokation of update() std::array get_position_global(bool add_noise); // Retrieve estimate with the option to add deterministic gaussian noise // // @param add_noise: Add gaussian noise to the state. Noise is deterministic and changes with each inokation of update() std::array get_position_ned(bool add_noise); // Retrieve estimate with the option to add deterministic gaussian noise // // @param add_noise: Add gaussian noise to the state. Noise is deterministic and changes with each inokation of update() std::array get_velocity_ned(bool add_noise); std::array _position_ned; std::array _velocity_ned; mavsdk::Telemetry::GroundTruth _home; size_t _udpate_count = 0; const double pos_noise_std = 0.3; const double vel_noise_std = 0.1; std::unique_ptr _telemetry{}; }; class AutopilotTesterFollowMe : public AutopilotTester { public: AutopilotTesterFollowMe() = default; ~AutopilotTesterFollowMe() = default; void connect(const std::string uri); /** * @brief Moves the Target in X+ direction and check the behavior * * @param stream_velocity [bool] Whether Target's FollowMe message includes velocity info or not */ void straight_line_test(const bool stream_velocity); /** * @brief Sends Target Velocity data only with invalid Position Data * * This case should be considered as an 'invalid' Target movement, and the vehicle * therefore shouldn't move even when the target data is sent */ void stream_velocity_only(); /** * @brief Test to check if RC adjustments work * * Simulates moving throttle up and down for Follow Height Control * Simulates moving roll left and right for Follow Angle Control * Simulates moving pitch up and down for Follow Distance Control */ void rc_adjustment_test(); private: std::unique_ptr _follow_me{}; };