Go to the documentation of this file.
7 #ifndef DDRONE_TASK_MANAGER_H
8 #define DDRONE_TASK_MANAGER_H
11 #include <common_msgs/state.h>
12 #include <common_msgs/target.h>
13 #include <diagnostic_msgs/DiagnosticArray.h>
14 #include <diagnostic_msgs/DiagnosticStatus.h>
16 #include <geometry_msgs/Point.h>
17 #include <geometry_msgs/Polygon.h>
18 #include <geometry_msgs/PoseStamped.h>
19 #include <geometry_msgs/TransformStamped.h>
20 #include <mavros_msgs/CommandBool.h>
21 #include <mavros_msgs/CommandHome.h>
22 #include <mavros_msgs/CommandTOL.h>
23 #include <mavros_msgs/HomePosition.h>
24 #include <mavros_msgs/PositionTarget.h>
25 #include <mavros_msgs/SetMode.h>
26 #include <mavros_msgs/State.h>
28 #include <sensor_msgs/NavSatFix.h>
30 #include <std_msgs/Bool.h>
31 #include <std_msgs/Byte.h>
32 #include <std_srvs/Empty.h>
33 #include <std_srvs/Trigger.h>
232 void gpsHomeCb(
const mavros_msgs::HomePosition::ConstPtr &msg);
236 void gpsCurCb(
const sensor_msgs::NavSatFix::ConstPtr &msg);
240 void uavStateCb(
const mavros_msgs::State::ConstPtr &msg);
257 void pubTarget(
bool controlMode,
float tgtX,
float tgtY,
float tgtZ);
263 void pubTargetWYaw(
bool controlMode,
float tgtX,
float tgtY,
float tgtZ,
std::vector< common_msgs::state > _ref_list
reference list from file
@ kAttitudeRollError
0: roll
ros::Publisher m_tgt_pub
target publisher: /nndp_cpp/tgt
void velYawTgtCallback(const common_msgs::target::ConstPtr &msg)
get velocity and yaw command
Task manager is used as a central module to communicate with other modules.
ros::Subscriber m_pcmd_sub
subscribe /posTgtFromSwarm
uint16_t last_in_flight_check
previous inflight check
ros::Subscriber m_diagnostics_sub
subscribe /diagnostics
ros::Subscriber m_mission_sub
subscribe mission from UI: /mission_from_ui
ros::Publisher m_error_state_pub
error stater publisher (for UI): /task_manager/error_state
ros::NodeHandle _nh
ros node handle
ros::Subscriber uav_state_sub
subscribe /mavros/state
void currentStateCallback(const common_msgs::state::ConstPtr &msg)
obtain current uav state
UavTaskState mUavTaskState
UAV current state: checkout enum UavTaskState.
void missionCallback(int8_t msg)
mission handler
@ kDisarmed
00: arming error 01: Disarmed
geometry_msgs::PoseStamped m_uav_pose_enu
ros::Subscriber m_uav_pose_sub
subscribe current uav pose: /mavros/local_position/pose to update m_uav_pose
UavTaskState
State machine elements.
@ kAttitudePitchError
1: pitch
double yaw_init_nwu
initial yaw in nwu frame
void gpsHomeCb(const mavros_msgs::HomePosition::ConstPtr &msg)
Get GPS home location.
Some helpers for converting GPS readings from the WGS84 geodetic system to a local North-East-Up cart...
void velTgtCallback(const geometry_msgs::Point::ConstPtr &msg)
get velocity command
GpsUtils gpsToEnuCur
current gps(from px4) to enu local frame
void clearMission()
Clear misson.
bool yaw_control_
flag set to control yaw
bool TaskTerminateFlag
task terminate flag when inflight or preflight check failed
@ kReturnHomeActivated
010000: Return Home
std::vector< geometry_msgs::Point > _wp_list
waypoint list from file
void pubGpstgt()
Convert target from GPS into ENU coordinate.
bool ui_points_selected
flag showing points selected from UI
std::string m_points_location
set waypoint location: /home/nvidia(default)
ros::Timer m_mission_timer
mission call back timer
geometry_msgs::PoseStamped m_uav_pose_nwu
current pose in nwu
ros::Subscriber m_gcs_cmd_sub
double yaw_init
initial yaw in enu frame
ros::Subscriber m_vcmd_sub
subscribe /velTgtFromSwarm
sensor_msgs::NavSatFix m_gps_cur
current gps location
bool yaw_initialized
flag showing yaw is initialized
ros::Subscriber m_online_status_sub
subscribe /swarm/online
void uavPoseCallback(const geometry_msgs::PoseStamped::ConstPtr &msg)
get current uav pose
ros::Subscriber m_approach_cmd_sub
subscribe /swarm/approach
void pubTarget(bool controlMode, float tgtX, float tgtY, float tgtZ)
publish local target with control mode:
void checkReached()
check if the uav reached the waypoint
mavros_msgs::HomePosition m_gps_home
GPS home location.
std_msgs::Bool engage_msg
removed
ros::ServiceClient client_engine0
removed service
ros::Publisher swarm_pos_pub
publish position in nwu: /task_manager/position_nwu
bool _simulation
simulation mode is on if true
double yaw_init_enu
initial yaw in enu frame
std_msgs::Bool m_swarm
swarm flag
geometry_msgs::Point pos_init
the inital position of mission;
ros::Subscriber m_gps_home_sub
subscribe /mavros/home_position/home
void preFlightCheck(uint16_t &pre_flight_check)
preflight Check
geometry_msgs::PoseStamped transform_orientation_enu_nwu(geometry_msgs::PoseStamped)
transform orientation from enu to nwu
bool loadMission()
load mission from UI or files
common_msgs::target m_tgt
current target point
ros::Subscriber m_skipCurPoint_sub
subscribe /mission_skip_point
@ kLandActivated
100000: Land mode
int _points_source_param
Points from 0: local waypoints file; 1: refrence waypoints file; 2: ui selected waypoints; 3:velocity...
void uiPointsCallback(const geometry_msgs::Polygon::ConstPtr &msg)
points for UI (lagacy function)
ros::Publisher Position_Setpoint_Pub
Setpoints to MAVROS publisher: /mavros/setpoint_raw/local.
void uavStateCb(const mavros_msgs::State::ConstPtr &msg)
Get UAV hardware state: connected/armed/guided/mode.
ros::ServiceClient client_home
/mavros/cmd/set_home service
void engine0()
removed for px4 1.8 version
void onlineCallback(const std_msgs::Bool::ConstPtr &msg)
Landing triggered by offline status (msg: false)
ros::Subscriber m_gps_cur_sub
subscribe /mavros/global_position/global
mavros_msgs::State uav_current_state
uav hardware sate from /mavros/state
ros::Subscriber m_current_state_sub
subscribe refrence: /rt_ref_gen/current_state
ros::Publisher m_swarm_pub
trigger swarm publisher: /task_manager/swarm
uint16_t last_pre_flight_check
precious preflight check
void posTgtCallback(const geometry_msgs::Point::ConstPtr &msg)
get gps position command and transfer it into UAV local coordinate
void pubTargetWYaw(bool controlMode, float tgtX, float tgtY, float tgtZ, float yaw)
publish local target with yaw, and set control mode:
double yaw_
param for calculating yaw
ros::Publisher m_ref_pub
refrence from file publisher: /task_manager/current_state
TaskManager(ros::NodeHandle &nodeHandle)
ros::ServiceClient set_mode_client
/mavros/set_mode service
bool inPcmdMode
position command flag
ros::Publisher m_mpc_pos_init_pub
mpc initial position publisher: /task_manager/mpc_init_position_nwu
ros::Publisher m_pos_cmd_pub
way points publisher: /dummy/pos_cmd
ros::ServiceClient land_client
/mavros/cmd/land service
void missionTimer(const ros::TimerEvent &)
callback function for running mission (default: 0.2)
int _points_id
Using this value to label points read from a file.
geometry_msgs::PoseStamped m_uav_pose
current pose(enu) from /mavros/local_position/pose
double _flightHeight
takeoff flight height
@ kArmed
10: armed 11: PreArmed
bool landCb()
call landing service
ros::Subscriber m_ui_points_sub
subscribe points from UI: /points_from_ui
ros::Publisher MPC_Position_Initial_Pub
void inFlightCheck(uint16_t &in_flight_check)
inflight Check
ros::ServiceClient arming_client
/mavros/cmd/arming service
InFlightCheck
errors_count4: inflight check
void calculateYaw()
Calculate yaw angle from current attitude.
void jumpWpCallback(const std_msgs::Bool::ConstPtr &msg)
Skip current waypoint.
void diagnosticsCallback(const diagnostic_msgs::DiagnosticArray::ConstPtr &msg)
Analyse preflight and inflight check for UAV.
PreFlightCheck
errors_count3: preflight check (By bits)
bool m_approach
approach flag
void jumpWp()
jump one waypoint in list
void gpsCurCb(const sensor_msgs::NavSatFix::ConstPtr &msg)
Get UAV current GPS location.
double _relativeHeight
height relative to the ground
geometry_msgs::Point _curr
current uav position
void pubErrorState(std::int8_t val)
Publish Error State from preflight and inflight state.
double _missionPeriod
mission call back period: 0.2s
void shutdownSwarm()
shutdown Swarm
void posYawTgtCallback(const common_msgs::target::ConstPtr &msg)
get position and yaw command
void webCmdCallback(const std_msgs::Byte::ConstPtr &msg)
Get command from web GCS and pass to mission callback.
GpsUtils gpsToEnu
current gps target(from user) to enu local frame
void approachCallback(const std_msgs::Bool::ConstPtr &msg)
approach command for kerrigan project
ros::Publisher m_engage_pub
geometry_msgs::Polygon m_ui_points
polygon points from UI