Classes | Defines | Typedefs | Enumerations | Functions | Variables
ieee80211_i.h File Reference
#include <linux/kernel.h>
#include <linux/device.h>
#include <linux/if_ether.h>
#include <linux/interrupt.h>
#include <linux/list.h>
#include <linux/netdevice.h>
#include <linux/skbuff.h>
#include <linux/workqueue.h>
#include <linux/types.h>
#include <linux/spinlock.h>
#include <linux/etherdevice.h>
#include <linux/leds.h>
#include <net/ieee80211_radiotap.h>
#include <net/cfg80211.h>
#include <net/mac80211.h>
#include "key.h"
#include "sta_info.h"
Include dependency graph for kernel-3.2/ieee80211_i.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

struct  beacon_data
struct  ieee80211_bss
struct  ieee80211_fragment_entry
struct  ieee80211_if_ap
struct  ieee80211_if_ibss
struct  ieee80211_if_managed
struct  ieee80211_if_mesh
struct  ieee80211_if_vlan
struct  ieee80211_if_wds
struct  ieee80211_local
struct  ieee80211_ra_tid
struct  ieee80211_rx_data
struct  ieee80211_sub_if_data
struct  ieee80211_tx_data
struct  ieee80211_work
struct  mesh_preq_queue
struct  mesh_stats
struct  skb_eosp_msg_data

Defines

#define AP_MAX_BC_BUFFER   128
#define debug_noinline
#define I802_DEBUG_INC(c)   do { } while (0)
#define IEEE80211_DEFAULT_MAX_SP_LEN   IEEE80211_WMM_IE_STA_QOSINFO_SP_ALL
#define IEEE80211_DEFAULT_UAPSD_QUEUES
#define IEEE80211_ENCRYPT_HEADROOM   8
#define IEEE80211_ENCRYPT_TAILROOM   18
#define IEEE80211_FRAGMENT_MAX   4
#define IEEE80211_IFSTA_MESH_CTR_INC(msh, name)   do { } while (0)
#define IEEE80211_IRQSAFE_QUEUE_LIMIT   128
#define IEEE80211_MAX_SUPP_RATES   32
#define IEEE80211_TX_PS_BUFFERED   BIT(2)
#define IEEE80211_TX_UNICAST   BIT(1)
#define PREQ_Q_F_REFRESH   0x2
#define PREQ_Q_F_START   0x1
#define RX_CONTINUE   ((__force ieee80211_rx_result) 0u)
#define RX_DROP_MONITOR   ((__force ieee80211_rx_result) 2u)
#define RX_DROP_UNUSABLE   ((__force ieee80211_rx_result) 1u)
#define RX_QUEUED   ((__force ieee80211_rx_result) 3u)
#define TOTAL_MAX_TX_BUFFER   512
#define TU_TO_EXP_TIME(x)   (jiffies + usecs_to_jiffies((x) * 1024))
#define TX_CONTINUE   ((__force ieee80211_tx_result) 0u)
#define TX_DROP   ((__force ieee80211_tx_result) 1u)
#define TX_QUEUED   ((__force ieee80211_tx_result) 2u)

Typedefs

typedef unsigned __bitwise__ ieee80211_rx_result
typedef unsigned __bitwise__ ieee80211_tx_result

Enumerations

enum  { IEEE80211_RX_MSG = 1, IEEE80211_TX_STATUS_MSG = 2, IEEE80211_EOSP_MSG = 3 }
enum  {
  SCAN_SW_SCANNING, SCAN_HW_SCANNING, SCAN_OFF_CHANNEL, SCAN_COMPLETED,
  SCAN_ABORTED
}
enum  ieee80211_chan_mode {
  CHAN_MODE_UNDEFINED, CHAN_MODE_HOPPING, CHAN_MODE_FIXED, CHAN_MODE_UNDEFINED,
  CHAN_MODE_HOPPING, CHAN_MODE_FIXED
}
enum  ieee80211_packet_rx_flags {
  IEEE80211_RX_IN_SCAN = BIT(0), IEEE80211_RX_RA_MATCH = BIT(1), IEEE80211_RX_FRAGMENTED = BIT(2), IEEE80211_RX_AMSDU = BIT(3),
  IEEE80211_RX_MALFORMED_ACTION_FRM = BIT(4), IEEE80211_RX_DEFERRED_RELEASE = BIT(5), IEEE80211_RX_IN_SCAN = BIT(0), IEEE80211_RX_RA_MATCH = BIT(1),
  IEEE80211_RX_FRAGMENTED = BIT(2), IEEE80211_RX_AMSDU = BIT(3), IEEE80211_RX_MALFORMED_ACTION_FRM = BIT(4), IEEE80211_RX_DEFERRED_RELEASE = BIT(5)
}
enum  ieee80211_rx_flags { IEEE80211_RX_CMNTR = BIT(0), IEEE80211_RX_CMNTR = BIT(0), IEEE80211_RX_BEACON_REPORTED = BIT(1) }
enum  ieee80211_sdata_state_bits { SDATA_STATE_RUNNING, SDATA_STATE_OFFCHANNEL, SDATA_STATE_RUNNING, SDATA_STATE_OFFCHANNEL }
enum  ieee80211_sta_flags {
  IEEE80211_STA_BEACON_POLL = BIT(0), IEEE80211_STA_CONNECTION_POLL = BIT(1), IEEE80211_STA_CONTROL_PORT = BIT(2), IEEE80211_STA_DISABLE_11N = BIT(4),
  IEEE80211_STA_CSA_RECEIVED = BIT(5), IEEE80211_STA_MFP_ENABLED = BIT(6), IEEE80211_STA_UAPSD_ENABLED = BIT(7), IEEE80211_STA_NULLFUNC_ACKED = BIT(8),
  IEEE80211_STA_RESET_SIGNAL_AVE = BIT(9), IEEE80211_STA_BEACON_POLL = BIT(0), IEEE80211_STA_CONNECTION_POLL = BIT(1), IEEE80211_STA_CONTROL_PORT = BIT(2),
  IEEE80211_STA_DISABLE_11N = BIT(4), IEEE80211_STA_CSA_RECEIVED = BIT(5), IEEE80211_STA_MFP_ENABLED = BIT(6), IEEE80211_STA_UAPSD_ENABLED = BIT(7),
  IEEE80211_STA_NULLFUNC_ACKED = BIT(8), IEEE80211_STA_RESET_SIGNAL_AVE = BIT(9), IEEE80211_STA_DISABLE_40MHZ = BIT(10)
}
enum  ieee80211_sub_if_data_flags {
  IEEE80211_SDATA_ALLMULTI = BIT(0), IEEE80211_SDATA_PROMISC = BIT(1), IEEE80211_SDATA_OPERATING_GMODE = BIT(2), IEEE80211_SDATA_DONT_BRIDGE_PACKETS = BIT(3),
  IEEE80211_SDATA_DISCONNECT_RESUME = BIT(4), IEEE80211_SDATA_ALLMULTI = BIT(0), IEEE80211_SDATA_PROMISC = BIT(1), IEEE80211_SDATA_OPERATING_GMODE = BIT(2),
  IEEE80211_SDATA_DONT_BRIDGE_PACKETS = BIT(3), IEEE80211_SDATA_DISCONNECT_RESUME = BIT(4), IEEE80211_SDATA_IN_DRIVER = BIT(5)
}
enum  ieee80211_work_type {
  IEEE80211_WORK_ABORT, IEEE80211_WORK_DIRECT_PROBE, IEEE80211_WORK_AUTH, IEEE80211_WORK_ASSOC_BEACON_WAIT,
  IEEE80211_WORK_ASSOC, IEEE80211_WORK_REMAIN_ON_CHANNEL, IEEE80211_WORK_OFFCHANNEL_TX, IEEE80211_WORK_ABORT,
  IEEE80211_WORK_REMAIN_ON_CHANNEL, IEEE80211_WORK_OFFCHANNEL_TX
}
enum  mac80211_scan_state {
  SCAN_DECISION, SCAN_SET_CHANNEL, SCAN_SEND_PROBE, SCAN_LEAVE_OPER_CHANNEL,
  SCAN_ENTER_OPER_CHANNEL, SCAN_DECISION, SCAN_SET_CHANNEL, SCAN_SEND_PROBE,
  SCAN_SUSPEND, SCAN_RESUME
}
enum  queue_stop_reason {
  IEEE80211_QUEUE_STOP_REASON_DRIVER, IEEE80211_QUEUE_STOP_REASON_PS, IEEE80211_QUEUE_STOP_REASON_CSA, IEEE80211_QUEUE_STOP_REASON_AGGREGATION,
  IEEE80211_QUEUE_STOP_REASON_SUSPEND, IEEE80211_QUEUE_STOP_REASON_SKB_ADD, IEEE80211_QUEUE_STOP_REASON_CHTYPE_CHANGE, IEEE80211_QUEUE_STOP_REASON_DRIVER,
  IEEE80211_QUEUE_STOP_REASON_PS, IEEE80211_QUEUE_STOP_REASON_CSA, IEEE80211_QUEUE_STOP_REASON_AGGREGATION, IEEE80211_QUEUE_STOP_REASON_SUSPEND,
  IEEE80211_QUEUE_STOP_REASON_SKB_ADD
}
enum  sdata_queue_type {
  IEEE80211_SDATA_QUEUE_TYPE_FRAME = 0, IEEE80211_SDATA_QUEUE_AGG_START = 1, IEEE80211_SDATA_QUEUE_AGG_STOP = 2, IEEE80211_SDATA_QUEUE_TYPE_FRAME = 0,
  IEEE80211_SDATA_QUEUE_AGG_START = 1, IEEE80211_SDATA_QUEUE_AGG_STOP = 2
}
enum  work_done_result { WORK_DONE_DESTROY, WORK_DONE_REQUEUE, WORK_DONE_DESTROY, WORK_DONE_REQUEUE }

Functions

void ___ieee80211_stop_rx_ba_session (struct sta_info *sta, u16 tid, u16 initiator, u16 reason, bool stop)
int ___ieee80211_stop_tx_ba_session (struct sta_info *sta, u16 tid, enum ieee80211_back_parties initiator, bool tx)
u32 __ieee80211_recalc_idle (struct ieee80211_local *local)
int __ieee80211_request_smps (struct ieee80211_sub_if_data *sdata, enum ieee80211_smps_mode smps_mode)
static int __ieee80211_resume (struct ieee80211_hw *hw)
void __ieee80211_stop_rx_ba_session (struct sta_info *sta, u16 tid, u16 initiator, u16 reason, bool stop)
int __ieee80211_stop_tx_ba_session (struct sta_info *sta, u16 tid, enum ieee80211_back_parties initiator, bool tx)
static int __ieee80211_suspend (struct ieee80211_hw *hw, struct cfg80211_wowlan *wowlan)
static u8bss_mesh_cfg (struct ieee80211_bss *bss)
static u8bss_mesh_id (struct ieee80211_bss *bss)
static u8 bss_mesh_id_len (struct ieee80211_bss *bss)
void free_work (struct ieee80211_work *wk)
static struct ieee80211_localhw_to_local (struct ieee80211_hw *hw)
void ieee80211_add_pending_skb (struct ieee80211_local *local, struct sk_buff *skb)
void ieee80211_add_pending_skbs (struct ieee80211_local *local, struct sk_buff_head *skbs)
void ieee80211_add_pending_skbs_fn (struct ieee80211_local *local, struct sk_buff_head *skbs, void(*fn)(void *data), void *data)
void ieee80211_add_work (struct ieee80211_work *wk)
void ieee80211_adjust_monitor_flags (struct ieee80211_sub_if_data *sdata, const int offset)
void ieee80211_ba_session_work (struct work_struct *work)
void ieee80211_beacon_connection_loss_work (struct work_struct *work)
void ieee80211_bss_info_change_notify (struct ieee80211_sub_if_data *sdata, u32 changed)
struct ieee80211_bssieee80211_bss_info_update (struct ieee80211_local *local, struct ieee80211_rx_status *rx_status, struct ieee80211_mgmt *mgmt, size_t len, struct ieee802_11_elems *elems, struct ieee80211_channel *channel, bool beacon)
static int ieee80211_bssid_match (const u8 *raddr, const u8 *addr)
int ieee80211_build_preq_ies (struct ieee80211_local *local, u8 *buffer, const u8 *ie, size_t ie_len, enum ieee80211_band band, u32 rate_mask, u8 channel)
struct sk_buffieee80211_build_probe_req (struct ieee80211_sub_if_data *sdata, u8 *dst, u32 ratemask, const u8 *ssid, size_t ssid_len, const u8 *ie, size_t ie_len, bool directed)
void ieee80211_clear_tx_pending (struct ieee80211_local *local)
void ieee80211_configure_filter (struct ieee80211_local *local)
static struct
ieee80211_sub_if_data
IEEE80211_DEV_TO_SUB_IF (struct net_device *dev)
void ieee80211_dynamic_ps_disable_work (struct work_struct *work)
void ieee80211_dynamic_ps_enable_work (struct work_struct *work)
void ieee80211_dynamic_ps_timer (unsigned long data)
int ieee80211_frame_duration (struct ieee80211_local *local, size_t len, int rate, int erp, int short_preamble)
u8ieee80211_get_bssid (struct ieee80211_hdr *hdr, size_t len, enum nl80211_iftype type)
enum ieee80211_chan_mode ieee80211_get_channel_mode (struct ieee80211_local *local, struct ieee80211_sub_if_data *ignore)
void ieee80211_ht_cap_ie_to_sta_ht_cap (struct ieee80211_supported_band *sband, struct ieee80211_ht_cap *ht_cap_ie, struct ieee80211_sta_ht_cap *ht_cap)
int ieee80211_hw_config (struct ieee80211_local *local, u32 changed)
void ieee80211_hw_roc_setup (struct ieee80211_local *local)
struct sta_infoieee80211_ibss_add_sta (struct ieee80211_sub_if_data *sdata, u8 *bssid, u8 *addr, u32 supp_rates, gfp_t gfp)
int ieee80211_ibss_join (struct ieee80211_sub_if_data *sdata, struct cfg80211_ibss_params *params)
int ieee80211_ibss_leave (struct ieee80211_sub_if_data *sdata)
void ieee80211_ibss_notify_scan_completed (struct ieee80211_local *local)
void ieee80211_ibss_quiesce (struct ieee80211_sub_if_data *sdata)
void ieee80211_ibss_restart (struct ieee80211_sub_if_data *sdata)
void ieee80211_ibss_rx_queued_mgmt (struct ieee80211_sub_if_data *sdata, struct sk_buff *skb)
void ieee80211_ibss_setup_sdata (struct ieee80211_sub_if_data *sdata)
void ieee80211_ibss_work (struct ieee80211_sub_if_data *sdata)
size_t ieee80211_ie_split (const u8 *ies, size_t ielen, const u8 *ids, int n_ids, size_t offset)
size_t ieee80211_ie_split_vendor (const u8 *ies, size_t ielen, size_t offset)
int ieee80211_if_add (struct ieee80211_local *local, const char *name, struct net_device **new_dev, enum nl80211_iftype type, struct vif_params *params)
int ieee80211_if_change_type (struct ieee80211_sub_if_data *sdata, enum nl80211_iftype type)
void ieee80211_if_remove (struct ieee80211_sub_if_data *sdata)
void ieee80211_iface_exit (void)
int ieee80211_iface_init (void)
u32 ieee80211_mandatory_rates (struct ieee80211_local *local, enum ieee80211_band band)
int ieee80211_max_network_latency (struct notifier_block *nb, unsigned long data, void *dummy)
void ieee80211_mesh_rx_queued_mgmt (struct ieee80211_sub_if_data *sdata, struct sk_buff *skb)
void ieee80211_mesh_work (struct ieee80211_sub_if_data *sdata)
int ieee80211_mgd_assoc (struct ieee80211_sub_if_data *sdata, struct cfg80211_assoc_request *req)
int ieee80211_mgd_auth (struct ieee80211_sub_if_data *sdata, struct cfg80211_auth_request *req)
int ieee80211_mgd_deauth (struct ieee80211_sub_if_data *sdata, struct cfg80211_deauth_request *req, void *cookie)
int ieee80211_mgd_disassoc (struct ieee80211_sub_if_data *sdata, struct cfg80211_disassoc_request *req, void *cookie)
void ieee80211_mlme_notify_scan_completed (struct ieee80211_local *local)
netdev_tx_t ieee80211_monitor_start_xmit (struct sk_buff *skb, struct net_device *dev)
void ieee80211_offchannel_return (struct ieee80211_local *local, bool enable_beaconing)
void ieee80211_offchannel_stop_beaconing (struct ieee80211_local *local)
void ieee80211_offchannel_stop_station (struct ieee80211_local *local)
void ieee80211_process_addba_request (struct ieee80211_local *local, struct sta_info *sta, struct ieee80211_mgmt *mgmt, size_t len)
void ieee80211_process_addba_resp (struct ieee80211_local *local, struct sta_info *sta, struct ieee80211_mgmt *mgmt, size_t len)
void ieee80211_process_delba (struct ieee80211_sub_if_data *sdata, struct sta_info *sta, struct ieee80211_mgmt *mgmt, size_t len)
void ieee80211_process_measurement_req (struct ieee80211_sub_if_data *sdata, struct ieee80211_mgmt *mgmt, size_t len)
void ieee80211_recalc_idle (struct ieee80211_local *local)
void ieee80211_recalc_ps (struct ieee80211_local *local, s32 latency)
void ieee80211_recalc_smps (struct ieee80211_local *local)
int ieee80211_reconfig (struct ieee80211_local *local)
void ieee80211_release_reorder_timeout (struct sta_info *sta, int tid)
void ieee80211_remove_interfaces (struct ieee80211_local *local)
int ieee80211_request_internal_scan (struct ieee80211_sub_if_data *sdata, const u8 *ssid, u8 ssid_len, struct ieee80211_channel *chan)
int ieee80211_request_scan (struct ieee80211_sub_if_data *sdata, struct cfg80211_scan_request *req)
int ieee80211_request_sched_scan_start (struct ieee80211_sub_if_data *sdata, struct cfg80211_sched_scan_request *req)
int ieee80211_request_sched_scan_stop (struct ieee80211_sub_if_data *sdata)
void ieee80211_request_smps_work (struct work_struct *work)
u32 ieee80211_reset_erp_info (struct ieee80211_sub_if_data *sdata)
struct ieee80211_bssieee80211_rx_bss_get (struct ieee80211_local *local, u8 *bssid, int freq, u8 *ssid, u8 ssid_len)
void ieee80211_rx_bss_put (struct ieee80211_local *local, struct ieee80211_bss *bss)
void ieee80211_scan_cancel (struct ieee80211_local *local)
ieee80211_rx_result ieee80211_scan_rx (struct ieee80211_sub_if_data *sdata, struct sk_buff *skb)
void ieee80211_scan_work (struct work_struct *work)
void ieee80211_sched_scan_stopped_work (struct work_struct *work)
static bool ieee80211_sdata_running (struct ieee80211_sub_if_data *sdata)
void ieee80211_send_auth (struct ieee80211_sub_if_data *sdata, u16 transaction, u16 auth_alg, u8 *extra, size_t extra_len, const u8 *bssid, const u8 *key, u8 key_len, u8 key_idx)
void ieee80211_send_delba (struct ieee80211_sub_if_data *sdata, const u8 *da, u16 tid, u16 initiator, u16 reason_code)
void ieee80211_send_nullfunc (struct ieee80211_local *local, struct ieee80211_sub_if_data *sdata, int powersave)
void ieee80211_send_probe_req (struct ieee80211_sub_if_data *sdata, u8 *dst, const u8 *ssid, size_t ssid_len, const u8 *ie, size_t ie_len, u32 ratemask, bool directed, bool no_cck)
void ieee80211_send_pspoll (struct ieee80211_local *local, struct ieee80211_sub_if_data *sdata)
int ieee80211_send_smps_action (struct ieee80211_sub_if_data *sdata, enum ieee80211_smps_mode smps, const u8 *da, const u8 *bssid)
int ieee80211_set_arp_filter (struct ieee80211_sub_if_data *sdata)
bool ieee80211_set_channel_type (struct ieee80211_local *local, struct ieee80211_sub_if_data *sdata, enum nl80211_channel_type chantype)
void ieee80211_set_wmm_default (struct ieee80211_sub_if_data *sdata)
void ieee80211_sta_def_wmm_params (struct ieee80211_sub_if_data *sdata, const size_t supp_rates_len, const u8 *supp_rates)
u32 ieee80211_sta_get_rates (struct ieee80211_local *local, struct ieee802_11_elems *elems, enum ieee80211_band band)
void ieee80211_sta_process_chanswitch (struct ieee80211_sub_if_data *sdata, struct ieee80211_channel_sw_ie *sw_elem, struct ieee80211_bss *bss, u64 timestamp)
void ieee80211_sta_quiesce (struct ieee80211_sub_if_data *sdata)
void ieee80211_sta_reset_beacon_monitor (struct ieee80211_sub_if_data *sdata)
void ieee80211_sta_reset_conn_monitor (struct ieee80211_sub_if_data *sdata)
void ieee80211_sta_restart (struct ieee80211_sub_if_data *sdata)
void ieee80211_sta_rx_notify (struct ieee80211_sub_if_data *sdata, struct ieee80211_hdr *hdr)
void ieee80211_sta_rx_queued_mgmt (struct ieee80211_sub_if_data *sdata, struct sk_buff *skb)
void ieee80211_sta_setup_sdata (struct ieee80211_sub_if_data *sdata)
void ieee80211_sta_tear_down_BA_sessions (struct sta_info *sta, bool tx)
void ieee80211_sta_tx_notify (struct ieee80211_sub_if_data *sdata, struct ieee80211_hdr *hdr, bool ack)
void ieee80211_sta_work (struct ieee80211_sub_if_data *sdata)
void ieee80211_start_tx_ba_cb (struct ieee80211_vif *vif, u8 *ra, u16 tid)
void ieee80211_stop_device (struct ieee80211_local *local)
void ieee80211_stop_queue_by_reason (struct ieee80211_hw *hw, int queue, enum queue_stop_reason reason)
void ieee80211_stop_queues_by_reason (struct ieee80211_hw *hw, enum queue_stop_reason reason)
void ieee80211_stop_tx_ba_cb (struct ieee80211_vif *vif, u8 *ra, u8 tid)
netdev_tx_t ieee80211_subif_start_xmit (struct sk_buff *skb, struct net_device *dev)
void ieee80211_tx_ba_session_handle_start (struct sta_info *sta, int tid)
void ieee80211_tx_pending (unsigned long data)
void ieee80211_tx_set_protected (struct ieee80211_tx_data *tx)
void ieee80211_tx_skb (struct ieee80211_sub_if_data *sdata, struct sk_buff *skb)
void ieee80211_wake_queue_by_reason (struct ieee80211_hw *hw, int queue, enum queue_stop_reason reason)
void ieee80211_wake_queues_by_reason (struct ieee80211_hw *hw, enum queue_stop_reason reason)
int ieee80211_wk_cancel_remain_on_channel (struct ieee80211_sub_if_data *sdata, u64 cookie)
int ieee80211_wk_remain_on_channel (struct ieee80211_sub_if_data *sdata, struct ieee80211_channel *chan, enum nl80211_channel_type channel_type, unsigned int duration, u64 *cookie)
void ieee80211_work_init (struct ieee80211_local *local)
void ieee80211_work_purge (struct ieee80211_sub_if_data *sdata)
ieee80211_rx_result ieee80211_work_rx_mgmt (struct ieee80211_sub_if_data *sdata, struct sk_buff *skb)
void ieee80211_xmit (struct ieee80211_sub_if_data *sdata, struct sk_buff *skb)
void ieee802_11_parse_elems (u8 *start, size_t len, struct ieee802_11_elems *elems)
u32 ieee802_11_parse_elems_crc (u8 *start, size_t len, struct ieee802_11_elems *elems, u64 filter, u32 crc)
static struct ieee80211_hw * local_to_hw (struct ieee80211_local *local)
void mac80211_ev_michael_mic_failure (struct ieee80211_sub_if_data *sdata, int keyidx, struct ieee80211_hdr *hdr, const u8 *tsc, gfp_t gfp)
static struct
ieee80211_sub_if_data
vif_to_sdata (struct ieee80211_vif *p)

Variables

void * mac80211_wiphy_privid

Define Documentation

#define AP_MAX_BC_BUFFER   128

Definition at line 37 of file kernel-3.2/ieee80211_i.h.

#define debug_noinline

Definition at line 1368 of file kernel-3.2/ieee80211_i.h.

#define I802_DEBUG_INC (   c)    do { } while (0)

Definition at line 950 of file kernel-3.2/ieee80211_i.h.

#define IEEE80211_DEFAULT_MAX_SP_LEN   IEEE80211_WMM_IE_STA_QOSINFO_SP_ALL

Definition at line 62 of file kernel-3.2/ieee80211_i.h.

Value:
(IEEE80211_WMM_IE_STA_QOSINFO_AC_BK |   \
         IEEE80211_WMM_IE_STA_QOSINFO_AC_BE |   \
         IEEE80211_WMM_IE_STA_QOSINFO_AC_VI |   \
         IEEE80211_WMM_IE_STA_QOSINFO_AC_VO)

Definition at line 56 of file kernel-3.2/ieee80211_i.h.

Definition at line 45 of file kernel-3.2/ieee80211_i.h.

#define IEEE80211_ENCRYPT_TAILROOM   18

Definition at line 46 of file kernel-3.2/ieee80211_i.h.

#define IEEE80211_FRAGMENT_MAX   4

Definition at line 52 of file kernel-3.2/ieee80211_i.h.

#define IEEE80211_IFSTA_MESH_CTR_INC (   msh,
  name 
)    do { } while (0)

Definition at line 532 of file kernel-3.2/ieee80211_i.h.

Definition at line 825 of file kernel-3.2/ieee80211_i.h.

#define IEEE80211_MAX_SUPP_RATES   32

Definition at line 95 of file kernel-3.2/ieee80211_i.h.

#define IEEE80211_TX_PS_BUFFERED   BIT(2)

Definition at line 140 of file kernel-3.2/ieee80211_i.h.

#define IEEE80211_TX_UNICAST   BIT(1)

Definition at line 139 of file kernel-3.2/ieee80211_i.h.

#define PREQ_Q_F_REFRESH   0x2

Definition at line 267 of file kernel-3.2/ieee80211_i.h.

#define PREQ_Q_F_START   0x1

Definition at line 266 of file kernel-3.2/ieee80211_i.h.

#define RX_CONTINUE   ((__force ieee80211_rx_result) 0u)

Definition at line 156 of file kernel-3.2/ieee80211_i.h.

#define RX_DROP_MONITOR   ((__force ieee80211_rx_result) 2u)

Definition at line 158 of file kernel-3.2/ieee80211_i.h.

#define RX_DROP_UNUSABLE   ((__force ieee80211_rx_result) 1u)

Definition at line 157 of file kernel-3.2/ieee80211_i.h.

#define RX_QUEUED   ((__force ieee80211_rx_result) 3u)

Definition at line 159 of file kernel-3.2/ieee80211_i.h.

#define TOTAL_MAX_TX_BUFFER   512

Definition at line 42 of file kernel-3.2/ieee80211_i.h.

#define TU_TO_EXP_TIME (   x)    (jiffies + usecs_to_jiffies((x) * 1024))

Definition at line 54 of file kernel-3.2/ieee80211_i.h.

#define TX_CONTINUE   ((__force ieee80211_tx_result) 0u)

Definition at line 135 of file kernel-3.2/ieee80211_i.h.

#define TX_DROP   ((__force ieee80211_tx_result) 1u)

Definition at line 136 of file kernel-3.2/ieee80211_i.h.

#define TX_QUEUED   ((__force ieee80211_tx_result) 2u)

Definition at line 137 of file kernel-3.2/ieee80211_i.h.


Typedef Documentation

typedef unsigned __bitwise__ ieee80211_rx_result

Definition at line 155 of file kernel-3.2/ieee80211_i.h.

typedef unsigned __bitwise__ ieee80211_tx_result

Definition at line 134 of file kernel-3.2/ieee80211_i.h.


Enumeration Type Documentation

anonymous enum
Enumerator:
IEEE80211_RX_MSG 
IEEE80211_TX_STATUS_MSG 
IEEE80211_EOSP_MSG 

Definition at line 664 of file kernel-3.2/ieee80211_i.h.

anonymous enum

mac80211 scan flags - currently active scan mode

: We're currently in the process of scanning but may as well be on the operating channel : The hardware is scanning for us, we have no way to determine if we are on the operating channel or not : We're off our operating channel for scanning, gets only set in conjunction with SCAN_SW_SCANNING : Set for our scan work function when the driver reported that the scan completed. : Set for our scan work function when the driver reported a scan complete for an aborted scan.

Enumerator:
SCAN_SW_SCANNING 
SCAN_HW_SCANNING 
SCAN_OFF_CHANNEL 
SCAN_COMPLETED 
SCAN_ABORTED 

Definition at line 712 of file kernel-3.2/ieee80211_i.h.

Enumerator:
CHAN_MODE_UNDEFINED 
CHAN_MODE_HOPPING 
CHAN_MODE_FIXED 
CHAN_MODE_UNDEFINED 
CHAN_MODE_HOPPING 
CHAN_MODE_FIXED 

Definition at line 1352 of file kernel-3.2/ieee80211_i.h.

enum ieee80211_packet_rx_flags - packet RX flags : frame is destined to interface currently processed (incl. multicast frames) : received while scanning : fragmented frame : a-MSDU packet : action frame is malformed : frame was subjected to receive reordering

These are per-frame flags that are attached to a frame in the field of &struct ieee80211_rx_status.

Enumerator:
IEEE80211_RX_IN_SCAN 
IEEE80211_RX_RA_MATCH 
IEEE80211_RX_FRAGMENTED 
IEEE80211_RX_AMSDU 
IEEE80211_RX_MALFORMED_ACTION_FRM 
IEEE80211_RX_DEFERRED_RELEASE 
IEEE80211_RX_IN_SCAN 
IEEE80211_RX_RA_MATCH 
IEEE80211_RX_FRAGMENTED 
IEEE80211_RX_AMSDU 
IEEE80211_RX_MALFORMED_ACTION_FRM 
IEEE80211_RX_DEFERRED_RELEASE 

Definition at line 174 of file kernel-3.2/ieee80211_i.h.

enum ieee80211_rx_flags - RX data flags

: received on cooked monitor already

These flags are used across handling multiple interfaces for a single frame.

Enumerator:
IEEE80211_RX_CMNTR 
IEEE80211_RX_CMNTR 
IEEE80211_RX_BEACON_REPORTED 

Definition at line 191 of file kernel-3.2/ieee80211_i.h.

enum ieee80211_sdata_state_bits - virtual interface state bits : virtual interface is up & running; this mirrors netif_running() but is separate for interface type change handling while the interface is up : This interface is currently in offchannel mode, so queues are stopped

Enumerator:
SDATA_STATE_RUNNING 
SDATA_STATE_OFFCHANNEL 
SDATA_STATE_RUNNING 
SDATA_STATE_OFFCHANNEL 

Definition at line 563 of file kernel-3.2/ieee80211_i.h.

Enumerator:
IEEE80211_STA_BEACON_POLL 
IEEE80211_STA_CONNECTION_POLL 
IEEE80211_STA_CONTROL_PORT 
IEEE80211_STA_DISABLE_11N 
IEEE80211_STA_CSA_RECEIVED 
IEEE80211_STA_MFP_ENABLED 
IEEE80211_STA_UAPSD_ENABLED 
IEEE80211_STA_NULLFUNC_ACKED 
IEEE80211_STA_RESET_SIGNAL_AVE 
IEEE80211_STA_BEACON_POLL 
IEEE80211_STA_CONNECTION_POLL 
IEEE80211_STA_CONTROL_PORT 
IEEE80211_STA_DISABLE_11N 
IEEE80211_STA_CSA_RECEIVED 
IEEE80211_STA_MFP_ENABLED 
IEEE80211_STA_UAPSD_ENABLED 
IEEE80211_STA_NULLFUNC_ACKED 
IEEE80211_STA_RESET_SIGNAL_AVE 
IEEE80211_STA_DISABLE_40MHZ 

Definition at line 357 of file kernel-3.2/ieee80211_i.h.

enum ieee80211_sub_if_data_flags - virtual interface flags

: interface wants all multicast packets : interface is promisc : operating in G-only mode : bridge packets between associated stations and deliver multicast frames both back to wireless media and to the local net stack. : Disconnect after resume.

Enumerator:
IEEE80211_SDATA_ALLMULTI 
IEEE80211_SDATA_PROMISC 
IEEE80211_SDATA_OPERATING_GMODE 
IEEE80211_SDATA_DONT_BRIDGE_PACKETS 
IEEE80211_SDATA_DISCONNECT_RESUME 
IEEE80211_SDATA_ALLMULTI 
IEEE80211_SDATA_PROMISC 
IEEE80211_SDATA_OPERATING_GMODE 
IEEE80211_SDATA_DONT_BRIDGE_PACKETS 
IEEE80211_SDATA_DISCONNECT_RESUME 
IEEE80211_SDATA_IN_DRIVER 

Definition at line 547 of file kernel-3.2/ieee80211_i.h.

Enumerator:
IEEE80211_WORK_ABORT 
IEEE80211_WORK_DIRECT_PROBE 
IEEE80211_WORK_AUTH 
IEEE80211_WORK_ASSOC_BEACON_WAIT 
IEEE80211_WORK_ASSOC 
IEEE80211_WORK_REMAIN_ON_CHANNEL 
IEEE80211_WORK_OFFCHANNEL_TX 
IEEE80211_WORK_ABORT 
IEEE80211_WORK_REMAIN_ON_CHANNEL 
IEEE80211_WORK_OFFCHANNEL_TX 

Definition at line 274 of file kernel-3.2/ieee80211_i.h.

enum mac80211_scan_state - scan state machine states

: Main entry point to the scan state machine, this state determines if we should keep on scanning or switch back to the operating channel : Set the next channel to be scanned : Send probe requests and wait for probe responses : Leave the operating channel, notify the AP about us leaving the channel and stop all associated STA interfaces : Enter the operating channel again, notify the AP about us being back and restart all associated STA interfaces

Enumerator:
SCAN_DECISION 
SCAN_SET_CHANNEL 
SCAN_SEND_PROBE 
SCAN_LEAVE_OPER_CHANNEL 
SCAN_ENTER_OPER_CHANNEL 
SCAN_DECISION 
SCAN_SET_CHANNEL 
SCAN_SEND_PROBE 
SCAN_SUSPEND 
SCAN_RESUME 

Definition at line 733 of file kernel-3.2/ieee80211_i.h.

Enumerator:
IEEE80211_QUEUE_STOP_REASON_DRIVER 
IEEE80211_QUEUE_STOP_REASON_PS 
IEEE80211_QUEUE_STOP_REASON_CSA 
IEEE80211_QUEUE_STOP_REASON_AGGREGATION 
IEEE80211_QUEUE_STOP_REASON_SUSPEND 
IEEE80211_QUEUE_STOP_REASON_SKB_ADD 
IEEE80211_QUEUE_STOP_REASON_CHTYPE_CHANGE 
IEEE80211_QUEUE_STOP_REASON_DRIVER 
IEEE80211_QUEUE_STOP_REASON_PS 
IEEE80211_QUEUE_STOP_REASON_CSA 
IEEE80211_QUEUE_STOP_REASON_AGGREGATION 
IEEE80211_QUEUE_STOP_REASON_SUSPEND 
IEEE80211_QUEUE_STOP_REASON_SKB_ADD 

Definition at line 674 of file kernel-3.2/ieee80211_i.h.

Enumerator:
IEEE80211_SDATA_QUEUE_TYPE_FRAME 
IEEE80211_SDATA_QUEUE_AGG_START 
IEEE80211_SDATA_QUEUE_AGG_STOP 
IEEE80211_SDATA_QUEUE_TYPE_FRAME 
IEEE80211_SDATA_QUEUE_AGG_START 
IEEE80211_SDATA_QUEUE_AGG_STOP 

Definition at line 658 of file kernel-3.2/ieee80211_i.h.

enum work_done_result - indicates what to do after work was done

: This work item is no longer needed, destroy. : This work item was reset to be reused, and should be requeued.

Enumerator:
WORK_DONE_DESTROY 
WORK_DONE_REQUEUE 
WORK_DONE_DESTROY 
WORK_DONE_REQUEUE 

Definition at line 291 of file kernel-3.2/ieee80211_i.h.


Function Documentation

void ___ieee80211_stop_rx_ba_session ( struct sta_info sta,
u16  tid,
u16  initiator,
u16  reason,
bool  stop 
)

Definition at line 61 of file kernel-3.2/agg-rx.c.

int ___ieee80211_stop_tx_ba_session ( struct sta_info sta,
u16  tid,
enum ieee80211_back_parties  initiator,
bool  tx 
)

Definition at line 146 of file kernel-3.2/agg-tx.c.

Definition at line 1288 of file kernel-3.2/iface.c.

int __ieee80211_request_smps ( struct ieee80211_sub_if_data sdata,
enum ieee80211_smps_mode  smps_mode 
)

Definition at line 1665 of file kernel-3.2/cfg.c.

static int __ieee80211_resume ( struct ieee80211_hw *  hw) [inline, static]

Definition at line 1251 of file kernel-3.2/ieee80211_i.h.

void __ieee80211_stop_rx_ba_session ( struct sta_info sta,
u16  tid,
u16  initiator,
u16  reason,
bool  stop 
)

Definition at line 97 of file kernel-3.2/agg-rx.c.

int __ieee80211_stop_tx_ba_session ( struct sta_info sta,
u16  tid,
enum ieee80211_back_parties  initiator,
bool  tx 
)

Definition at line 601 of file kernel-3.2/agg-tx.c.

static int __ieee80211_suspend ( struct ieee80211_hw *  hw,
struct cfg80211_wowlan *  wowlan 
) [inline, static]

Definition at line 1245 of file kernel-3.2/ieee80211_i.h.

static u8* bss_mesh_cfg ( struct ieee80211_bss bss) [inline, static]

Definition at line 109 of file kernel-3.2/ieee80211_i.h.

static u8* bss_mesh_id ( struct ieee80211_bss bss) [inline, static]

Definition at line 117 of file kernel-3.2/ieee80211_i.h.

static u8 bss_mesh_id_len ( struct ieee80211_bss bss) [inline, static]

Definition at line 125 of file kernel-3.2/ieee80211_i.h.

void free_work ( struct ieee80211_work wk)

Definition at line 69 of file kernel-3.2/work.c.

static struct ieee80211_local* hw_to_local ( struct ieee80211_hw *  hw) [static, read]

Definition at line 1036 of file kernel-3.2/ieee80211_i.h.

void ieee80211_add_pending_skb ( struct ieee80211_local local,
struct sk_buff skb 
)

Definition at line 351 of file kernel-3.2/util.c.

void ieee80211_add_pending_skbs ( struct ieee80211_local local,
struct sk_buff_head *  skbs 
)

Definition at line 406 of file kernel-3.2/util.c.

void ieee80211_add_pending_skbs_fn ( struct ieee80211_local local,
struct sk_buff_head *  skbs,
void(*)(void *data)  fn,
void *  data 
)

Definition at line 371 of file kernel-3.2/util.c.

void ieee80211_add_work ( struct ieee80211_work wk)

Definition at line 1080 of file kernel-3.2/work.c.

void ieee80211_adjust_monitor_flags ( struct ieee80211_sub_if_data sdata,
const int  offset 
)

Definition at line 152 of file kernel-3.2/iface.c.

void ieee80211_ba_session_work ( struct work_struct *  work)

Definition at line 121 of file kernel-3.2/ht.c.

void ieee80211_beacon_connection_loss_work ( struct work_struct *  work)

Definition at line 1375 of file kernel-3.2/mlme.c.

void ieee80211_bss_info_change_notify ( struct ieee80211_sub_if_data sdata,
u32  changed 
)
struct ieee80211_bss* ieee80211_bss_info_update ( struct ieee80211_local local,
struct ieee80211_rx_status rx_status,
struct ieee80211_mgmt *  mgmt,
size_t  len,
struct ieee802_11_elems elems,
struct ieee80211_channel channel,
bool  beacon 
) [read]

Definition at line 79 of file kernel-3.2/scan.c.

static int ieee80211_bssid_match ( const u8 raddr,
const u8 addr 
) [inline, static]

Definition at line 1049 of file kernel-3.2/ieee80211_i.h.

int ieee80211_build_preq_ies ( struct ieee80211_local local,
u8 buffer,
const u8 ie,
size_t  ie_len,
enum ieee80211_band  band,
u32  rate_mask,
u8  channel 
)

Definition at line 736 of file kernel-3.2/util.c.

struct sk_buff* ieee80211_build_probe_req ( struct ieee80211_sub_if_data sdata,
u8 dst,
u32  ratemask,
const u8 ssid,
size_t  ssid_len,
const u8 ie,
size_t  ie_len,
bool  directed 
) [read]

Definition at line 848 of file kernel-3.2/util.c.

void ieee80211_clear_tx_pending ( struct ieee80211_local local)

Definition at line 2038 of file kernel-3.2/tx.c.

void ieee80211_configure_filter ( struct ieee80211_local local)
static struct ieee80211_sub_if_data* IEEE80211_DEV_TO_SUB_IF ( struct net_device *  dev) [static, read]

Definition at line 1025 of file kernel-3.2/ieee80211_i.h.

void ieee80211_dynamic_ps_disable_work ( struct work_struct *  work)

Definition at line 757 of file kernel-3.2/mlme.c.

void ieee80211_dynamic_ps_enable_work ( struct work_struct *  work)

Definition at line 772 of file kernel-3.2/mlme.c.

void ieee80211_dynamic_ps_timer ( unsigned long  data)

Definition at line 847 of file kernel-3.2/mlme.c.

int ieee80211_frame_duration ( struct ieee80211_local local,
size_t  len,
int  rate,
int  erp,
int  short_preamble 
)

Definition at line 108 of file kernel-3.2/util.c.

u8* ieee80211_get_bssid ( struct ieee80211_hdr hdr,
size_t  len,
enum nl80211_iftype  type 
)

Definition at line 48 of file kernel-3.2/util.c.

Definition at line 48 of file kernel-3.2/chan.c.

void ieee80211_ht_cap_ie_to_sta_ht_cap ( struct ieee80211_supported_band sband,
struct ieee80211_ht_cap *  ht_cap_ie,
struct ieee80211_sta_ht_cap *  ht_cap 
)

Definition at line 22 of file kernel-3.2/ht.c.

int ieee80211_hw_config ( struct ieee80211_local local,
u32  changed 
)
void ieee80211_hw_roc_setup ( struct ieee80211_local local)

Definition at line 290 of file kernel-3.2/offchannel.c.

struct sta_info* ieee80211_ibss_add_sta ( struct ieee80211_sub_if_data sdata,
u8 bssid,
u8 addr,
u32  supp_rates,
gfp_t  gfp 
) [read]

Definition at line 420 of file kernel-3.2/ibss.c.

int ieee80211_ibss_join ( struct ieee80211_sub_if_data sdata,
struct cfg80211_ibss_params *  params 
)

Definition at line 894 of file kernel-3.2/ibss.c.

Definition at line 964 of file kernel-3.2/ibss.c.

Definition at line 878 of file kernel-3.2/ibss.c.

void ieee80211_ibss_rx_queued_mgmt ( struct ieee80211_sub_if_data sdata,
struct sk_buff skb 
)

Definition at line 766 of file kernel-3.2/ibss.c.

Definition at line 868 of file kernel-3.2/ibss.c.

void ieee80211_ibss_work ( struct ieee80211_sub_if_data sdata)

Definition at line 803 of file kernel-3.2/ibss.c.

size_t ieee80211_ie_split ( const u8 ies,
size_t  ielen,
const u8 ids,
int  n_ids,
size_t  offset 
)

ieee80211_ie_split - split an IE buffer according to ordering

: the IE buffer : the length of the IE buffer : an array with element IDs that are allowed before the split : the size of the element ID array : offset where to start splitting in the buffer

This function splits an IE buffer by updating the variable to point to the location where the buffer should be split.

It assumes that the given IE buffer is well-formed, this has to be guaranteed by the caller!

It also assumes that the IEs in the buffer are ordered correctly, if not the result of using this function will not be ordered correctly either, i.e. it does no reordering.

The function returns the offset where the next part of the buffer starts, which may be if the entire (remainder) of the buffer should be used.

Definition at line 1308 of file kernel-3.2/util.c.

size_t ieee80211_ie_split_vendor ( const u8 ies,
size_t  ielen,
size_t  offset 
)

Definition at line 1319 of file kernel-3.2/util.c.

int ieee80211_if_add ( struct ieee80211_local local,
const char *  name,
struct net_device **  new_dev,
enum nl80211_iftype  type,
struct vif_params *  params 
)

Definition at line 1133 of file kernel-3.2/iface.c.

int ieee80211_if_change_type ( struct ieee80211_sub_if_data sdata,
enum nl80211_iftype  type 
)

Definition at line 985 of file kernel-3.2/iface.c.

void ieee80211_if_remove ( struct ieee80211_sub_if_data sdata)

Definition at line 1219 of file kernel-3.2/iface.c.

void ieee80211_iface_exit ( void  )

Definition at line 1417 of file kernel-3.2/iface.c.

int ieee80211_iface_init ( void  )

Definition at line 1412 of file kernel-3.2/iface.c.

u32 ieee80211_mandatory_rates ( struct ieee80211_local local,
enum ieee80211_band  band 
)

Definition at line 668 of file kernel-3.2/util.c.

int ieee80211_max_network_latency ( struct notifier_block *  nb,
unsigned long  data,
void *  dummy 
)

Definition at line 2382 of file kernel-3.2/mlme.c.

void ieee80211_mesh_rx_queued_mgmt ( struct ieee80211_sub_if_data sdata,
struct sk_buff skb 
)

Definition at line 630 of file kernel-3.2/mesh.c.

void ieee80211_mesh_work ( struct ieee80211_sub_if_data sdata)

Definition at line 653 of file kernel-3.2/mesh.c.

int ieee80211_mgd_assoc ( struct ieee80211_sub_if_data sdata,
struct cfg80211_assoc_request *  req 
)

Definition at line 2581 of file kernel-3.2/mlme.c.

int ieee80211_mgd_auth ( struct ieee80211_sub_if_data sdata,
struct cfg80211_auth_request *  req 
)

Definition at line 2429 of file kernel-3.2/mlme.c.

int ieee80211_mgd_deauth ( struct ieee80211_sub_if_data sdata,
struct cfg80211_deauth_request *  req,
void *  cookie 
)

Definition at line 2716 of file kernel-3.2/mlme.c.

int ieee80211_mgd_disassoc ( struct ieee80211_sub_if_data sdata,
struct cfg80211_disassoc_request *  req,
void *  cookie 
)

Definition at line 2805 of file kernel-3.2/mlme.c.

Definition at line 2371 of file kernel-3.2/mlme.c.

netdev_tx_t ieee80211_monitor_start_xmit ( struct sk_buff skb,
struct net_device *  dev 
)

Definition at line 1528 of file kernel-3.2/tx.c.

void ieee80211_offchannel_return ( struct ieee80211_local local,
bool  enable_beaconing 
)

Definition at line 154 of file kernel-3.2/offchannel.c.

Definition at line 99 of file kernel-3.2/offchannel.c.

Definition at line 132 of file kernel-3.2/offchannel.c.

void ieee80211_process_addba_request ( struct ieee80211_local local,
struct sta_info sta,
struct ieee80211_mgmt *  mgmt,
size_t  len 
)

Definition at line 205 of file kernel-3.2/agg-rx.c.

void ieee80211_process_addba_resp ( struct ieee80211_local local,
struct sta_info sta,
struct ieee80211_mgmt *  mgmt,
size_t  len 
)

Definition at line 750 of file kernel-3.2/agg-tx.c.

void ieee80211_process_delba ( struct ieee80211_sub_if_data sdata,
struct sta_info sta,
struct ieee80211_mgmt *  mgmt,
size_t  len 
)

Definition at line 220 of file kernel-3.2/ht.c.

void ieee80211_process_measurement_req ( struct ieee80211_sub_if_data sdata,
struct ieee80211_mgmt *  mgmt,
size_t  len 
)

Definition at line 67 of file kernel-3.2/spectmgmt.c.

void ieee80211_recalc_idle ( struct ieee80211_local local)

Definition at line 1373 of file kernel-3.2/iface.c.

void ieee80211_recalc_ps ( struct ieee80211_local local,
s32  latency 
)

Definition at line 665 of file kernel-3.2/mlme.c.

void ieee80211_recalc_smps ( struct ieee80211_local local)

Definition at line 1232 of file kernel-3.2/util.c.

int ieee80211_reconfig ( struct ieee80211_local local)

Definition at line 965 of file kernel-3.2/util.c.

void ieee80211_release_reorder_timeout ( struct sta_info sta,
int  tid 
)

Definition at line 2710 of file kernel-3.2/rx.c.

void ieee80211_remove_interfaces ( struct ieee80211_local local)

Definition at line 1238 of file kernel-3.2/iface.c.

int ieee80211_request_internal_scan ( struct ieee80211_sub_if_data sdata,
const u8 ssid,
u8  ssid_len,
struct ieee80211_channel chan 
)

Definition at line 744 of file kernel-3.2/scan.c.

int ieee80211_request_scan ( struct ieee80211_sub_if_data sdata,
struct cfg80211_scan_request *  req 
)

Definition at line 732 of file kernel-3.2/scan.c.

int ieee80211_request_sched_scan_start ( struct ieee80211_sub_if_data sdata,
struct cfg80211_sched_scan_request *  req 
)

Definition at line 836 of file kernel-3.2/scan.c.

Definition at line 887 of file kernel-3.2/scan.c.

void ieee80211_request_smps_work ( struct work_struct *  work)

Definition at line 293 of file kernel-3.2/ht.c.

struct ieee80211_bss* ieee80211_rx_bss_get ( struct ieee80211_local local,
u8 bssid,
int  freq,
u8 ssid,
u8  ssid_len 
) [read]

Definition at line 32 of file kernel-3.2/scan.c.

void ieee80211_rx_bss_put ( struct ieee80211_local local,
struct ieee80211_bss bss 
)

Definition at line 53 of file kernel-3.2/scan.c.

void ieee80211_scan_cancel ( struct ieee80211_local local)

Definition at line 794 of file kernel-3.2/scan.c.

ieee80211_rx_result ieee80211_scan_rx ( struct ieee80211_sub_if_data sdata,
struct sk_buff skb 
)

Definition at line 151 of file kernel-3.2/scan.c.

void ieee80211_scan_work ( struct work_struct *  work)

Definition at line 643 of file kernel-3.2/scan.c.

void ieee80211_sched_scan_stopped_work ( struct work_struct *  work)

Definition at line 922 of file kernel-3.2/scan.c.

static bool ieee80211_sdata_running ( struct ieee80211_sub_if_data sdata) [inline, static]

Definition at line 1167 of file kernel-3.2/ieee80211_i.h.

void ieee80211_send_auth ( struct ieee80211_sub_if_data sdata,
u16  transaction,
u16  auth_alg,
u8 extra,
size_t  extra_len,
const u8 bssid,
const u8 key,
u8  key_len,
u8  key_idx 
)

Definition at line 696 of file kernel-3.2/util.c.

void ieee80211_send_delba ( struct ieee80211_sub_if_data sdata,
const u8 da,
u16  tid,
u16  initiator,
u16  reason_code 
)

Definition at line 180 of file kernel-3.2/ht.c.

void ieee80211_send_nullfunc ( struct ieee80211_local local,
struct ieee80211_sub_if_data sdata,
int  powersave 
)

Definition at line 347 of file kernel-3.2/mlme.c.

void ieee80211_send_probe_req ( struct ieee80211_sub_if_data sdata,
u8 dst,
const u8 ssid,
size_t  ssid_len,
const u8 ie,
size_t  ie_len,
u32  ratemask,
bool  directed,
bool  no_cck 
)

Definition at line 901 of file kernel-3.2/util.c.

void ieee80211_send_pspoll ( struct ieee80211_local local,
struct ieee80211_sub_if_data sdata 
)

Definition at line 330 of file kernel-3.2/mlme.c.

int ieee80211_send_smps_action ( struct ieee80211_sub_if_data sdata,
enum ieee80211_smps_mode  smps,
const u8 da,
const u8 bssid 
)

Definition at line 246 of file kernel-3.2/ht.c.

bool ieee80211_set_channel_type ( struct ieee80211_local local,
struct ieee80211_sub_if_data sdata,
enum nl80211_channel_type  chantype 
)

Definition at line 60 of file kernel-3.2/chan.c.

Definition at line 573 of file kernel-3.2/util.c.

void ieee80211_sta_def_wmm_params ( struct ieee80211_sub_if_data sdata,
const size_t  supp_rates_len,
const u8 supp_rates 
)

Definition at line 647 of file kernel-3.2/util.c.

u32 ieee80211_sta_get_rates ( struct ieee80211_local local,
struct ieee802_11_elems elems,
enum ieee80211_band  band 
)

Definition at line 918 of file kernel-3.2/util.c.

void ieee80211_sta_process_chanswitch ( struct ieee80211_sub_if_data sdata,
struct ieee80211_channel_sw_ie *  sw_elem,
struct ieee80211_bss bss,
u64  timestamp 
)

Definition at line 472 of file kernel-3.2/mlme.c.

void ieee80211_sta_quiesce ( struct ieee80211_sub_if_data sdata)

Definition at line 128 of file kernel-3.2/mlme.c.

Definition at line 137 of file kernel-3.2/mlme.c.

void ieee80211_sta_restart ( struct ieee80211_sub_if_data sdata)
void ieee80211_sta_rx_notify ( struct ieee80211_sub_if_data sdata,
struct ieee80211_hdr hdr 
)

Definition at line 1157 of file kernel-3.2/mlme.c.

void ieee80211_sta_rx_queued_mgmt ( struct ieee80211_sub_if_data sdata,
struct sk_buff skb 
)

Definition at line 2001 of file kernel-3.2/mlme.c.

Definition at line 2341 of file kernel-3.2/mlme.c.

void ieee80211_sta_tear_down_BA_sessions ( struct sta_info sta,
bool  tx 
)

Definition at line 108 of file kernel-3.2/ht.c.

void ieee80211_sta_tx_notify ( struct ieee80211_sub_if_data sdata,
struct ieee80211_hdr hdr,
bool  ack 
)

Definition at line 1203 of file kernel-3.2/mlme.c.

void ieee80211_sta_work ( struct ieee80211_sub_if_data sdata)

Definition at line 2144 of file kernel-3.2/mlme.c.

void ieee80211_start_tx_ba_cb ( struct ieee80211_vif *  vif,
u8 ra,
u16  tid 
)

Definition at line 532 of file kernel-3.2/agg-tx.c.

void ieee80211_stop_device ( struct ieee80211_local local)

Definition at line 954 of file kernel-3.2/util.c.

void ieee80211_stop_queue_by_reason ( struct ieee80211_hw *  hw,
int  queue,
enum queue_stop_reason  reason 
)

Definition at line 333 of file kernel-3.2/util.c.

void ieee80211_stop_queues_by_reason ( struct ieee80211_hw *  hw,
enum queue_stop_reason  reason 
)

Definition at line 412 of file kernel-3.2/util.c.

void ieee80211_stop_tx_ba_cb ( struct ieee80211_vif *  vif,
u8 ra,
u8  tid 
)

Definition at line 655 of file kernel-3.2/agg-tx.c.

netdev_tx_t ieee80211_subif_start_xmit ( struct sk_buff skb,
struct net_device *  dev 
)

ieee80211_subif_start_xmit - netif start_xmit function for Ethernet-type subinterfaces (wlan#, WDS, and VLAN interfaces) : packet to be sent : incoming interface

Returns: 0 on success (and frees skb in this case) or 1 on failure (skb will not be freed, and caller is responsible for either retrying later or freeing skb).

This function takes in an Ethernet header and encapsulates it with suitable IEEE 802.11 header based on which interface the packet is coming in. The encapsulated packet will then be passed to master interface, wlan#.11, for transmission (through low-level driver).

Definition at line 1671 of file kernel-3.2/tx.c.

void ieee80211_tx_ba_session_handle_start ( struct sta_info sta,
int  tid 
)

Definition at line 338 of file kernel-3.2/agg-tx.c.

void ieee80211_tx_pending ( unsigned long  data)

Definition at line 2077 of file kernel-3.2/tx.c.

Definition at line 97 of file kernel-3.2/util.c.

void ieee80211_tx_skb ( struct ieee80211_sub_if_data sdata,
struct sk_buff skb 
)

Definition at line 2570 of file kernel-3.2/tx.c.

void ieee80211_wake_queue_by_reason ( struct ieee80211_hw *  hw,
int  queue,
enum queue_stop_reason  reason 
)

Definition at line 296 of file kernel-3.2/util.c.

void ieee80211_wake_queues_by_reason ( struct ieee80211_hw *  hw,
enum queue_stop_reason  reason 
)

Definition at line 450 of file kernel-3.2/util.c.

int ieee80211_wk_cancel_remain_on_channel ( struct ieee80211_sub_if_data sdata,
u64  cookie 
)

Definition at line 1222 of file kernel-3.2/work.c.

int ieee80211_wk_remain_on_channel ( struct ieee80211_sub_if_data sdata,
struct ieee80211_channel chan,
enum nl80211_channel_type  channel_type,
unsigned int  duration,
u64 cookie 
)

Definition at line 1196 of file kernel-3.2/work.c.

void ieee80211_work_init ( struct ieee80211_local local)

Definition at line 1106 of file kernel-3.2/work.c.

void ieee80211_work_purge ( struct ieee80211_sub_if_data sdata)

Definition at line 1115 of file kernel-3.2/work.c.

Definition at line 1146 of file kernel-3.2/work.c.

void ieee80211_xmit ( struct ieee80211_sub_if_data sdata,
struct sk_buff skb 
)

Definition at line 1404 of file kernel-3.2/tx.c.

void ieee802_11_parse_elems ( u8 start,
size_t  len,
struct ieee802_11_elems elems 
)

Definition at line 567 of file kernel-3.2/util.c.

u32 ieee802_11_parse_elems_crc ( u8 start,
size_t  len,
struct ieee802_11_elems elems,
u64  filter,
u32  crc 
)

Definition at line 604 of file kernel-3.5/util.c.

static struct ieee80211_hw* local_to_hw ( struct ieee80211_local local) [static, read]

Definition at line 1042 of file kernel-3.2/ieee80211_i.h.

void mac80211_ev_michael_mic_failure ( struct ieee80211_sub_if_data sdata,
int  keyidx,
struct ieee80211_hdr hdr,
const u8 tsc,
gfp_t  gfp 
)

Definition at line 18 of file kernel-3.2/event.c.

static struct ieee80211_sub_if_data* vif_to_sdata ( struct ieee80211_vif *  p) [static, read]

Definition at line 653 of file kernel-3.2/ieee80211_i.h.


Variable Documentation

Definition at line 36 of file kernel-3.2/util.c.



ros_rt_wmp
Author(s): Danilo Tardioli, dantard@unizar.es
autogenerated on Mon Oct 6 2014 08:27:12