Classes |
| class | mavplugin::ImagePubPlugin |
| | Image pub plugin. More...
|
| class | mavplugin::MocapPoseEstimatePlugin |
| class | mavplugin::PX4FlowPlugin |
| | PX4 Optical Flow plugin. More...
|
| class | mavplugin::VisionPoseEstimatePlugin |
| | Vision pose estimate plugin. More...
|
| class | mavplugin::VisionSpeedEstimatePlugin |
| | Vision speed estimate plugin. More...
|
Namespaces |
| namespace | mavplugin |
Typedefs |
typedef boost::shared_ptr
< MavRosPlugin const > | ConstPtr |
typedef std::lock_guard
< std::recursive_mutex > | lock_guard |
typedef boost::function< void(const
mavlink_message_t *msg,
uint8_t sysid, uint8_t compid | message_handler )) |
typedef std::map< uint8_t,
message_handler > | message_map |
| typedef boost::any | param_t |
typedef boost::shared_ptr
< MavRosPlugin > | Ptr |
typedef std::unique_lock
< std::recursive_mutex > | unique_lock |
| typedef std::vector< uint8_t > | V_FileData |
Enumerations |
| enum | ErrorCode |
| enum | Opcode |
| enum | OpState |
Functions |
| void | accel_cb (const geometry_msgs::Vector3Stamped::ConstPtr &req) |
| void | add_dirent (const char *ptr, size_t slen) |
| bool | arming_cb (mavros::CommandBool::Request &req, mavros::CommandBool::Response &res) |
| | BatteryStatusDiag (const std::string name) |
| static bool | check_exclude_param_id (std::string param_id) |
| bool | mavplugin::ImagePubPlugin::check_supported_type (uint8_t type) const |
| bool | checksum_cb (mavros::FileChecksum::Request &req, mavros::FileChecksum::Response &res) |
| void | checksum_crc32_file (std::string &path) |
| void | clear () |
| bool | clear_cb (mavros::WaypointClear::Request &req, mavros::WaypointClear::Response &res) |
| bool | close_cb (mavros::FileClose::Request &req, mavros::FileClose::Response &res) |
| bool | close_file (std::string &path) |
| void | command_int (uint8_t frame, uint16_t command, uint8_t current, uint8_t autocontinue, float param1, float param2, float param3, float param4, int32_t x, int32_t y, float z) |
| bool | command_int_cb (mavros::CommandInt::Request &req, mavros::CommandInt::Response &res) |
| void | command_long (uint16_t command, uint8_t confirmation, float param1, float param2, float param3, float param4, float param5, float param6, float param7) |
| bool | command_long_cb (mavros::CommandLong::Request &req, mavros::CommandLong::Response &res) |
| | CommandPlugin () |
| | CommandTransaction (uint16_t command) |
| static constexpr int | compute_rw_timeout (size_t len) |
| void | connection_cb (bool connected) |
| void | create_directory (std::string &path) |
| uint8_t * | data () |
| char * | data_c () |
| uint32_t * | data_u32 () |
| bool | decode (UAS *uas, const mavlink_message_t *msg) |
| | DummyPlugin () |
| void | fill_imu_msg_attitude (sensor_msgs::ImuPtr &imu_msg, tf::Quaternion &orientation, double xg, double yg, double zg) |
| void | fill_imu_msg_raw (sensor_msgs::ImuPtr &imu_msg, double xg, double yg, double zg, double xa, double ya, double za) |
| static WaypointItem | from_mission_item (mavlink_mission_item_t &mit) |
| static WaypointItem | from_msg (mavros::Waypoint &wp, uint16_t seq) |
| static param_t | from_param_value (mavlink_param_value_t &pmsg) |
| static param_t | from_param_value_apm_quirk (mavlink_param_value_t &pmsg) |
| static param_t | from_xmlrpc_value (XmlRpc::XmlRpcValue &xml) |
| | FTPPlugin () |
| | FTPRequest () |
| bool | get_cb (mavros::ParamGet::Request &req, mavros::ParamGet::Response &res) |
| std::string const | get_name () const |
| const std::string | mavplugin::PX4FlowPlugin::get_name () const |
| const std::string | mavplugin::ImagePubPlugin::get_name () const |
| const std::string | mavplugin::VisionSpeedEstimatePlugin::get_name () const |
| const std::string | mavplugin::MocapPoseEstimatePlugin::get_name () const |
| const std::string | mavplugin::VisionPoseEstimatePlugin::get_name () const |
| const message_map | get_rx_handlers () |
| const message_map | mavplugin::PX4FlowPlugin::get_rx_handlers () |
| const message_map | mavplugin::ImagePubPlugin::get_rx_handlers () |
| const message_map | mavplugin::VisionSpeedEstimatePlugin::get_rx_handlers () |
| const message_map | mavplugin::MocapPoseEstimatePlugin::get_rx_handlers () |
| const message_map | mavplugin::VisionPoseEstimatePlugin::get_rx_handlers () |
| uint8_t | get_target_system_id () |
| | GlobalPositionPlugin () |
| void | go_idle (void) |
| void | go_idle (bool is_error_, int r_errno_=0) |
| bool | goto_cb (mavros::WaypointGOTO::Request &req, mavros::WaypointGOTO::Response &res) |
| | GPSInfo (const std::string name) |
| | GPSPlugin () |
| bool | guided_cb (mavros::CommandBool::Request &req, mavros::CommandBool::Response &res) |
| void | handle_ack_checksum (FTPRequest &req) |
| void | handle_ack_list (FTPRequest &req) |
| void | handle_ack_open (FTPRequest &req) |
| void | handle_ack_read (FTPRequest &req) |
| void | handle_ack_write (FTPRequest &req) |
| void | handle_attitude (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_attitude_quaternion (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_command_ack (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | mavplugin::ImagePubPlugin::handle_data_transmission_handshake (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | mavplugin::ImagePubPlugin::handle_encapsulated_data (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_file_transfer_protocol (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_global_position_int (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_gps_raw_int (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_gps_status (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_heartbeat (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_highres_imu (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_local_position_ned (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_message (msgT &rst, uint8_t sysid, uint8_t compid) |
| void | handle_mission_ack (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_mission_count (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_mission_current (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_mission_item (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_mission_item_reached (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_mission_request (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | mavplugin::PX4FlowPlugin::handle_optical_flow (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_param_value (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_radio_status (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_raw_imu (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_rc_channels (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_rc_channels_raw (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_req_ack (FTPRequest &req) |
| void | handle_req_nack (FTPRequest &req) |
| void | handle_scaled_imu (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_scaled_pressure (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_servo_output_raw (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_statustext (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_sys_status (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_system_time (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_vfr_hud (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| PayloadHeader * | header () |
| void | heartbeat_cb (const ros::TimerEvent &event) |
| | HeartbeatStatus (const std::string name, size_t win_size) |
| | HwStatus (const std::string name) |
| | mavplugin::ImagePubPlugin::ImagePubPlugin () |
| | IMUPubPlugin () |
| void | initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater) |
| void | mavplugin::MocapPoseEstimatePlugin::initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater) |
| void | mavplugin::PX4FlowPlugin::initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater) |
| void | mavplugin::VisionSpeedEstimatePlugin::initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater) |
| void | mavplugin::VisionPoseEstimatePlugin::initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater) |
| void | mavplugin::ImagePubPlugin::initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater) |
| bool | is_normalized (float throttle, const float min, const float max) |
| bool | land_cb (mavros::CommandTOL::Request &req, mavros::CommandTOL::Response &res) |
| bool | list_cb (mavros::FileList::Request &req, mavros::FileList::Response &res) |
| void | list_directory (std::string &path) |
| void | list_directory_end () |
| | LocalPositionPlugin () |
| | MavRosPlugin (const MavRosPlugin &) |
| | MavRosPlugin () |
| | MemInfo (const std::string name) |
| void | mission_ack (enum MAV_MISSION_RESULT type) |
| void | mission_clear_all () |
| void | mission_count (uint16_t cnt) |
| void | mission_item (WaypointItem &wp) |
| void | mission_request (uint16_t seq) |
| void | mission_request_list () |
| void | mission_set_current (uint16_t seq) |
| bool | mkdir_cb (mavros::FileMakeDir::Request &req, mavros::FileMakeDir::Response &res) |
| void | mavplugin::MocapPoseEstimatePlugin::mocap_pose_cb (const geometry_msgs::Pose::ConstPtr &pose) |
| void | mavplugin::MocapPoseEstimatePlugin::mocap_pose_send (uint64_t usec, float x, float y, float z, float roll, float pitch, float yaw) |
| void | mavplugin::MocapPoseEstimatePlugin::mocap_tf_cb (const geometry_msgs::TransformStamped::ConstPtr &trans) |
| | mavplugin::MocapPoseEstimatePlugin::MocapPoseEstimatePlugin () |
| bool | open_cb (mavros::FileOpen::Request &req, mavros::FileOpen::Response &res) |
| bool | open_file (std::string &path, int mode) |
| void | mavplugin::PX4FlowPlugin::optical_flow (uint64_t time_usec, uint8_t sensor_id, uint16_t flow_x, uint16_t flow_y, float flow_comp_m_x, float flow_comp_m_y, uint8_t quality, float ground_distance) |
| void | override_cb (const mavros::OverrideRCIn::ConstPtr req) |
| void | param_request_list () |
| void | param_request_read (std::string id, int16_t index=-1) |
| void | param_set (Parameter ¶m) |
| | ParamPlugin () |
| | ParamSetOpt (Parameter &_p, size_t _rem) |
| void | pose_cb (const geometry_msgs::PoseStamped::ConstPtr &req) |
| void | pose_cov_cb (const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &req) |
| void | process_statustext_apm_quirk (uint8_t severity, std::string &text) |
| void | process_statustext_normal (uint8_t severity, std::string &text) |
| void | mavplugin::ImagePubPlugin::publish_compressed_image () |
| void | mavplugin::ImagePubPlugin::publish_image () |
| void | mavplugin::ImagePubPlugin::publish_raw8u_image () |
| void | publish_waypoints () |
| bool | pull_cb (mavros::ParamPull::Request &req, mavros::ParamPull::Response &res) |
| bool | pull_cb (mavros::WaypointPull::Request &req, mavros::WaypointPull::Response &res) |
| bool | push_cb (mavros::WaypointPush::Request &req, mavros::WaypointPush::Response &res) |
| bool | push_cb (mavros::ParamPush::Request &req, mavros::ParamPush::Response &res) |
| | mavplugin::PX4FlowPlugin::PX4FlowPlugin () |
| uint8_t * | raw_payload () |
| void | rc_channels_override (const boost::array< uint16_t, 8 > &channels) |
| | RCIOPlugin () |
| bool | read_cb (mavros::FileRead::Request &req, mavros::FileRead::Response &res) |
| bool | read_file (std::string &path, size_t off, size_t len) |
| void | read_file_end () |
| bool | remove_cb (mavros::FileRemove::Request &req, mavros::FileRemove::Response &res) |
| void | remove_directory (std::string &path) |
| void | remove_file (std::string &path) |
| bool | rename_ (std::string &old_path, std::string &new_path) |
| bool | rename_cb (mavros::FileRename::Request &req, mavros::FileRename::Response &res) |
| void | request_mission_done (void) |
| bool | reset_cb (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
| void | restart_timeout_timer (void) |
| void | restart_timeout_timer_int (void) |
| bool | rmdir_cb (mavros::FileRemoveDir::Request &req, mavros::FileRemoveDir::Response &res) |
| void | run (diagnostic_updater::DiagnosticStatusWrapper &stat) |
| void | safety_set_allowed_area (uint8_t coordinate_frame, float p1x, float p1y, float p1z, float p2x, float p2y, float p2z) |
| void | safetyarea_cb (const geometry_msgs::PolygonStamped::ConstPtr &req) |
| | SafetyAreaPlugin () |
| void | send (UAS *uas, uint16_t seqNumber) |
| void | send_any_path_command (FTPRequest::Opcode op, const std::string debug_msg, std::string &path, uint32_t offset) |
| void | send_attitude_ang_velocity (const ros::Time &stamp, const float vx, const float vy, const float vz) |
| void | send_attitude_throttle (const float throttle) |
| void | send_attitude_transform (const tf::Transform &transform, const ros::Time &stamp) |
| void | send_calc_file_crc32_command (std::string &path) |
| bool | send_command_int (uint8_t frame, uint16_t command, uint8_t current, uint8_t autocontinue, float param1, float param2, float param3, float param4, int32_t x, int32_t y, float z, unsigned char &success) |
| bool | send_command_long_and_wait (uint16_t command, uint8_t confirmation, float param1, float param2, float param3, float param4, float param5, float param6, float param7, unsigned char &success, uint8_t &result) |
| void | send_create_command () |
| void | send_create_dir_command (std::string &path) |
| void | mavplugin::PX4FlowPlugin::send_flow_cb (const mavros_extras::OpticalFlow::ConstPtr flow_msg) |
| void | send_list_command () |
| void | send_open_ro_command () |
| void | send_open_wo_command () |
| bool | send_param_set_and_wait (Parameter ¶m) |
| void | send_read_command () |
| void | send_remove_command (std::string &path) |
| void | send_remove_dir_command (std::string &path) |
| bool | send_rename_command (std::string &old_path, std::string &new_path) |
| void | send_reset () |
| void | send_safety_set_allowed_area (float p1x, float p1y, float p1z, float p2x, float p2y, float p2z) |
| void | send_setpoint_acceleration (const ros::Time &stamp, float afx, float afy, float afz) |
| void | send_setpoint_transform (const tf::Transform &transform, const ros::Time &stamp) |
| void | send_setpoint_velocity (const ros::Time &stamp, float vx, float vy, float vz, float yaw_rate) |
| void | send_terminate_command (uint32_t session) |
| void | send_truncate_command (std::string &path, size_t length) |
| void | mavplugin::VisionSpeedEstimatePlugin::send_vision_speed (float vx, float vy, float vz, const ros::Time &stamp) |
| void | mavplugin::VisionPoseEstimatePlugin::send_vision_transform (const tf::Transform &transform, const ros::Time &stamp) |
| void | send_waypoint (size_t seq) |
| void | send_write_command (const size_t bytes_to_copy) |
| void | set (float volt, float curr, float rem) |
| void | set (mavlink_sys_status_t &st) |
| void | set (uint16_t v, uint8_t e) |
| void | set (uint16_t f, uint16_t b) |
| void | set_attitude_target (uint32_t time_boot_ms, uint8_t type_mask, float q[4], float roll_rate, float pitch_rate, float yaw_rate, float thrust) |
| bool | set_cb (mavros::ParamSet::Request &req, mavros::ParamSet::Response &res) |
| bool | set_cur_cb (mavros::WaypointSetCurrent::Request &req, mavros::WaypointSetCurrent::Response &res) |
| void | set_current_waypoint (size_t seq) |
| void | set_data_string (std::string &s) |
| void | set_gps_raw (mavlink_gps_raw_int_t &gps) |
| bool | set_home_cb (mavros::CommandHome::Request &req, mavros::CommandHome::Response &res) |
| void | set_min_voltage (float volt) |
| bool | set_mode_cb (mavros::SetMode::Request &req, mavros::SetMode::Response &res) |
| void | set_position_target_local_ned (uint32_t time_boot_ms, uint8_t coordinate_frame, uint16_t type_mask, float x, float y, float z, float vx, float vy, float vz, float afx, float afy, float afz, float yaw, float yaw_rate) |
| bool | set_rate_cb (mavros::StreamRate::Request &req, mavros::StreamRate::Response &res) |
| void | set_timestamp (uint64_t timestamp_us) |
| void | setpoint_cb (const geometry_msgs::PoseStamped::ConstPtr &req) |
| | SetpointAccelerationPlugin () |
| | SetpointAttitudePlugin () |
| | SetpointPositionPlugin () |
| | SetpointVelocityPlugin () |
| friend class | SetPositionTargetLocalNEDMixin |
| void | setup_covariance (boost::array< double, 9 > &cov, double stdev) |
| void | shedule_cb (const ros::TimerEvent &event) |
| void | shedule_pull (const ros::Duration &dt) |
| void | sheduled_pull_cb (const ros::TimerEvent &event) |
| void | sys_time_cb (const ros::TimerEvent &event) |
| | SystemStatusDiag (const std::string name) |
| | SystemStatusPlugin () |
| | SystemTimePlugin () |
| bool | takeoff_cb (mavros::CommandTOL::Request &req, mavros::CommandTOL::Response &res) |
| | TDRRadioPlugin () |
| | TDRRadioStatus (const std::string name, uint8_t _low_rssi) |
| void | tf_listener (void) |
| void | tf_start (const char *_thd_name, void(D::*cbp)(const tf::Transform &, const ros::Time &)) |
| friend class | TFListenerMixin |
| void | throttle_cb (const std_msgs::Float64::ConstPtr &req) |
| void | tick (int64_t dt, uint64_t timestamp_us) |
| void | timeout_cb (const ros::TimerEvent &event) |
| | TimeSyncStatus (const std::string name, size_t win_size) |
| static int64_t | to_integer (param_t &p) |
| static mavros::Waypoint | to_msg (WaypointItem &wp) |
| static mavlink_param_union_t | to_param_union (param_t p) |
| mavlink_param_union_t | to_param_union (Parameter::param_t p) |
| static mavlink_param_union_t | to_param_union_apm_quirk (param_t p) |
| static double | to_real (param_t &p) |
| static std::string | to_string_command (WaypointItem &wpi) |
| static std::string | to_string_frame (WaypointItem &wpi) |
| static std::string | to_string_vt (param_t p) |
| static XmlRpc::XmlRpcValue | to_xmlrpc_value (param_t &p) |
| bool | truncate_cb (mavros::FileTruncate::Request &req, mavros::FileTruncate::Response &res) |
| void | truncate_file (std::string &path, size_t length) |
| void | twist_cb (const geometry_msgs::TwistStamped::ConstPtr &req) |
| void | uas_store_attitude (tf::Quaternion &orientation, geometry_msgs::Vector3 &gyro_vec, geometry_msgs::Vector3 &acc_vec) |
| void | vel_cb (const geometry_msgs::TwistStamped::ConstPtr &req) |
| void | mavplugin::VisionSpeedEstimatePlugin::vel_speed_cb (const geometry_msgs::Vector3Stamped::ConstPtr &req) |
| void | mavplugin::VisionSpeedEstimatePlugin::vel_twist_cb (const geometry_msgs::TwistStamped::ConstPtr &req) |
| | VfrHudPlugin () |
| void | mavplugin::VisionPoseEstimatePlugin::vision_cb (const geometry_msgs::PoseStamped::ConstPtr &req) |
| void | mavplugin::VisionPoseEstimatePlugin::vision_cov_cb (const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &req) |
| void | mavplugin::VisionPoseEstimatePlugin::vision_position_estimate (uint64_t usec, float x, float y, float z, float roll, float pitch, float yaw) |
| void | mavplugin::VisionSpeedEstimatePlugin::vision_speed_estimate (uint64_t usec, float x, float y, float z) |
| | mavplugin::VisionPoseEstimatePlugin::VisionPoseEstimatePlugin () |
| | mavplugin::VisionSpeedEstimatePlugin::VisionSpeedEstimatePlugin () |
| bool | wait_ack_for (CommandTransaction *tr) |
| bool | wait_completion (const int msecs) |
| bool | wait_fetch_all () |
| bool | wait_param_set_ack_for (ParamSetOpt *opt) |
| bool | wait_push_all () |
| | WaypointPlugin () |
| size_t | write_bytes_to_copy () |
| bool | write_cb (mavros::FileWrite::Request &req, mavros::FileWrite::Response &res) |
| bool | write_file (std::string &path, size_t off, V_FileData &data) |
| void | write_file_end () |
| virtual | ~MavRosPlugin () |
Variables |
| ros::Subscriber | accel_sub |
| std::condition_variable | ack |
| std::condition_variable | ack |
| const ros::Duration | ACK_TIMEOUT_DT |
| static constexpr int | ACK_TIMEOUT_MS |
| std::list< CommandTransaction * > | ack_waiting_list |
| uint32_t | active_session |
| boost::array< double, 9 > | angular_velocity_cov |
| ros::ServiceServer | arming_srv |
| ros::Subscriber | att_sub |
| bool | autocontinue |
| BatteryStatusDiag | batt_diag |
| ros::Publisher | batt_pub |
| const ros::Duration | BOOTUP_TIME_DT |
| const ros::Duration | BOOTUP_TIME_DT |
| static constexpr int | BOOTUP_TIME_MS |
| static constexpr int | BOOTUP_TIME_MS |
| uint16_t | brkval |
| uint32_t | checksum_crc32 |
| ros::ServiceServer | checksum_srv |
| std::string | child_frame_id |
| std::string | child_frame_id |
| std::string | child_frame_id |
| std::string | child_frame_id |
| std::string | mavplugin::VisionPoseEstimatePlugin::child_frame_id |
| static constexpr int | CHUNK_TIMEOUT_MS |
| ros::ServiceServer | clear_srv |
| ros::ServiceServer | close_srv |
| ros::NodeHandle | cmd_nh |
| enum MAV_CMD | command |
| ros::ServiceServer | command_int_srv |
| ros::ServiceServer | command_long_srv |
| std::condition_variable | cond |
| std::mutex | cond_mutex |
| std::mutex | cond_mutex |
| std::mutex | cond_mutex |
| int | count_ |
| uint8_t | current |
| float | current |
| uint8_t | data [] |
| static const uint8_t | DATA_MAXSZ |
| bool | data_received |
| static const char | DIRENT_DIR |
| static const char | DIRENT_FILE |
| static const char | DIRENT_SKIP |
| bool | do_pull_after_gcs |
| TimeSyncStatus | dt_diag |
| int64_t | dt_sum |
| std::atomic< uint16_t > | eph |
| std::atomic< uint16_t > | epv |
| uint16_t | expected_command |
| ros::Publisher | fix_pub |
| ros::Publisher | fix_pub |
| std::atomic< int > | fix_type |
| ros::Publisher | mavplugin::PX4FlowPlugin::flow_pub |
| ros::Subscriber | mavplugin::PX4FlowPlugin::flow_sub |
| enum MAV_FRAME | frame |
| std::string | frame_id |
| std::string | frame_id |
| std::string | frame_id |
| std::string | frame_id |
| std::string | frame_id |
| std::string | frame_id |
| std::string | frame_id |
| std::string | mavplugin::ImagePubPlugin::frame_id |
| std::string | mavplugin::VisionPoseEstimatePlugin::frame_id |
| ssize_t | freemem |
| ros::NodeHandle | ftp_nh |
| static constexpr double | GAUSS_TO_TESLA |
| ros::ServiceServer | get_srv |
| ros::ServiceServer | goto_srv |
| ros::NodeHandle | gp_nh |
| GPSInfo | gps_diag |
| ros::ServiceServer | guided_srv |
| bool | has_att_quat |
| bool | has_hr_imu |
| bool | has_radio_status |
| bool | has_rc_channels_msg |
| bool | has_scaled_imu |
| HeartbeatStatus | hb_diag |
| ros::Publisher | hdg_pub |
| ros::Timer | heartbeat_timer |
| int | hist_indx_ |
| int | hist_indx_ |
| HwStatus | hwst_diag |
| size_t | i2cerr |
| size_t | i2cerr_last |
| std::vector< uint8_t > | mavplugin::ImagePubPlugin::im_buffer |
| size_t | mavplugin::ImagePubPlugin::im_height |
| size_t | mavplugin::ImagePubPlugin::im_packets |
| size_t | mavplugin::ImagePubPlugin::im_payload |
| size_t | mavplugin::ImagePubPlugin::im_seqnr |
| size_t | mavplugin::ImagePubPlugin::im_size |
| uint8_t | mavplugin::ImagePubPlugin::im_type |
| size_t | mavplugin::ImagePubPlugin::im_width |
| image_transport::Publisher | mavplugin::ImagePubPlugin::image_pub |
| ros::Publisher | imu_pub |
| ros::Publisher | imu_raw_pub |
| bool | is_error |
| bool | is_timedout |
| bool | is_timedout |
| bool | is_timedout |
boost::shared_ptr
< image_transport::ImageTransport > | mavplugin::ImagePubPlugin::itp |
| | kCmdCalcFileCRC32 |
| | kCmdCreateDirectory |
| | kCmdCreateFile |
| | kCmdListDirectory |
| | kCmdNone |
| | kCmdOpenFileRO |
| | kCmdOpenFileWO |
| | kCmdReadFile |
| | kCmdRemoveDirectory |
| | kCmdRemoveFile |
| | kCmdRename |
| | kCmdResetSessions |
| | kCmdTerminateSession |
| | kCmdTruncateFile |
| | kCmdWriteFile |
| | kErrEOF |
| | kErrFail |
| | kErrFailErrno |
| | kErrInvalidDataSize |
| | kErrInvalidSession |
| | kErrNone |
| | kErrNoSessionsAvailable |
| | kErrUnknownCommand |
| | kRspAck |
| | kRspNak |
| ros::ServiceServer | land_srv |
| int64_t | last_dt |
| mavlink_heartbeat_t | last_hb |
| mavlink_radio_status_t | last_rst |
| uint16_t | last_send_seqnr |
| mavlink_sys_status_t | last_st |
| ros::Time | mavplugin::VisionPoseEstimatePlugin::last_transform_stamp |
| uint64_t | last_ts |
| geometry_msgs::Vector3 | linear_accel_vec |
| boost::array< double, 9 > | linear_acceleration_cov |
| std::mutex | list_cond_mutex |
| std::vector< mavros::FileEntry > | list_entries |
| uint32_t | list_offset |
| std::string | list_path |
| std::condition_variable | list_receiving |
| std::condition_variable | list_receiving |
| std::condition_variable | list_sending |
| ros::ServiceServer | list_srv |
| const ros::Duration | LIST_TIMEOUT_DT |
| const ros::Duration | LIST_TIMEOUT_DT |
| static constexpr int | LIST_TIMEOUT_MS |
| static constexpr int | LIST_TIMEOUT_MS |
| static constexpr int | LIST_TIMEOUT_MS |
| ros::Publisher | local_position |
| const uint8_t | low_rssi |
| ros::Publisher | magn_pub |
| boost::array< double, 9 > | magnetic_cov |
| static constexpr size_t | mavplugin::ImagePubPlugin::MAX_BUFFER_RESERVE_DIFF = 0x20000 |
| | Maximum difference for im_buffer.capacity() and im_size (100 KiB)
|
| const double | max_freq_ |
| const double | max_freq_ |
| static constexpr size_t | MAX_RESERVE_DIFF |
| MemInfo | mem_diag |
| static constexpr double | MILLIBAR_TO_PASCAL |
| static constexpr double | MILLIG_TO_MS2 |
| static constexpr double | MILLIRS_TO_RADSEC |
| static constexpr double | MILLIT_TO_TESLA |
| const double | min_freq_ |
| const double | min_freq_ |
| float | min_voltage |
| ros::ServiceServer | mkdir_srv |
| ros::Subscriber | mavplugin::MocapPoseEstimatePlugin::mocap_pose_sub |
| ros::Subscriber | mavplugin::MocapPoseEstimatePlugin::mocap_tf_sub |
| ros::ServiceServer | mode_srv |
| ros::NodeHandle | mavplugin::MocapPoseEstimatePlugin::mp_nh |
| std::recursive_mutex | mutex |
| std::recursive_mutex | mutex |
| std::recursive_mutex | mutex |
| std::recursive_mutex | mutex |
| std::recursive_mutex | mutex |
| std::recursive_mutex | mutex |
| std::recursive_mutex | mutex |
| std::recursive_mutex | mutex |
| std::recursive_mutex | mutex |
| std::recursive_mutex | mutex |
| uint32_t | offset |
| | OP_ACK |
| | OP_CHECKSUM |
| | OP_IDLE |
| | OP_LIST |
| | OP_OPEN |
| | OP_READ |
| OpState | op_state |
| | OP_WRITE |
| uint8_t | opcode |
| std::string | open_path |
| size_t | open_size |
| ros::ServiceServer | open_srv |
| static constexpr int | OPEN_TIMEOUT_MS |
| boost::array< double, 9 > | orientation_cov |
| ros::Subscriber | override_sub |
| uint8_t | padding [2] |
| Parameter | param |
| float | param1 |
| float | param2 |
| float | param3 |
| float | param4 |
| uint16_t | param_count |
| ssize_t | param_count |
| std::string | param_id |
| uint16_t | param_index |
| ros::NodeHandle | param_nh |
| size_t | param_rx_retries |
| enum mavplugin::ParamPlugin:: { ... } | param_state |
| const ros::Duration | PARAM_TIMEOUT_DT |
| static constexpr int | PARAM_TIMEOUT_MS |
| param_t | param_value |
| std::map< std::string, Parameter > | parameters |
| std::list< uint16_t > | parameters_missing_idx |
| ros::NodeHandle | pos_nh |
| ros::Publisher | pos_pub |
| | PR_IDLE |
| | PR_RXLIST |
| | PR_RXPARAM |
| | PR_TXPARAM |
| ros::Publisher | press_pub |
| ros::ServiceServer | pull_srv |
| ros::ServiceServer | pull_srv |
| ros::ServiceServer | push_srv |
| ros::ServiceServer | push_srv |
| int | r_errno |
| ros::ServiceServer | rate_srv |
| std::vector< uint16_t > | raw_rc_in |
| std::vector< uint16_t > | raw_rc_out |
| ros::Publisher | rc_in_pub |
| ros::NodeHandle | rc_nh |
| ros::Publisher | rc_out_pub |
| V_FileData | read_buffer |
| uint32_t | read_offset |
| size_t | read_size |
| ros::ServiceServer | read_srv |
| std::mutex | recv_cond_mutex |
| ros::Publisher | rel_alt_pub |
| float | remaining |
| ros::ServiceServer | remove_srv |
| ros::ServiceServer | rename_srv |
| uint8_t | req_opcode |
| ros::ServiceServer | reset_srv |
| const ros::Duration | RESHEDULE_DT |
| static constexpr int | RESHEDULE_MS |
| bool | reshedule_pull |
| uint8_t | result |
| static constexpr int | RETRIES_COUNT |
| static constexpr int | RETRIES_COUNT |
| size_t | retries_remaining |
| bool | reverse_throttle |
| ros::ServiceServer | rmdir_srv |
| double | rot_cov |
| ros::NodeHandle | safety_nh |
| ros::Subscriber | safetyarea_sub |
| std::atomic< int > | satellites_visible |
| std::mutex | send_cond_mutex |
| bool | send_force |
| bool | send_tf |
| bool | send_tf |
| std::vector< WaypointItem > | send_waypoints |
| uint16_t | seq |
| std::vector< int > | seq_nums_ |
| std::vector< int > | seq_nums_ |
| uint16_t | seqNumber |
| uint8_t | session |
| std::map< std::string, uint32_t > | session_file_map |
| ros::ServiceServer | set_cur_srv |
| ros::ServiceServer | set_home_srv |
std::map< std::string,
ParamSetOpt * > | set_parameters |
| ros::ServiceServer | set_srv |
| ros::Subscriber | setpoint_sub |
| ros::Timer | shedule_timer |
| ros::Timer | shedule_timer |
| uint8_t | size |
| ros::NodeHandle | sp_nh |
| ros::NodeHandle | sp_nh |
| ros::NodeHandle | sp_nh |
| ros::NodeHandle | sp_nh |
| ros::NodeHandle | mavplugin::VisionSpeedEstimatePlugin::sp_nh |
| ros::NodeHandle | mavplugin::VisionPoseEstimatePlugin::sp_nh |
| ros::Publisher | state_pub |
| ros::Publisher | status_pub |
| SystemStatusDiag | sys_diag |
| ros::Timer | sys_time_timer |
| ros::ServiceServer | takeoff_srv |
| TDRRadioStatus | tdr_diag |
| ros::Publisher | temp_pub |
| tf::TransformBroadcaster | tf_broadcaster |
| tf::TransformBroadcaster | tf_broadcaster |
| double | tf_rate |
| double | tf_rate |
| double | mavplugin::VisionPoseEstimatePlugin::tf_rate |
| std::thread | tf_thread |
boost::function< void(const
tf::Transform &, const
ros::Time &)> | tf_transform_cb |
| std::string | thd_name |
| ros::Subscriber | throttle_sub |
| ros::Publisher | time_offset_pub |
| uint64_t | time_offset_us |
| ros::Publisher | time_ref_pub |
| ros::Publisher | time_ref_pub |
| std::string | time_ref_source |
| std::string | time_ref_source |
| ros::Timer | timeout_timer |
| ros::Timer | timeout_timer |
| std::vector< ros::Time > | times_ |
| std::vector< ros::Time > | times_ |
| const double | tolerance_ |
| const double | tolerance_ |
| ros::ServiceServer | truncate_srv |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | uas |
| UAS * | mavplugin::PX4FlowPlugin::uas |
| UAS * | mavplugin::VisionSpeedEstimatePlugin::uas |
| UAS * | mavplugin::MocapPoseEstimatePlugin::uas |
| UAS * | mavplugin::VisionPoseEstimatePlugin::uas |
| boost::array< double, 9 > | unk_orientation_cov |
| float | vcc |
| ros::Publisher | vel_pub |
| ros::Publisher | vel_pub |
| ros::Subscriber | vel_sub |
| ros::Publisher | vfr_pub |
| ros::Subscriber | mavplugin::VisionPoseEstimatePlugin::vision_sub |
| ros::Subscriber | mavplugin::VisionSpeedEstimatePlugin::vision_vel_sub |
| float | voltage |
| std::vector< WaypointItem > | waypoints |
| ros::Publisher | wind_pub |
| const size_t | window_size_ |
| const size_t | window_size_ |
| | WP_CLEAR |
| size_t | wp_count |
| size_t | wp_cur_active |
| size_t | wp_cur_id |
| | WP_IDLE |
| ros::Publisher | wp_list_pub |
| ros::NodeHandle | wp_nh |
| size_t | wp_retries |
| | WP_RXLIST |
| | WP_RXWP |
| size_t | wp_set_active |
| | WP_SET_CUR |
enum
mavplugin::WaypointPlugin:: { ... } | wp_state |
| const ros::Duration | WP_TIMEOUT_DT |
| static constexpr int | WP_TIMEOUT_MS |
| ros::Timer | wp_timer |
| | WP_TXLIST |
| | WP_TXWP |
| V_FileData | write_buffer |
| V_FileData::iterator | write_it |
| uint32_t | write_offset |
| ros::ServiceServer | write_srv |
| double | x_lat |
| double | y_long |
| double | z_alt |
Friends |
| class | mavplugin::VisionPoseEstimatePlugin::TFListenerMixin |