2 * Copyright (c) 2008-2011 Atheros Communications Inc.
4 * Permission to use, copy, modify, and/or distribute this software for any
5 * purpose with or without fee is hereby granted, provided that the above
6 * copyright notice and this permission notice appear in all copies.
8 * THE SOFTWARE IS PROVIDED "AS IS" AND THE AUTHOR DISCLAIMS ALL WARRANTIES
9 * WITH REGARD TO THIS SOFTWARE INCLUDING ALL IMPLIED WARRANTIES OF
10 * MERCHANTABILITY AND FITNESS. IN NO EVENT SHALL THE AUTHOR BE LIABLE FOR
11 * ANY SPECIAL, DIRECT, INDIRECT, OR CONSEQUENTIAL DAMAGES OR ANY DAMAGES
12 * WHATSOEVER RESULTING FROM LOSS OF USE, DATA OR PROFITS, WHETHER IN AN
13 * ACTION OF CONTRACT, NEGLIGENCE OR OTHER TORTIOUS ACTION, ARISING OUT OF
14 * OR IN CONNECTION WITH THE USE OR PERFORMANCE OF THIS SOFTWARE.
17 #include <linux/nl80211.h>
18 #include <linux/delay.h>
22 static u8 parse_mpdudensity(u8 mpdudensity)
25 * 802.11n D2.0 defined values for "Minimum MPDU Start Spacing":
26 * 0 for no restriction
35 switch (mpdudensity) {
41 /* Our lower layer calculations limit our precision to
57 static bool ath9k_has_pending_frames(struct ath_softc *sc, struct ath_txq *txq)
61 spin_lock_bh(&txq->axq_lock);
63 if (txq->axq_depth || !list_empty(&txq->axq_acq))
66 spin_unlock_bh(&txq->axq_lock);
70 static bool ath9k_setpower(struct ath_softc *sc, enum ath9k_power_mode mode)
75 spin_lock_irqsave(&sc->sc_pm_lock, flags);
76 ret = ath9k_hw_setpower(sc->sc_ah, mode);
77 spin_unlock_irqrestore(&sc->sc_pm_lock, flags);
82 void ath9k_ps_wakeup(struct ath_softc *sc)
84 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
86 enum ath9k_power_mode power_mode;
88 spin_lock_irqsave(&sc->sc_pm_lock, flags);
89 if (++sc->ps_usecount != 1)
92 power_mode = sc->sc_ah->power_mode;
93 ath9k_hw_setpower(sc->sc_ah, ATH9K_PM_AWAKE);
96 * While the hardware is asleep, the cycle counters contain no
97 * useful data. Better clear them now so that they don't mess up
98 * survey data results.
100 if (power_mode != ATH9K_PM_AWAKE) {
101 spin_lock(&common->cc_lock);
102 ath_hw_cycle_counters_update(common);
103 memset(&common->cc_survey, 0, sizeof(common->cc_survey));
104 spin_unlock(&common->cc_lock);
108 spin_unlock_irqrestore(&sc->sc_pm_lock, flags);
111 void ath9k_ps_restore(struct ath_softc *sc)
113 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
116 spin_lock_irqsave(&sc->sc_pm_lock, flags);
117 if (--sc->ps_usecount != 0)
120 spin_lock(&common->cc_lock);
121 ath_hw_cycle_counters_update(common);
122 spin_unlock(&common->cc_lock);
125 ath9k_hw_setpower(sc->sc_ah, ATH9K_PM_FULL_SLEEP);
126 else if (sc->ps_enabled &&
127 !(sc->ps_flags & (PS_WAIT_FOR_BEACON |
129 PS_WAIT_FOR_PSPOLL_DATA |
130 PS_WAIT_FOR_TX_ACK)))
131 ath9k_hw_setpower(sc->sc_ah, ATH9K_PM_NETWORK_SLEEP);
134 spin_unlock_irqrestore(&sc->sc_pm_lock, flags);
137 void ath_start_ani(struct ath_common *common)
139 struct ath_hw *ah = common->ah;
140 unsigned long timestamp = jiffies_to_msecs(jiffies);
141 struct ath_softc *sc = (struct ath_softc *) common->priv;
143 if (!(sc->sc_flags & SC_OP_ANI_RUN))
146 if (sc->sc_flags & SC_OP_OFFCHANNEL)
149 common->ani.longcal_timer = timestamp;
150 common->ani.shortcal_timer = timestamp;
151 common->ani.checkani_timer = timestamp;
153 mod_timer(&common->ani.timer,
155 msecs_to_jiffies((u32)ah->config.ani_poll_interval));
158 static void ath_update_survey_nf(struct ath_softc *sc, int channel)
160 struct ath_hw *ah = sc->sc_ah;
161 struct ath9k_channel *chan = &ah->channels[channel];
162 struct survey_info *survey = &sc->survey[channel];
164 if (chan->noisefloor) {
165 survey->filled |= SURVEY_INFO_NOISE_DBM;
166 survey->noise = chan->noisefloor;
171 * Updates the survey statistics and returns the busy time since last
172 * update in %, if the measurement duration was long enough for the
173 * result to be useful, -1 otherwise.
175 static int ath_update_survey_stats(struct ath_softc *sc)
177 struct ath_hw *ah = sc->sc_ah;
178 struct ath_common *common = ath9k_hw_common(ah);
179 int pos = ah->curchan - &ah->channels[0];
180 struct survey_info *survey = &sc->survey[pos];
181 struct ath_cycle_counters *cc = &common->cc_survey;
182 unsigned int div = common->clockrate * 1000;
188 if (ah->power_mode == ATH9K_PM_AWAKE)
189 ath_hw_cycle_counters_update(common);
191 if (cc->cycles > 0) {
192 survey->filled |= SURVEY_INFO_CHANNEL_TIME |
193 SURVEY_INFO_CHANNEL_TIME_BUSY |
194 SURVEY_INFO_CHANNEL_TIME_RX |
195 SURVEY_INFO_CHANNEL_TIME_TX;
196 survey->channel_time += cc->cycles / div;
197 survey->channel_time_busy += cc->rx_busy / div;
198 survey->channel_time_rx += cc->rx_frame / div;
199 survey->channel_time_tx += cc->tx_frame / div;
202 if (cc->cycles < div)
206 ret = cc->rx_busy * 100 / cc->cycles;
208 memset(cc, 0, sizeof(*cc));
210 ath_update_survey_nf(sc, pos);
216 * Set/change channels. If the channel is really being changed, it's done
217 * by reseting the chip. To accomplish this we must first cleanup any pending
218 * DMA, then restart stuff.
220 static int ath_set_channel(struct ath_softc *sc, struct ieee80211_hw *hw,
221 struct ath9k_channel *hchan)
223 struct ath_hw *ah = sc->sc_ah;
224 struct ath_common *common = ath9k_hw_common(ah);
225 struct ieee80211_conf *conf = &common->hw->conf;
226 bool fastcc = true, stopped;
227 struct ieee80211_channel *channel = hw->conf.channel;
228 struct ath9k_hw_cal_data *caldata = NULL;
231 if (sc->sc_flags & SC_OP_INVALID)
234 sc->hw_busy_count = 0;
236 del_timer_sync(&common->ani.timer);
237 cancel_work_sync(&sc->paprd_work);
238 cancel_work_sync(&sc->hw_check_work);
239 cancel_delayed_work_sync(&sc->tx_complete_work);
240 cancel_delayed_work_sync(&sc->hw_pll_work);
244 spin_lock_bh(&sc->sc_pcu_lock);
247 * This is only performed if the channel settings have
250 * To switch channels clear any pending DMA operations;
251 * wait long enough for the RX fifo to drain, reset the
252 * hardware at the new frequency, and then re-enable
253 * the relevant bits of the h/w.
255 ath9k_hw_disable_interrupts(ah);
256 stopped = ath_drain_all_txq(sc, false);
258 if (!ath_stoprecv(sc))
261 if (!ath9k_hw_check_alive(ah))
264 /* XXX: do not flush receive queue here. We don't want
265 * to flush data frames already in queue because of
266 * changing channel. */
268 if (!stopped || !(sc->sc_flags & SC_OP_OFFCHANNEL))
271 if (!(sc->sc_flags & SC_OP_OFFCHANNEL))
272 caldata = &sc->caldata;
274 ath_dbg(common, ATH_DBG_CONFIG,
275 "(%u MHz) -> (%u MHz), conf_is_ht40: %d fastcc: %d\n",
276 sc->sc_ah->curchan->channel,
277 channel->center_freq, conf_is_ht40(conf),
280 r = ath9k_hw_reset(ah, hchan, caldata, fastcc);
283 "Unable to reset channel (%u MHz), reset status %d\n",
284 channel->center_freq, r);
288 if (ath_startrecv(sc) != 0) {
289 ath_err(common, "Unable to restart recv logic\n");
294 ath9k_cmn_update_txpow(ah, sc->curtxpow,
295 sc->config.txpowlimit, &sc->curtxpow);
296 ath9k_hw_set_interrupts(ah, ah->imask);
298 if (!(sc->sc_flags & (SC_OP_OFFCHANNEL))) {
299 if (sc->sc_flags & SC_OP_BEACONS)
301 ieee80211_queue_delayed_work(sc->hw, &sc->tx_complete_work, 0);
302 ieee80211_queue_delayed_work(sc->hw, &sc->hw_pll_work, HZ/2);
303 if (!common->disable_ani)
304 ath_start_ani(common);
308 ieee80211_wake_queues(hw);
310 spin_unlock_bh(&sc->sc_pcu_lock);
312 ath9k_ps_restore(sc);
316 static void ath_paprd_activate(struct ath_softc *sc)
318 struct ath_hw *ah = sc->sc_ah;
319 struct ath9k_hw_cal_data *caldata = ah->caldata;
320 struct ath_common *common = ath9k_hw_common(ah);
323 if (!caldata || !caldata->paprd_done)
327 ar9003_paprd_enable(ah, false);
328 for (chain = 0; chain < AR9300_MAX_CHAINS; chain++) {
329 if (!(common->tx_chainmask & BIT(chain)))
332 ar9003_paprd_populate_single_table(ah, caldata, chain);
335 ar9003_paprd_enable(ah, true);
336 ath9k_ps_restore(sc);
339 static bool ath_paprd_send_frame(struct ath_softc *sc, struct sk_buff *skb, int chain)
341 struct ieee80211_hw *hw = sc->hw;
342 struct ieee80211_tx_info *tx_info = IEEE80211_SKB_CB(skb);
343 struct ath_hw *ah = sc->sc_ah;
344 struct ath_common *common = ath9k_hw_common(ah);
345 struct ath_tx_control txctl;
348 memset(&txctl, 0, sizeof(txctl));
349 txctl.txq = sc->tx.txq_map[WME_AC_BE];
351 memset(tx_info, 0, sizeof(*tx_info));
352 tx_info->band = hw->conf.channel->band;
353 tx_info->flags |= IEEE80211_TX_CTL_NO_ACK;
354 tx_info->control.rates[0].idx = 0;
355 tx_info->control.rates[0].count = 1;
356 tx_info->control.rates[0].flags = IEEE80211_TX_RC_MCS;
357 tx_info->control.rates[1].idx = -1;
359 init_completion(&sc->paprd_complete);
360 txctl.paprd = BIT(chain);
362 if (ath_tx_start(hw, skb, &txctl) != 0) {
363 ath_dbg(common, ATH_DBG_CALIBRATE, "PAPRD TX failed\n");
364 dev_kfree_skb_any(skb);
368 time_left = wait_for_completion_timeout(&sc->paprd_complete,
369 msecs_to_jiffies(ATH_PAPRD_TIMEOUT));
372 ath_dbg(common, ATH_DBG_CALIBRATE,
373 "Timeout waiting for paprd training on TX chain %d\n",
379 void ath_paprd_calibrate(struct work_struct *work)
381 struct ath_softc *sc = container_of(work, struct ath_softc, paprd_work);
382 struct ieee80211_hw *hw = sc->hw;
383 struct ath_hw *ah = sc->sc_ah;
384 struct ieee80211_hdr *hdr;
385 struct sk_buff *skb = NULL;
386 struct ath9k_hw_cal_data *caldata = ah->caldata;
387 struct ath_common *common = ath9k_hw_common(ah);
398 if (ar9003_paprd_init_table(ah) < 0)
401 skb = alloc_skb(len, GFP_KERNEL);
406 memset(skb->data, 0, len);
407 hdr = (struct ieee80211_hdr *)skb->data;
408 ftype = IEEE80211_FTYPE_DATA | IEEE80211_STYPE_NULLFUNC;
409 hdr->frame_control = cpu_to_le16(ftype);
410 hdr->duration_id = cpu_to_le16(10);
411 memcpy(hdr->addr1, hw->wiphy->perm_addr, ETH_ALEN);
412 memcpy(hdr->addr2, hw->wiphy->perm_addr, ETH_ALEN);
413 memcpy(hdr->addr3, hw->wiphy->perm_addr, ETH_ALEN);
415 for (chain = 0; chain < AR9300_MAX_CHAINS; chain++) {
416 if (!(common->tx_chainmask & BIT(chain)))
421 ath_dbg(common, ATH_DBG_CALIBRATE,
422 "Sending PAPRD frame for thermal measurement "
423 "on chain %d\n", chain);
424 if (!ath_paprd_send_frame(sc, skb, chain))
427 ar9003_paprd_setup_gain_table(ah, chain);
429 ath_dbg(common, ATH_DBG_CALIBRATE,
430 "Sending PAPRD training frame on chain %d\n", chain);
431 if (!ath_paprd_send_frame(sc, skb, chain))
434 if (!ar9003_paprd_is_done(ah)) {
435 ath_dbg(common, ATH_DBG_CALIBRATE,
436 "PAPRD not yet done on chain %d\n", chain);
440 if (ar9003_paprd_create_curve(ah, caldata, chain)) {
441 ath_dbg(common, ATH_DBG_CALIBRATE,
442 "PAPRD create curve failed on chain %d\n",
452 caldata->paprd_done = true;
453 ath_paprd_activate(sc);
457 ath9k_ps_restore(sc);
461 * This routine performs the periodic noise floor calibration function
462 * that is used to adjust and optimize the chip performance. This
463 * takes environmental changes (location, temperature) into account.
464 * When the task is complete, it reschedules itself depending on the
465 * appropriate interval that was calculated.
467 void ath_ani_calibrate(unsigned long data)
469 struct ath_softc *sc = (struct ath_softc *)data;
470 struct ath_hw *ah = sc->sc_ah;
471 struct ath_common *common = ath9k_hw_common(ah);
472 bool longcal = false;
473 bool shortcal = false;
474 bool aniflag = false;
475 unsigned int timestamp = jiffies_to_msecs(jiffies);
476 u32 cal_interval, short_cal_interval, long_cal_interval;
479 if (ah->caldata && ah->caldata->nfcal_interference)
480 long_cal_interval = ATH_LONG_CALINTERVAL_INT;
482 long_cal_interval = ATH_LONG_CALINTERVAL;
484 short_cal_interval = (ah->opmode == NL80211_IFTYPE_AP) ?
485 ATH_AP_SHORT_CALINTERVAL : ATH_STA_SHORT_CALINTERVAL;
487 /* Only calibrate if awake */
488 if (sc->sc_ah->power_mode != ATH9K_PM_AWAKE)
493 /* Long calibration runs independently of short calibration. */
494 if ((timestamp - common->ani.longcal_timer) >= long_cal_interval) {
496 ath_dbg(common, ATH_DBG_ANI, "longcal @%lu\n", jiffies);
497 common->ani.longcal_timer = timestamp;
500 /* Short calibration applies only while caldone is false */
501 if (!common->ani.caldone) {
502 if ((timestamp - common->ani.shortcal_timer) >= short_cal_interval) {
504 ath_dbg(common, ATH_DBG_ANI,
505 "shortcal @%lu\n", jiffies);
506 common->ani.shortcal_timer = timestamp;
507 common->ani.resetcal_timer = timestamp;
510 if ((timestamp - common->ani.resetcal_timer) >=
511 ATH_RESTART_CALINTERVAL) {
512 common->ani.caldone = ath9k_hw_reset_calvalid(ah);
513 if (common->ani.caldone)
514 common->ani.resetcal_timer = timestamp;
518 /* Verify whether we must check ANI */
519 if ((timestamp - common->ani.checkani_timer) >=
520 ah->config.ani_poll_interval) {
522 common->ani.checkani_timer = timestamp;
525 /* Call ANI routine if necessary */
527 spin_lock_irqsave(&common->cc_lock, flags);
528 ath9k_hw_ani_monitor(ah, ah->curchan);
529 ath_update_survey_stats(sc);
530 spin_unlock_irqrestore(&common->cc_lock, flags);
533 /* Perform calibration if necessary */
534 if (longcal || shortcal) {
535 common->ani.caldone =
536 ath9k_hw_calibrate(ah, ah->curchan,
537 common->rx_chainmask, longcal);
540 ath9k_ps_restore(sc);
544 * Set timer interval based on previous results.
545 * The interval must be the shortest necessary to satisfy ANI,
546 * short calibration and long calibration.
548 cal_interval = ATH_LONG_CALINTERVAL;
549 if (sc->sc_ah->config.enable_ani)
550 cal_interval = min(cal_interval,
551 (u32)ah->config.ani_poll_interval);
552 if (!common->ani.caldone)
553 cal_interval = min(cal_interval, (u32)short_cal_interval);
555 mod_timer(&common->ani.timer, jiffies + msecs_to_jiffies(cal_interval));
556 if ((sc->sc_ah->caps.hw_caps & ATH9K_HW_CAP_PAPRD) && ah->caldata) {
557 if (!ah->caldata->paprd_done)
558 ieee80211_queue_work(sc->hw, &sc->paprd_work);
559 else if (!ah->paprd_table_write_done)
560 ath_paprd_activate(sc);
564 static void ath_node_attach(struct ath_softc *sc, struct ieee80211_sta *sta)
567 struct ath_hw *ah = sc->sc_ah;
568 an = (struct ath_node *)sta->drv_priv;
570 #ifdef CONFIG_ATH9K_DEBUGFS
571 spin_lock(&sc->nodes_lock);
572 list_add(&an->list, &sc->nodes);
573 spin_unlock(&sc->nodes_lock);
576 if ((ah->caps.hw_caps) & ATH9K_HW_CAP_APM)
577 sc->sc_flags |= SC_OP_ENABLE_APM;
579 if (sc->sc_flags & SC_OP_TXAGGR) {
580 ath_tx_node_init(sc, an);
581 an->maxampdu = 1 << (IEEE80211_HT_MAX_AMPDU_FACTOR +
582 sta->ht_cap.ampdu_factor);
583 an->mpdudensity = parse_mpdudensity(sta->ht_cap.ampdu_density);
587 static void ath_node_detach(struct ath_softc *sc, struct ieee80211_sta *sta)
589 struct ath_node *an = (struct ath_node *)sta->drv_priv;
591 #ifdef CONFIG_ATH9K_DEBUGFS
592 spin_lock(&sc->nodes_lock);
594 spin_unlock(&sc->nodes_lock);
598 if (sc->sc_flags & SC_OP_TXAGGR)
599 ath_tx_node_cleanup(sc, an);
602 void ath_hw_check(struct work_struct *work)
604 struct ath_softc *sc = container_of(work, struct ath_softc, hw_check_work);
605 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
610 if (ath9k_hw_check_alive(sc->sc_ah))
613 spin_lock_irqsave(&common->cc_lock, flags);
614 busy = ath_update_survey_stats(sc);
615 spin_unlock_irqrestore(&common->cc_lock, flags);
617 ath_dbg(common, ATH_DBG_RESET, "Possible baseband hang, "
618 "busy=%d (try %d)\n", busy, sc->hw_busy_count + 1);
620 if (++sc->hw_busy_count >= 3)
622 } else if (busy >= 0)
623 sc->hw_busy_count = 0;
626 ath9k_ps_restore(sc);
629 static void ath_hw_pll_rx_hang_check(struct ath_softc *sc, u32 pll_sqsum)
632 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
634 if (pll_sqsum >= 0x40000) {
637 /* Rx is hung for more than 500ms. Reset it */
638 ath_dbg(common, ATH_DBG_RESET,
639 "Possible RX hang, resetting");
647 void ath_hw_pll_work(struct work_struct *work)
649 struct ath_softc *sc = container_of(work, struct ath_softc,
653 if (AR_SREV_9485(sc->sc_ah)) {
656 pll_sqsum = ar9003_get_pll_sqsum_dvc(sc->sc_ah);
657 ath9k_ps_restore(sc);
659 ath_hw_pll_rx_hang_check(sc, pll_sqsum);
661 ieee80211_queue_delayed_work(sc->hw, &sc->hw_pll_work, HZ/5);
666 void ath9k_tasklet(unsigned long data)
668 struct ath_softc *sc = (struct ath_softc *)data;
669 struct ath_hw *ah = sc->sc_ah;
670 struct ath_common *common = ath9k_hw_common(ah);
672 u32 status = sc->intrstatus;
675 if ((status & ATH9K_INT_FATAL) ||
676 (status & ATH9K_INT_BB_WATCHDOG)) {
682 spin_lock(&sc->sc_pcu_lock);
685 * Only run the baseband hang check if beacons stop working in AP or
686 * IBSS mode, because it has a high false positive rate. For station
687 * mode it should not be necessary, since the upper layers will detect
688 * this through a beacon miss automatically and the following channel
689 * change will trigger a hardware reset anyway
691 if (ath9k_hw_numtxpending(ah, sc->beacon.beaconq) != 0 &&
692 !ath9k_hw_check_alive(ah))
693 ieee80211_queue_work(sc->hw, &sc->hw_check_work);
695 if ((status & ATH9K_INT_TSFOOR) && sc->ps_enabled) {
697 * TSF sync does not look correct; remain awake to sync with
700 ath_dbg(common, ATH_DBG_PS,
701 "TSFOOR - Sync with next Beacon\n");
702 sc->ps_flags |= PS_WAIT_FOR_BEACON | PS_BEACON_SYNC |
706 if (ah->caps.hw_caps & ATH9K_HW_CAP_EDMA)
707 rxmask = (ATH9K_INT_RXHP | ATH9K_INT_RXLP | ATH9K_INT_RXEOL |
710 rxmask = (ATH9K_INT_RX | ATH9K_INT_RXEOL | ATH9K_INT_RXORN);
712 if (status & rxmask) {
713 /* Check for high priority Rx first */
714 if ((ah->caps.hw_caps & ATH9K_HW_CAP_EDMA) &&
715 (status & ATH9K_INT_RXHP))
716 ath_rx_tasklet(sc, 0, true);
718 ath_rx_tasklet(sc, 0, false);
721 if (status & ATH9K_INT_TX) {
722 if (ah->caps.hw_caps & ATH9K_HW_CAP_EDMA)
723 ath_tx_edma_tasklet(sc);
728 if (ah->btcoex_hw.scheme == ATH_BTCOEX_CFG_3WIRE)
729 if (status & ATH9K_INT_GENTIMER)
730 ath_gen_timer_isr(sc->sc_ah);
732 /* re-enable hardware interrupt */
733 ath9k_hw_enable_interrupts(ah);
735 spin_unlock(&sc->sc_pcu_lock);
736 ath9k_ps_restore(sc);
739 irqreturn_t ath_isr(int irq, void *dev)
741 #define SCHED_INTR ( \
743 ATH9K_INT_BB_WATCHDOG | \
755 struct ath_softc *sc = dev;
756 struct ath_hw *ah = sc->sc_ah;
757 struct ath_common *common = ath9k_hw_common(ah);
758 enum ath9k_int status;
762 * The hardware is not ready/present, don't
763 * touch anything. Note this can happen early
764 * on if the IRQ is shared.
766 if (sc->sc_flags & SC_OP_INVALID)
770 /* shared irq, not for us */
772 if (!ath9k_hw_intrpend(ah))
776 * Figure out the reason(s) for the interrupt. Note
777 * that the hal returns a pseudo-ISR that may include
778 * bits we haven't explicitly enabled so we mask the
779 * value to insure we only process bits we requested.
781 ath9k_hw_getisr(ah, &status); /* NB: clears ISR too */
782 status &= ah->imask; /* discard unasked-for bits */
785 * If there are no status bits set, then this interrupt was not
786 * for me (should have been caught above).
791 /* Cache the status */
792 sc->intrstatus = status;
794 if (status & SCHED_INTR)
798 * If a FATAL or RXORN interrupt is received, we have to reset the
801 if ((status & ATH9K_INT_FATAL) || ((status & ATH9K_INT_RXORN) &&
802 !(ah->caps.hw_caps & ATH9K_HW_CAP_EDMA)))
805 if ((ah->caps.hw_caps & ATH9K_HW_CAP_EDMA) &&
806 (status & ATH9K_INT_BB_WATCHDOG)) {
808 spin_lock(&common->cc_lock);
809 ath_hw_cycle_counters_update(common);
810 ar9003_hw_bb_watchdog_dbg_info(ah);
811 spin_unlock(&common->cc_lock);
816 if (status & ATH9K_INT_SWBA)
817 tasklet_schedule(&sc->bcon_tasklet);
819 if (status & ATH9K_INT_TXURN)
820 ath9k_hw_updatetxtriglevel(ah, true);
822 if (ah->caps.hw_caps & ATH9K_HW_CAP_EDMA) {
823 if (status & ATH9K_INT_RXEOL) {
824 ah->imask &= ~(ATH9K_INT_RXEOL | ATH9K_INT_RXORN);
825 ath9k_hw_set_interrupts(ah, ah->imask);
829 if (status & ATH9K_INT_MIB) {
831 * Disable interrupts until we service the MIB
832 * interrupt; otherwise it will continue to
835 ath9k_hw_disable_interrupts(ah);
837 * Let the hal handle the event. We assume
838 * it will clear whatever condition caused
841 spin_lock(&common->cc_lock);
842 ath9k_hw_proc_mib_event(ah);
843 spin_unlock(&common->cc_lock);
844 ath9k_hw_enable_interrupts(ah);
847 if (!(ah->caps.hw_caps & ATH9K_HW_CAP_AUTOSLEEP))
848 if (status & ATH9K_INT_TIM_TIMER) {
849 if (ATH_DBG_WARN_ON_ONCE(sc->ps_idle))
851 /* Clear RxAbort bit so that we can
853 ath9k_setpower(sc, ATH9K_PM_AWAKE);
854 ath9k_hw_setrxabort(sc->sc_ah, 0);
855 sc->ps_flags |= PS_WAIT_FOR_BEACON;
860 ath_debug_stat_interrupt(sc, status);
863 /* turn off every interrupt */
864 ath9k_hw_disable_interrupts(ah);
865 tasklet_schedule(&sc->intr_tq);
873 static void ath_radio_enable(struct ath_softc *sc, struct ieee80211_hw *hw)
875 struct ath_hw *ah = sc->sc_ah;
876 struct ath_common *common = ath9k_hw_common(ah);
877 struct ieee80211_channel *channel = hw->conf.channel;
881 spin_lock_bh(&sc->sc_pcu_lock);
883 ath9k_hw_configpcipowersave(ah, 0, 0);
886 ah->curchan = ath9k_cmn_get_curchannel(sc->hw, ah);
888 r = ath9k_hw_reset(ah, ah->curchan, ah->caldata, false);
891 "Unable to reset channel (%u MHz), reset status %d\n",
892 channel->center_freq, r);
895 ath9k_cmn_update_txpow(ah, sc->curtxpow,
896 sc->config.txpowlimit, &sc->curtxpow);
897 if (ath_startrecv(sc) != 0) {
898 ath_err(common, "Unable to restart recv logic\n");
901 if (sc->sc_flags & SC_OP_BEACONS)
902 ath_set_beacon(sc); /* restart beacons */
904 /* Re-Enable interrupts */
905 ath9k_hw_set_interrupts(ah, ah->imask);
908 ath9k_hw_cfg_output(ah, ah->led_pin,
909 AR_GPIO_OUTPUT_MUX_AS_OUTPUT);
910 ath9k_hw_set_gpio(ah, ah->led_pin, 0);
912 ieee80211_wake_queues(hw);
913 ieee80211_queue_delayed_work(hw, &sc->hw_pll_work, HZ/2);
916 spin_unlock_bh(&sc->sc_pcu_lock);
918 ath9k_ps_restore(sc);
921 void ath_radio_disable(struct ath_softc *sc, struct ieee80211_hw *hw)
923 struct ath_hw *ah = sc->sc_ah;
924 struct ieee80211_channel *channel = hw->conf.channel;
928 cancel_delayed_work_sync(&sc->hw_pll_work);
930 spin_lock_bh(&sc->sc_pcu_lock);
932 ieee80211_stop_queues(hw);
935 * Keep the LED on when the radio is disabled
936 * during idle unassociated state.
939 ath9k_hw_set_gpio(ah, ah->led_pin, 1);
940 ath9k_hw_cfg_gpio_input(ah, ah->led_pin);
943 /* Disable interrupts */
944 ath9k_hw_disable_interrupts(ah);
946 ath_drain_all_txq(sc, false); /* clear pending tx frames */
948 ath_stoprecv(sc); /* turn off frame recv */
949 ath_flushrecv(sc); /* flush recv queue */
952 ah->curchan = ath9k_cmn_get_curchannel(hw, ah);
954 r = ath9k_hw_reset(ah, ah->curchan, ah->caldata, false);
956 ath_err(ath9k_hw_common(sc->sc_ah),
957 "Unable to reset channel (%u MHz), reset status %d\n",
958 channel->center_freq, r);
961 ath9k_hw_phy_disable(ah);
963 ath9k_hw_configpcipowersave(ah, 1, 1);
965 spin_unlock_bh(&sc->sc_pcu_lock);
966 ath9k_ps_restore(sc);
969 int ath_reset(struct ath_softc *sc, bool retry_tx)
971 struct ath_hw *ah = sc->sc_ah;
972 struct ath_common *common = ath9k_hw_common(ah);
973 struct ieee80211_hw *hw = sc->hw;
976 sc->hw_busy_count = 0;
980 del_timer_sync(&common->ani.timer);
983 spin_lock_bh(&sc->sc_pcu_lock);
985 ieee80211_stop_queues(hw);
987 ath9k_hw_disable_interrupts(ah);
988 ath_drain_all_txq(sc, retry_tx);
993 r = ath9k_hw_reset(ah, sc->sc_ah->curchan, ah->caldata, false);
996 "Unable to reset hardware; reset status %d\n", r);
998 if (ath_startrecv(sc) != 0)
999 ath_err(common, "Unable to start recv logic\n");
1002 * We may be doing a reset in response to a request
1003 * that changes the channel so update any state that
1004 * might change as a result.
1006 ath9k_cmn_update_txpow(ah, sc->curtxpow,
1007 sc->config.txpowlimit, &sc->curtxpow);
1009 if ((sc->sc_flags & SC_OP_BEACONS) || !(sc->sc_flags & (SC_OP_OFFCHANNEL)))
1010 ath_set_beacon(sc); /* restart beacons */
1012 ath9k_hw_set_interrupts(ah, ah->imask);
1016 for (i = 0; i < ATH9K_NUM_TX_QUEUES; i++) {
1017 if (ATH_TXQ_SETUP(sc, i)) {
1018 spin_lock_bh(&sc->tx.txq[i].axq_lock);
1019 ath_txq_schedule(sc, &sc->tx.txq[i]);
1020 spin_unlock_bh(&sc->tx.txq[i].axq_lock);
1025 ieee80211_wake_queues(hw);
1026 spin_unlock_bh(&sc->sc_pcu_lock);
1029 if (!common->disable_ani)
1030 ath_start_ani(common);
1032 ath9k_ps_restore(sc);
1037 /**********************/
1038 /* mac80211 callbacks */
1039 /**********************/
1041 static int ath9k_start(struct ieee80211_hw *hw)
1043 struct ath_softc *sc = hw->priv;
1044 struct ath_hw *ah = sc->sc_ah;
1045 struct ath_common *common = ath9k_hw_common(ah);
1046 struct ieee80211_channel *curchan = hw->conf.channel;
1047 struct ath9k_channel *init_channel;
1050 ath_dbg(common, ATH_DBG_CONFIG,
1051 "Starting driver with initial channel: %d MHz\n",
1052 curchan->center_freq);
1054 ath9k_ps_wakeup(sc);
1056 mutex_lock(&sc->mutex);
1058 /* setup initial channel */
1059 sc->chan_idx = curchan->hw_value;
1061 init_channel = ath9k_cmn_get_curchannel(hw, ah);
1063 /* Reset SERDES registers */
1064 ath9k_hw_configpcipowersave(ah, 0, 0);
1067 * The basic interface to setting the hardware in a good
1068 * state is ``reset''. On return the hardware is known to
1069 * be powered up and with interrupts disabled. This must
1070 * be followed by initialization of the appropriate bits
1071 * and then setup of the interrupt mask.
1073 spin_lock_bh(&sc->sc_pcu_lock);
1074 r = ath9k_hw_reset(ah, init_channel, ah->caldata, false);
1077 "Unable to reset hardware; reset status %d (freq %u MHz)\n",
1078 r, curchan->center_freq);
1079 spin_unlock_bh(&sc->sc_pcu_lock);
1084 * This is needed only to setup initial state
1085 * but it's best done after a reset.
1087 ath9k_cmn_update_txpow(ah, sc->curtxpow,
1088 sc->config.txpowlimit, &sc->curtxpow);
1091 * Setup the hardware after reset:
1092 * The receive engine is set going.
1093 * Frame transmit is handled entirely
1094 * in the frame output path; there's nothing to do
1095 * here except setup the interrupt mask.
1097 if (ath_startrecv(sc) != 0) {
1098 ath_err(common, "Unable to start recv logic\n");
1100 spin_unlock_bh(&sc->sc_pcu_lock);
1103 spin_unlock_bh(&sc->sc_pcu_lock);
1105 /* Setup our intr mask. */
1106 ah->imask = ATH9K_INT_TX | ATH9K_INT_RXEOL |
1107 ATH9K_INT_RXORN | ATH9K_INT_FATAL |
1110 if (ah->caps.hw_caps & ATH9K_HW_CAP_EDMA)
1111 ah->imask |= ATH9K_INT_RXHP |
1113 ATH9K_INT_BB_WATCHDOG;
1115 ah->imask |= ATH9K_INT_RX;
1117 ah->imask |= ATH9K_INT_GTT;
1119 if (ah->caps.hw_caps & ATH9K_HW_CAP_HT)
1120 ah->imask |= ATH9K_INT_CST;
1122 sc->sc_flags &= ~SC_OP_INVALID;
1123 sc->sc_ah->is_monitoring = false;
1125 /* Disable BMISS interrupt when we're not associated */
1126 ah->imask &= ~(ATH9K_INT_SWBA | ATH9K_INT_BMISS);
1127 ath9k_hw_set_interrupts(ah, ah->imask);
1129 ieee80211_wake_queues(hw);
1131 ieee80211_queue_delayed_work(sc->hw, &sc->tx_complete_work, 0);
1133 if ((ah->btcoex_hw.scheme != ATH_BTCOEX_CFG_NONE) &&
1134 !ah->btcoex_hw.enabled) {
1135 ath9k_hw_btcoex_set_weight(ah, AR_BT_COEX_WGHT,
1136 AR_STOMP_LOW_WLAN_WGHT);
1137 ath9k_hw_btcoex_enable(ah);
1139 if (common->bus_ops->bt_coex_prep)
1140 common->bus_ops->bt_coex_prep(common);
1141 if (ah->btcoex_hw.scheme == ATH_BTCOEX_CFG_3WIRE)
1142 ath9k_btcoex_timer_resume(sc);
1145 if (ah->caps.pcie_lcr_extsync_en && common->bus_ops->extn_synch_en)
1146 common->bus_ops->extn_synch_en(common);
1149 mutex_unlock(&sc->mutex);
1151 ath9k_ps_restore(sc);
1156 static void ath9k_tx(struct ieee80211_hw *hw, struct sk_buff *skb)
1158 struct ath_softc *sc = hw->priv;
1159 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
1160 struct ath_tx_control txctl;
1161 struct ieee80211_hdr *hdr = (struct ieee80211_hdr *) skb->data;
1163 if (sc->ps_enabled) {
1165 * mac80211 does not set PM field for normal data frames, so we
1166 * need to update that based on the current PS mode.
1168 if (ieee80211_is_data(hdr->frame_control) &&
1169 !ieee80211_is_nullfunc(hdr->frame_control) &&
1170 !ieee80211_has_pm(hdr->frame_control)) {
1171 ath_dbg(common, ATH_DBG_PS,
1172 "Add PM=1 for a TX frame while in PS mode\n");
1173 hdr->frame_control |= cpu_to_le16(IEEE80211_FCTL_PM);
1177 if (unlikely(sc->sc_ah->power_mode != ATH9K_PM_AWAKE)) {
1179 * We are using PS-Poll and mac80211 can request TX while in
1180 * power save mode. Need to wake up hardware for the TX to be
1181 * completed and if needed, also for RX of buffered frames.
1183 ath9k_ps_wakeup(sc);
1184 if (!(sc->sc_ah->caps.hw_caps & ATH9K_HW_CAP_AUTOSLEEP))
1185 ath9k_hw_setrxabort(sc->sc_ah, 0);
1186 if (ieee80211_is_pspoll(hdr->frame_control)) {
1187 ath_dbg(common, ATH_DBG_PS,
1188 "Sending PS-Poll to pick a buffered frame\n");
1189 sc->ps_flags |= PS_WAIT_FOR_PSPOLL_DATA;
1191 ath_dbg(common, ATH_DBG_PS,
1192 "Wake up to complete TX\n");
1193 sc->ps_flags |= PS_WAIT_FOR_TX_ACK;
1196 * The actual restore operation will happen only after
1197 * the sc_flags bit is cleared. We are just dropping
1198 * the ps_usecount here.
1200 ath9k_ps_restore(sc);
1203 memset(&txctl, 0, sizeof(struct ath_tx_control));
1204 txctl.txq = sc->tx.txq_map[skb_get_queue_mapping(skb)];
1206 ath_dbg(common, ATH_DBG_XMIT, "transmitting packet, skb: %p\n", skb);
1208 if (ath_tx_start(hw, skb, &txctl) != 0) {
1209 ath_dbg(common, ATH_DBG_XMIT, "TX failed\n");
1215 dev_kfree_skb_any(skb);
1218 static void ath9k_stop(struct ieee80211_hw *hw)
1220 struct ath_softc *sc = hw->priv;
1221 struct ath_hw *ah = sc->sc_ah;
1222 struct ath_common *common = ath9k_hw_common(ah);
1224 mutex_lock(&sc->mutex);
1226 cancel_delayed_work_sync(&sc->tx_complete_work);
1227 cancel_delayed_work_sync(&sc->hw_pll_work);
1228 cancel_work_sync(&sc->paprd_work);
1229 cancel_work_sync(&sc->hw_check_work);
1231 if (sc->sc_flags & SC_OP_INVALID) {
1232 ath_dbg(common, ATH_DBG_ANY, "Device not present\n");
1233 mutex_unlock(&sc->mutex);
1237 /* Ensure HW is awake when we try to shut it down. */
1238 ath9k_ps_wakeup(sc);
1240 if (ah->btcoex_hw.enabled) {
1241 ath9k_hw_btcoex_disable(ah);
1242 if (ah->btcoex_hw.scheme == ATH_BTCOEX_CFG_3WIRE)
1243 ath9k_btcoex_timer_pause(sc);
1246 spin_lock_bh(&sc->sc_pcu_lock);
1248 /* prevent tasklets to enable interrupts once we disable them */
1249 ah->imask &= ~ATH9K_INT_GLOBAL;
1251 /* make sure h/w will not generate any interrupt
1252 * before setting the invalid flag. */
1253 ath9k_hw_disable_interrupts(ah);
1255 if (!(sc->sc_flags & SC_OP_INVALID)) {
1256 ath_drain_all_txq(sc, false);
1258 ath9k_hw_phy_disable(ah);
1260 sc->rx.rxlink = NULL;
1263 dev_kfree_skb_any(sc->rx.frag);
1267 /* disable HAL and put h/w to sleep */
1268 ath9k_hw_disable(ah);
1269 ath9k_hw_configpcipowersave(ah, 1, 1);
1271 spin_unlock_bh(&sc->sc_pcu_lock);
1273 /* we can now sync irq and kill any running tasklets, since we already
1274 * disabled interrupts and not holding a spin lock */
1275 synchronize_irq(sc->irq);
1276 tasklet_kill(&sc->intr_tq);
1277 tasklet_kill(&sc->bcon_tasklet);
1279 ath9k_ps_restore(sc);
1282 ath_radio_disable(sc, hw);
1284 sc->sc_flags |= SC_OP_INVALID;
1286 mutex_unlock(&sc->mutex);
1288 ath_dbg(common, ATH_DBG_CONFIG, "Driver halt\n");
1291 bool ath9k_uses_beacons(int type)
1294 case NL80211_IFTYPE_AP:
1295 case NL80211_IFTYPE_ADHOC:
1296 case NL80211_IFTYPE_MESH_POINT:
1303 static void ath9k_reclaim_beacon(struct ath_softc *sc,
1304 struct ieee80211_vif *vif)
1306 struct ath_vif *avp = (void *)vif->drv_priv;
1308 ath9k_set_beaconing_status(sc, false);
1309 ath_beacon_return(sc, avp);
1310 ath9k_set_beaconing_status(sc, true);
1311 sc->sc_flags &= ~SC_OP_BEACONS;
1314 static void ath9k_vif_iter(void *data, u8 *mac, struct ieee80211_vif *vif)
1316 struct ath9k_vif_iter_data *iter_data = data;
1319 if (iter_data->hw_macaddr)
1320 for (i = 0; i < ETH_ALEN; i++)
1321 iter_data->mask[i] &=
1322 ~(iter_data->hw_macaddr[i] ^ mac[i]);
1324 switch (vif->type) {
1325 case NL80211_IFTYPE_AP:
1328 case NL80211_IFTYPE_STATION:
1329 iter_data->nstations++;
1331 case NL80211_IFTYPE_ADHOC:
1332 iter_data->nadhocs++;
1334 case NL80211_IFTYPE_MESH_POINT:
1335 iter_data->nmeshes++;
1337 case NL80211_IFTYPE_WDS:
1341 iter_data->nothers++;
1346 /* Called with sc->mutex held. */
1347 void ath9k_calculate_iter_data(struct ieee80211_hw *hw,
1348 struct ieee80211_vif *vif,
1349 struct ath9k_vif_iter_data *iter_data)
1351 struct ath_softc *sc = hw->priv;
1352 struct ath_hw *ah = sc->sc_ah;
1353 struct ath_common *common = ath9k_hw_common(ah);
1356 * Use the hardware MAC address as reference, the hardware uses it
1357 * together with the BSSID mask when matching addresses.
1359 memset(iter_data, 0, sizeof(*iter_data));
1360 iter_data->hw_macaddr = common->macaddr;
1361 memset(&iter_data->mask, 0xff, ETH_ALEN);
1364 ath9k_vif_iter(iter_data, vif->addr, vif);
1366 /* Get list of all active MAC addresses */
1367 ieee80211_iterate_active_interfaces_atomic(sc->hw, ath9k_vif_iter,
1371 /* Called with sc->mutex held. */
1372 static void ath9k_calculate_summary_state(struct ieee80211_hw *hw,
1373 struct ieee80211_vif *vif)
1375 struct ath_softc *sc = hw->priv;
1376 struct ath_hw *ah = sc->sc_ah;
1377 struct ath_common *common = ath9k_hw_common(ah);
1378 struct ath9k_vif_iter_data iter_data;
1380 ath9k_calculate_iter_data(hw, vif, &iter_data);
1382 /* Set BSSID mask. */
1383 memcpy(common->bssidmask, iter_data.mask, ETH_ALEN);
1384 ath_hw_setbssidmask(common);
1386 /* Set op-mode & TSF */
1387 if (iter_data.naps > 0) {
1388 ath9k_hw_set_tsfadjust(ah, 1);
1389 sc->sc_flags |= SC_OP_TSF_RESET;
1390 ah->opmode = NL80211_IFTYPE_AP;
1392 ath9k_hw_set_tsfadjust(ah, 0);
1393 sc->sc_flags &= ~SC_OP_TSF_RESET;
1395 if (iter_data.nmeshes)
1396 ah->opmode = NL80211_IFTYPE_MESH_POINT;
1397 else if (iter_data.nwds)
1398 ah->opmode = NL80211_IFTYPE_AP;
1399 else if (iter_data.nadhocs)
1400 ah->opmode = NL80211_IFTYPE_ADHOC;
1402 ah->opmode = NL80211_IFTYPE_STATION;
1406 * Enable MIB interrupts when there are hardware phy counters.
1408 if ((iter_data.nstations + iter_data.nadhocs + iter_data.nmeshes) > 0) {
1409 if (ah->config.enable_ani)
1410 ah->imask |= ATH9K_INT_MIB;
1411 ah->imask |= ATH9K_INT_TSFOOR;
1413 ah->imask &= ~ATH9K_INT_MIB;
1414 ah->imask &= ~ATH9K_INT_TSFOOR;
1417 ath9k_hw_set_interrupts(ah, ah->imask);
1420 if (iter_data.naps > 0) {
1421 sc->sc_ah->stats.avgbrssi = ATH_RSSI_DUMMY_MARKER;
1423 if (!common->disable_ani) {
1424 sc->sc_flags |= SC_OP_ANI_RUN;
1425 ath_start_ani(common);
1429 sc->sc_flags &= ~SC_OP_ANI_RUN;
1430 del_timer_sync(&common->ani.timer);
1434 /* Called with sc->mutex held, vif counts set up properly. */
1435 static void ath9k_do_vif_add_setup(struct ieee80211_hw *hw,
1436 struct ieee80211_vif *vif)
1438 struct ath_softc *sc = hw->priv;
1440 ath9k_calculate_summary_state(hw, vif);
1442 if (ath9k_uses_beacons(vif->type)) {
1444 /* This may fail because upper levels do not have beacons
1445 * properly configured yet. That's OK, we assume it
1446 * will be properly configured and then we will be notified
1447 * in the info_changed method and set up beacons properly
1450 ath9k_set_beaconing_status(sc, false);
1451 error = ath_beacon_alloc(sc, vif);
1453 ath_beacon_config(sc, vif);
1454 ath9k_set_beaconing_status(sc, true);
1459 static int ath9k_add_interface(struct ieee80211_hw *hw,
1460 struct ieee80211_vif *vif)
1462 struct ath_softc *sc = hw->priv;
1463 struct ath_hw *ah = sc->sc_ah;
1464 struct ath_common *common = ath9k_hw_common(ah);
1467 ath9k_ps_wakeup(sc);
1468 mutex_lock(&sc->mutex);
1470 switch (vif->type) {
1471 case NL80211_IFTYPE_STATION:
1472 case NL80211_IFTYPE_WDS:
1473 case NL80211_IFTYPE_ADHOC:
1474 case NL80211_IFTYPE_AP:
1475 case NL80211_IFTYPE_MESH_POINT:
1478 ath_err(common, "Interface type %d not yet supported\n",
1484 if (ath9k_uses_beacons(vif->type)) {
1485 if (sc->nbcnvifs >= ATH_BCBUF) {
1486 ath_err(common, "Not enough beacon buffers when adding"
1487 " new interface of type: %i\n",
1494 if ((ah->opmode == NL80211_IFTYPE_ADHOC) ||
1495 ((vif->type == NL80211_IFTYPE_ADHOC) &&
1497 ath_err(common, "Cannot create ADHOC interface when other"
1498 " interfaces already exist.\n");
1503 ath_dbg(common, ATH_DBG_CONFIG,
1504 "Attach a VIF of type: %d\n", vif->type);
1508 ath9k_do_vif_add_setup(hw, vif);
1510 mutex_unlock(&sc->mutex);
1511 ath9k_ps_restore(sc);
1515 static int ath9k_change_interface(struct ieee80211_hw *hw,
1516 struct ieee80211_vif *vif,
1517 enum nl80211_iftype new_type,
1520 struct ath_softc *sc = hw->priv;
1521 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
1524 ath_dbg(common, ATH_DBG_CONFIG, "Change Interface\n");
1525 mutex_lock(&sc->mutex);
1526 ath9k_ps_wakeup(sc);
1528 /* See if new interface type is valid. */
1529 if ((new_type == NL80211_IFTYPE_ADHOC) &&
1531 ath_err(common, "When using ADHOC, it must be the only"
1537 if (ath9k_uses_beacons(new_type) &&
1538 !ath9k_uses_beacons(vif->type)) {
1539 if (sc->nbcnvifs >= ATH_BCBUF) {
1540 ath_err(common, "No beacon slot available\n");
1546 /* Clean up old vif stuff */
1547 if (ath9k_uses_beacons(vif->type))
1548 ath9k_reclaim_beacon(sc, vif);
1550 /* Add new settings */
1551 vif->type = new_type;
1554 ath9k_do_vif_add_setup(hw, vif);
1556 ath9k_ps_restore(sc);
1557 mutex_unlock(&sc->mutex);
1561 static void ath9k_remove_interface(struct ieee80211_hw *hw,
1562 struct ieee80211_vif *vif)
1564 struct ath_softc *sc = hw->priv;
1565 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
1567 ath_dbg(common, ATH_DBG_CONFIG, "Detach Interface\n");
1569 ath9k_ps_wakeup(sc);
1570 mutex_lock(&sc->mutex);
1574 /* Reclaim beacon resources */
1575 if (ath9k_uses_beacons(vif->type))
1576 ath9k_reclaim_beacon(sc, vif);
1578 ath9k_calculate_summary_state(hw, NULL);
1580 mutex_unlock(&sc->mutex);
1581 ath9k_ps_restore(sc);
1584 static void ath9k_enable_ps(struct ath_softc *sc)
1586 struct ath_hw *ah = sc->sc_ah;
1588 sc->ps_enabled = true;
1589 if (!(ah->caps.hw_caps & ATH9K_HW_CAP_AUTOSLEEP)) {
1590 if ((ah->imask & ATH9K_INT_TIM_TIMER) == 0) {
1591 ah->imask |= ATH9K_INT_TIM_TIMER;
1592 ath9k_hw_set_interrupts(ah, ah->imask);
1594 ath9k_hw_setrxabort(ah, 1);
1598 static void ath9k_disable_ps(struct ath_softc *sc)
1600 struct ath_hw *ah = sc->sc_ah;
1602 sc->ps_enabled = false;
1603 ath9k_hw_setpower(ah, ATH9K_PM_AWAKE);
1604 if (!(ah->caps.hw_caps & ATH9K_HW_CAP_AUTOSLEEP)) {
1605 ath9k_hw_setrxabort(ah, 0);
1606 sc->ps_flags &= ~(PS_WAIT_FOR_BEACON |
1608 PS_WAIT_FOR_PSPOLL_DATA |
1609 PS_WAIT_FOR_TX_ACK);
1610 if (ah->imask & ATH9K_INT_TIM_TIMER) {
1611 ah->imask &= ~ATH9K_INT_TIM_TIMER;
1612 ath9k_hw_set_interrupts(ah, ah->imask);
1618 static int ath9k_config(struct ieee80211_hw *hw, u32 changed)
1620 struct ath_softc *sc = hw->priv;
1621 struct ath_hw *ah = sc->sc_ah;
1622 struct ath_common *common = ath9k_hw_common(ah);
1623 struct ieee80211_conf *conf = &hw->conf;
1624 bool disable_radio = false;
1626 mutex_lock(&sc->mutex);
1629 * Leave this as the first check because we need to turn on the
1630 * radio if it was disabled before prior to processing the rest
1631 * of the changes. Likewise we must only disable the radio towards
1634 if (changed & IEEE80211_CONF_CHANGE_IDLE) {
1635 sc->ps_idle = !!(conf->flags & IEEE80211_CONF_IDLE);
1637 ath_radio_enable(sc, hw);
1638 ath_dbg(common, ATH_DBG_CONFIG,
1639 "not-idle: enabling radio\n");
1641 disable_radio = true;
1646 * We just prepare to enable PS. We have to wait until our AP has
1647 * ACK'd our null data frame to disable RX otherwise we'll ignore
1648 * those ACKs and end up retransmitting the same null data frames.
1649 * IEEE80211_CONF_CHANGE_PS is only passed by mac80211 for STA mode.
1651 if (changed & IEEE80211_CONF_CHANGE_PS) {
1652 unsigned long flags;
1653 spin_lock_irqsave(&sc->sc_pm_lock, flags);
1654 if (conf->flags & IEEE80211_CONF_PS)
1655 ath9k_enable_ps(sc);
1657 ath9k_disable_ps(sc);
1658 spin_unlock_irqrestore(&sc->sc_pm_lock, flags);
1661 if (changed & IEEE80211_CONF_CHANGE_MONITOR) {
1662 if (conf->flags & IEEE80211_CONF_MONITOR) {
1663 ath_dbg(common, ATH_DBG_CONFIG,
1664 "Monitor mode is enabled\n");
1665 sc->sc_ah->is_monitoring = true;
1667 ath_dbg(common, ATH_DBG_CONFIG,
1668 "Monitor mode is disabled\n");
1669 sc->sc_ah->is_monitoring = false;
1673 if (changed & IEEE80211_CONF_CHANGE_CHANNEL) {
1674 struct ieee80211_channel *curchan = hw->conf.channel;
1675 int pos = curchan->hw_value;
1677 unsigned long flags;
1680 old_pos = ah->curchan - &ah->channels[0];
1682 if (hw->conf.flags & IEEE80211_CONF_OFFCHANNEL)
1683 sc->sc_flags |= SC_OP_OFFCHANNEL;
1685 sc->sc_flags &= ~SC_OP_OFFCHANNEL;
1687 ath_dbg(common, ATH_DBG_CONFIG,
1688 "Set channel: %d MHz type: %d\n",
1689 curchan->center_freq, conf->channel_type);
1691 ath9k_cmn_update_ichannel(&sc->sc_ah->channels[pos],
1692 curchan, conf->channel_type);
1694 /* update survey stats for the old channel before switching */
1695 spin_lock_irqsave(&common->cc_lock, flags);
1696 ath_update_survey_stats(sc);
1697 spin_unlock_irqrestore(&common->cc_lock, flags);
1700 * If the operating channel changes, change the survey in-use flags
1702 * Reset the survey data for the new channel, unless we're switching
1703 * back to the operating channel from an off-channel operation.
1705 if (!(hw->conf.flags & IEEE80211_CONF_OFFCHANNEL) &&
1706 sc->cur_survey != &sc->survey[pos]) {
1709 sc->cur_survey->filled &= ~SURVEY_INFO_IN_USE;
1711 sc->cur_survey = &sc->survey[pos];
1713 memset(sc->cur_survey, 0, sizeof(struct survey_info));
1714 sc->cur_survey->filled |= SURVEY_INFO_IN_USE;
1715 } else if (!(sc->survey[pos].filled & SURVEY_INFO_IN_USE)) {
1716 memset(&sc->survey[pos], 0, sizeof(struct survey_info));
1719 if (ath_set_channel(sc, hw, &sc->sc_ah->channels[pos]) < 0) {
1720 ath_err(common, "Unable to set channel\n");
1721 mutex_unlock(&sc->mutex);
1726 * The most recent snapshot of channel->noisefloor for the old
1727 * channel is only available after the hardware reset. Copy it to
1728 * the survey stats now.
1731 ath_update_survey_nf(sc, old_pos);
1734 if (changed & IEEE80211_CONF_CHANGE_POWER) {
1735 ath_dbg(common, ATH_DBG_CONFIG,
1736 "Set power: %d\n", conf->power_level);
1737 sc->config.txpowlimit = 2 * conf->power_level;
1738 ath9k_ps_wakeup(sc);
1739 ath9k_cmn_update_txpow(ah, sc->curtxpow,
1740 sc->config.txpowlimit, &sc->curtxpow);
1741 ath9k_ps_restore(sc);
1744 if (disable_radio) {
1745 ath_dbg(common, ATH_DBG_CONFIG, "idle: disabling radio\n");
1746 ath_radio_disable(sc, hw);
1749 mutex_unlock(&sc->mutex);
1754 #define SUPPORTED_FILTERS \
1755 (FIF_PROMISC_IN_BSS | \
1760 FIF_BCN_PRBRESP_PROMISC | \
1764 /* FIXME: sc->sc_full_reset ? */
1765 static void ath9k_configure_filter(struct ieee80211_hw *hw,
1766 unsigned int changed_flags,
1767 unsigned int *total_flags,
1770 struct ath_softc *sc = hw->priv;
1773 changed_flags &= SUPPORTED_FILTERS;
1774 *total_flags &= SUPPORTED_FILTERS;
1776 sc->rx.rxfilter = *total_flags;
1777 ath9k_ps_wakeup(sc);
1778 rfilt = ath_calcrxfilter(sc);
1779 ath9k_hw_setrxfilter(sc->sc_ah, rfilt);
1780 ath9k_ps_restore(sc);
1782 ath_dbg(ath9k_hw_common(sc->sc_ah), ATH_DBG_CONFIG,
1783 "Set HW RX filter: 0x%x\n", rfilt);
1786 static int ath9k_sta_add(struct ieee80211_hw *hw,
1787 struct ieee80211_vif *vif,
1788 struct ieee80211_sta *sta)
1790 struct ath_softc *sc = hw->priv;
1791 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
1792 struct ath_node *an = (struct ath_node *) sta->drv_priv;
1793 struct ieee80211_key_conf ps_key = { };
1795 ath_node_attach(sc, sta);
1797 if (vif->type != NL80211_IFTYPE_AP &&
1798 vif->type != NL80211_IFTYPE_AP_VLAN)
1801 an->ps_key = ath_key_config(common, vif, sta, &ps_key);
1806 static void ath9k_del_ps_key(struct ath_softc *sc,
1807 struct ieee80211_vif *vif,
1808 struct ieee80211_sta *sta)
1810 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
1811 struct ath_node *an = (struct ath_node *) sta->drv_priv;
1812 struct ieee80211_key_conf ps_key = { .hw_key_idx = an->ps_key };
1817 ath_key_delete(common, &ps_key);
1820 static int ath9k_sta_remove(struct ieee80211_hw *hw,
1821 struct ieee80211_vif *vif,
1822 struct ieee80211_sta *sta)
1824 struct ath_softc *sc = hw->priv;
1826 ath9k_del_ps_key(sc, vif, sta);
1827 ath_node_detach(sc, sta);
1832 static void ath9k_sta_notify(struct ieee80211_hw *hw,
1833 struct ieee80211_vif *vif,
1834 enum sta_notify_cmd cmd,
1835 struct ieee80211_sta *sta)
1837 struct ath_softc *sc = hw->priv;
1838 struct ath_node *an = (struct ath_node *) sta->drv_priv;
1841 case STA_NOTIFY_SLEEP:
1842 an->sleeping = true;
1843 if (ath_tx_aggr_sleep(sc, an))
1844 ieee80211_sta_set_tim(sta);
1846 case STA_NOTIFY_AWAKE:
1847 an->sleeping = false;
1848 ath_tx_aggr_wakeup(sc, an);
1853 static int ath9k_conf_tx(struct ieee80211_hw *hw, u16 queue,
1854 const struct ieee80211_tx_queue_params *params)
1856 struct ath_softc *sc = hw->priv;
1857 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
1858 struct ath_txq *txq;
1859 struct ath9k_tx_queue_info qi;
1862 if (queue >= WME_NUM_AC)
1865 txq = sc->tx.txq_map[queue];
1867 ath9k_ps_wakeup(sc);
1868 mutex_lock(&sc->mutex);
1870 memset(&qi, 0, sizeof(struct ath9k_tx_queue_info));
1872 qi.tqi_aifs = params->aifs;
1873 qi.tqi_cwmin = params->cw_min;
1874 qi.tqi_cwmax = params->cw_max;
1875 qi.tqi_burstTime = params->txop;
1877 ath_dbg(common, ATH_DBG_CONFIG,
1878 "Configure tx [queue/halq] [%d/%d], aifs: %d, cw_min: %d, cw_max: %d, txop: %d\n",
1879 queue, txq->axq_qnum, params->aifs, params->cw_min,
1880 params->cw_max, params->txop);
1882 ret = ath_txq_update(sc, txq->axq_qnum, &qi);
1884 ath_err(common, "TXQ Update failed\n");
1886 if (sc->sc_ah->opmode == NL80211_IFTYPE_ADHOC)
1887 if (queue == WME_AC_BE && !ret)
1888 ath_beaconq_config(sc);
1890 mutex_unlock(&sc->mutex);
1891 ath9k_ps_restore(sc);
1896 static int ath9k_set_key(struct ieee80211_hw *hw,
1897 enum set_key_cmd cmd,
1898 struct ieee80211_vif *vif,
1899 struct ieee80211_sta *sta,
1900 struct ieee80211_key_conf *key)
1902 struct ath_softc *sc = hw->priv;
1903 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
1906 if (ath9k_modparam_nohwcrypt)
1909 if (vif->type == NL80211_IFTYPE_ADHOC &&
1910 (key->cipher == WLAN_CIPHER_SUITE_TKIP ||
1911 key->cipher == WLAN_CIPHER_SUITE_CCMP) &&
1912 !(key->flags & IEEE80211_KEY_FLAG_PAIRWISE)) {
1914 * For now, disable hw crypto for the RSN IBSS group keys. This
1915 * could be optimized in the future to use a modified key cache
1916 * design to support per-STA RX GTK, but until that gets
1917 * implemented, use of software crypto for group addressed
1918 * frames is a acceptable to allow RSN IBSS to be used.
1923 mutex_lock(&sc->mutex);
1924 ath9k_ps_wakeup(sc);
1925 ath_dbg(common, ATH_DBG_CONFIG, "Set HW Key\n");
1930 ath9k_del_ps_key(sc, vif, sta);
1932 ret = ath_key_config(common, vif, sta, key);
1934 key->hw_key_idx = ret;
1935 /* push IV and Michael MIC generation to stack */
1936 key->flags |= IEEE80211_KEY_FLAG_GENERATE_IV;
1937 if (key->cipher == WLAN_CIPHER_SUITE_TKIP)
1938 key->flags |= IEEE80211_KEY_FLAG_GENERATE_MMIC;
1939 if (sc->sc_ah->sw_mgmt_crypto &&
1940 key->cipher == WLAN_CIPHER_SUITE_CCMP)
1941 key->flags |= IEEE80211_KEY_FLAG_SW_MGMT;
1946 ath_key_delete(common, key);
1952 ath9k_ps_restore(sc);
1953 mutex_unlock(&sc->mutex);
1957 static void ath9k_bss_iter(void *data, u8 *mac, struct ieee80211_vif *vif)
1959 struct ath_softc *sc = data;
1960 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
1961 struct ieee80211_bss_conf *bss_conf = &vif->bss_conf;
1962 struct ath_vif *avp = (void *)vif->drv_priv;
1965 * Skip iteration if primary station vif's bss info
1968 if (sc->sc_flags & SC_OP_PRIM_STA_VIF)
1971 if (bss_conf->assoc) {
1972 sc->sc_flags |= SC_OP_PRIM_STA_VIF;
1973 avp->primary_sta_vif = true;
1974 memcpy(common->curbssid, bss_conf->bssid, ETH_ALEN);
1975 common->curaid = bss_conf->aid;
1976 ath9k_hw_write_associd(sc->sc_ah);
1977 ath_dbg(common, ATH_DBG_CONFIG,
1978 "Bss Info ASSOC %d, bssid: %pM\n",
1979 bss_conf->aid, common->curbssid);
1980 ath_beacon_config(sc, vif);
1982 * Request a re-configuration of Beacon related timers
1983 * on the receipt of the first Beacon frame (i.e.,
1984 * after time sync with the AP).
1986 sc->ps_flags |= PS_BEACON_SYNC | PS_WAIT_FOR_BEACON;
1987 /* Reset rssi stats */
1988 sc->last_rssi = ATH_RSSI_DUMMY_MARKER;
1989 sc->sc_ah->stats.avgbrssi = ATH_RSSI_DUMMY_MARKER;
1991 if (!common->disable_ani) {
1992 sc->sc_flags |= SC_OP_ANI_RUN;
1993 ath_start_ani(common);
1999 static void ath9k_config_bss(struct ath_softc *sc, struct ieee80211_vif *vif)
2001 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
2002 struct ieee80211_bss_conf *bss_conf = &vif->bss_conf;
2003 struct ath_vif *avp = (void *)vif->drv_priv;
2005 if (sc->sc_ah->opmode != NL80211_IFTYPE_STATION)
2008 /* Reconfigure bss info */
2009 if (avp->primary_sta_vif && !bss_conf->assoc) {
2010 ath_dbg(common, ATH_DBG_CONFIG,
2011 "Bss Info DISASSOC %d, bssid %pM\n",
2012 common->curaid, common->curbssid);
2013 sc->sc_flags &= ~(SC_OP_PRIM_STA_VIF | SC_OP_BEACONS);
2014 avp->primary_sta_vif = false;
2015 memset(common->curbssid, 0, ETH_ALEN);
2019 ieee80211_iterate_active_interfaces_atomic(
2020 sc->hw, ath9k_bss_iter, sc);
2023 * None of station vifs are associated.
2026 if (!(sc->sc_flags & SC_OP_PRIM_STA_VIF)) {
2027 ath9k_hw_write_associd(sc->sc_ah);
2029 sc->sc_flags &= ~SC_OP_ANI_RUN;
2030 del_timer_sync(&common->ani.timer);
2034 static void ath9k_bss_info_changed(struct ieee80211_hw *hw,
2035 struct ieee80211_vif *vif,
2036 struct ieee80211_bss_conf *bss_conf,
2039 struct ath_softc *sc = hw->priv;
2040 struct ath_hw *ah = sc->sc_ah;
2041 struct ath_common *common = ath9k_hw_common(ah);
2042 struct ath_vif *avp = (void *)vif->drv_priv;
2046 ath9k_ps_wakeup(sc);
2047 mutex_lock(&sc->mutex);
2049 if (changed & BSS_CHANGED_BSSID) {
2050 ath9k_config_bss(sc, vif);
2052 ath_dbg(common, ATH_DBG_CONFIG, "BSSID: %pM aid: 0x%x\n",
2053 common->curbssid, common->curaid);
2056 if (changed & BSS_CHANGED_IBSS) {
2057 /* There can be only one vif available */
2058 memcpy(common->curbssid, bss_conf->bssid, ETH_ALEN);
2059 common->curaid = bss_conf->aid;
2060 ath9k_hw_write_associd(sc->sc_ah);
2062 if (bss_conf->ibss_joined) {
2063 sc->sc_ah->stats.avgbrssi = ATH_RSSI_DUMMY_MARKER;
2065 if (!common->disable_ani) {
2066 sc->sc_flags |= SC_OP_ANI_RUN;
2067 ath_start_ani(common);
2071 sc->sc_flags &= ~SC_OP_ANI_RUN;
2072 del_timer_sync(&common->ani.timer);
2076 /* Enable transmission of beacons (AP, IBSS, MESH) */
2077 if ((changed & BSS_CHANGED_BEACON) ||
2078 ((changed & BSS_CHANGED_BEACON_ENABLED) && bss_conf->enable_beacon)) {
2079 ath9k_set_beaconing_status(sc, false);
2080 error = ath_beacon_alloc(sc, vif);
2082 ath_beacon_config(sc, vif);
2083 ath9k_set_beaconing_status(sc, true);
2086 if (changed & BSS_CHANGED_ERP_SLOT) {
2087 if (bss_conf->use_short_slot)
2091 if (vif->type == NL80211_IFTYPE_AP) {
2093 * Defer update, so that connected stations can adjust
2094 * their settings at the same time.
2095 * See beacon.c for more details
2097 sc->beacon.slottime = slottime;
2098 sc->beacon.updateslot = UPDATE;
2100 ah->slottime = slottime;
2101 ath9k_hw_init_global_settings(ah);
2105 /* Disable transmission of beacons */
2106 if ((changed & BSS_CHANGED_BEACON_ENABLED) &&
2107 !bss_conf->enable_beacon) {
2108 ath9k_set_beaconing_status(sc, false);
2109 avp->is_bslot_active = false;
2110 ath9k_set_beaconing_status(sc, true);
2113 if (changed & BSS_CHANGED_BEACON_INT) {
2115 * In case of AP mode, the HW TSF has to be reset
2116 * when the beacon interval changes.
2118 if (vif->type == NL80211_IFTYPE_AP) {
2119 sc->sc_flags |= SC_OP_TSF_RESET;
2120 ath9k_set_beaconing_status(sc, false);
2121 error = ath_beacon_alloc(sc, vif);
2123 ath_beacon_config(sc, vif);
2124 ath9k_set_beaconing_status(sc, true);
2126 ath_beacon_config(sc, vif);
2129 if (changed & BSS_CHANGED_ERP_PREAMBLE) {
2130 ath_dbg(common, ATH_DBG_CONFIG, "BSS Changed PREAMBLE %d\n",
2131 bss_conf->use_short_preamble);
2132 if (bss_conf->use_short_preamble)
2133 sc->sc_flags |= SC_OP_PREAMBLE_SHORT;
2135 sc->sc_flags &= ~SC_OP_PREAMBLE_SHORT;
2138 if (changed & BSS_CHANGED_ERP_CTS_PROT) {
2139 ath_dbg(common, ATH_DBG_CONFIG, "BSS Changed CTS PROT %d\n",
2140 bss_conf->use_cts_prot);
2141 if (bss_conf->use_cts_prot &&
2142 hw->conf.channel->band != IEEE80211_BAND_5GHZ)
2143 sc->sc_flags |= SC_OP_PROTECT_ENABLE;
2145 sc->sc_flags &= ~SC_OP_PROTECT_ENABLE;
2148 mutex_unlock(&sc->mutex);
2149 ath9k_ps_restore(sc);
2152 static u64 ath9k_get_tsf(struct ieee80211_hw *hw)
2154 struct ath_softc *sc = hw->priv;
2157 mutex_lock(&sc->mutex);
2158 ath9k_ps_wakeup(sc);
2159 tsf = ath9k_hw_gettsf64(sc->sc_ah);
2160 ath9k_ps_restore(sc);
2161 mutex_unlock(&sc->mutex);
2166 static void ath9k_set_tsf(struct ieee80211_hw *hw, u64 tsf)
2168 struct ath_softc *sc = hw->priv;
2170 mutex_lock(&sc->mutex);
2171 ath9k_ps_wakeup(sc);
2172 ath9k_hw_settsf64(sc->sc_ah, tsf);
2173 ath9k_ps_restore(sc);
2174 mutex_unlock(&sc->mutex);
2177 static void ath9k_reset_tsf(struct ieee80211_hw *hw)
2179 struct ath_softc *sc = hw->priv;
2181 mutex_lock(&sc->mutex);
2183 ath9k_ps_wakeup(sc);
2184 ath9k_hw_reset_tsf(sc->sc_ah);
2185 ath9k_ps_restore(sc);
2187 mutex_unlock(&sc->mutex);
2190 static int ath9k_ampdu_action(struct ieee80211_hw *hw,
2191 struct ieee80211_vif *vif,
2192 enum ieee80211_ampdu_mlme_action action,
2193 struct ieee80211_sta *sta,
2194 u16 tid, u16 *ssn, u8 buf_size)
2196 struct ath_softc *sc = hw->priv;
2202 case IEEE80211_AMPDU_RX_START:
2203 if (!(sc->sc_flags & SC_OP_RXAGGR))
2206 case IEEE80211_AMPDU_RX_STOP:
2208 case IEEE80211_AMPDU_TX_START:
2209 if (!(sc->sc_flags & SC_OP_TXAGGR))
2212 ath9k_ps_wakeup(sc);
2213 ret = ath_tx_aggr_start(sc, sta, tid, ssn);
2215 ieee80211_start_tx_ba_cb_irqsafe(vif, sta->addr, tid);
2216 ath9k_ps_restore(sc);
2218 case IEEE80211_AMPDU_TX_STOP:
2219 ath9k_ps_wakeup(sc);
2220 ath_tx_aggr_stop(sc, sta, tid);
2221 ieee80211_stop_tx_ba_cb_irqsafe(vif, sta->addr, tid);
2222 ath9k_ps_restore(sc);
2224 case IEEE80211_AMPDU_TX_OPERATIONAL:
2225 ath9k_ps_wakeup(sc);
2226 ath_tx_aggr_resume(sc, sta, tid);
2227 ath9k_ps_restore(sc);
2230 ath_err(ath9k_hw_common(sc->sc_ah), "Unknown AMPDU action\n");
2238 static int ath9k_get_survey(struct ieee80211_hw *hw, int idx,
2239 struct survey_info *survey)
2241 struct ath_softc *sc = hw->priv;
2242 struct ath_common *common = ath9k_hw_common(sc->sc_ah);
2243 struct ieee80211_supported_band *sband;
2244 struct ieee80211_channel *chan;
2245 unsigned long flags;
2248 spin_lock_irqsave(&common->cc_lock, flags);
2250 ath_update_survey_stats(sc);
2252 sband = hw->wiphy->bands[IEEE80211_BAND_2GHZ];
2253 if (sband && idx >= sband->n_channels) {
2254 idx -= sband->n_channels;
2259 sband = hw->wiphy->bands[IEEE80211_BAND_5GHZ];
2261 if (!sband || idx >= sband->n_channels) {
2262 spin_unlock_irqrestore(&common->cc_lock, flags);
2266 chan = &sband->channels[idx];
2267 pos = chan->hw_value;
2268 memcpy(survey, &sc->survey[pos], sizeof(*survey));
2269 survey->channel = chan;
2270 spin_unlock_irqrestore(&common->cc_lock, flags);
2275 static void ath9k_set_coverage_class(struct ieee80211_hw *hw, u8 coverage_class)
2277 struct ath_softc *sc = hw->priv;
2278 struct ath_hw *ah = sc->sc_ah;
2280 mutex_lock(&sc->mutex);
2281 ah->coverage_class = coverage_class;
2282 ath9k_hw_init_global_settings(ah);
2283 mutex_unlock(&sc->mutex);
2286 static void ath9k_flush(struct ieee80211_hw *hw, bool drop)
2288 struct ath_softc *sc = hw->priv;
2289 struct ath_hw *ah = sc->sc_ah;
2290 struct ath_common *common = ath9k_hw_common(ah);
2291 int timeout = 200; /* ms */
2295 mutex_lock(&sc->mutex);
2296 cancel_delayed_work_sync(&sc->tx_complete_work);
2298 if (sc->sc_flags & SC_OP_INVALID) {
2299 ath_dbg(common, ATH_DBG_ANY, "Device not present\n");
2300 mutex_unlock(&sc->mutex);
2307 for (j = 0; j < timeout; j++) {
2311 usleep_range(1000, 2000);
2313 for (i = 0; i < ATH9K_NUM_TX_QUEUES; i++) {
2314 if (!ATH_TXQ_SETUP(sc, i))
2317 npend = ath9k_has_pending_frames(sc, &sc->tx.txq[i]);
2327 ath9k_ps_wakeup(sc);
2328 spin_lock_bh(&sc->sc_pcu_lock);
2329 drain_txq = ath_drain_all_txq(sc, false);
2330 spin_unlock_bh(&sc->sc_pcu_lock);
2332 ath_reset(sc, false);
2333 ath9k_ps_restore(sc);
2334 ieee80211_wake_queues(hw);
2337 ieee80211_queue_delayed_work(hw, &sc->tx_complete_work, 0);
2338 mutex_unlock(&sc->mutex);
2341 static bool ath9k_tx_frames_pending(struct ieee80211_hw *hw)
2343 struct ath_softc *sc = hw->priv;
2346 for (i = 0; i < ATH9K_NUM_TX_QUEUES; i++) {
2347 if (!ATH_TXQ_SETUP(sc, i))
2350 if (ath9k_has_pending_frames(sc, &sc->tx.txq[i]))
2356 static int ath9k_tx_last_beacon(struct ieee80211_hw *hw)
2358 struct ath_softc *sc = hw->priv;
2359 struct ath_hw *ah = sc->sc_ah;
2360 struct ieee80211_vif *vif;
2361 struct ath_vif *avp;
2363 struct ath_tx_status ts;
2366 vif = sc->beacon.bslot[0];
2370 avp = (void *)vif->drv_priv;
2371 if (!avp->is_bslot_active)
2374 if (!sc->beacon.tx_processed) {
2375 tasklet_disable(&sc->bcon_tasklet);
2378 if (!bf || !bf->bf_mpdu)
2381 status = ath9k_hw_txprocdesc(ah, bf->bf_desc, &ts);
2382 if (status == -EINPROGRESS)
2385 sc->beacon.tx_processed = true;
2386 sc->beacon.tx_last = !(ts.ts_status & ATH9K_TXERR_MASK);
2389 tasklet_enable(&sc->bcon_tasklet);
2392 return sc->beacon.tx_last;
2395 struct ieee80211_ops ath9k_ops = {
2397 .start = ath9k_start,
2399 .add_interface = ath9k_add_interface,
2400 .change_interface = ath9k_change_interface,
2401 .remove_interface = ath9k_remove_interface,
2402 .config = ath9k_config,
2403 .configure_filter = ath9k_configure_filter,
2404 .sta_add = ath9k_sta_add,
2405 .sta_remove = ath9k_sta_remove,
2406 .sta_notify = ath9k_sta_notify,
2407 .conf_tx = ath9k_conf_tx,
2408 .bss_info_changed = ath9k_bss_info_changed,
2409 .set_key = ath9k_set_key,
2410 .get_tsf = ath9k_get_tsf,
2411 .set_tsf = ath9k_set_tsf,
2412 .reset_tsf = ath9k_reset_tsf,
2413 .ampdu_action = ath9k_ampdu_action,
2414 .get_survey = ath9k_get_survey,
2415 .rfkill_poll = ath9k_rfkill_poll_state,
2416 .set_coverage_class = ath9k_set_coverage_class,
2417 .flush = ath9k_flush,
2418 .tx_frames_pending = ath9k_tx_frames_pending,
2419 .tx_last_beacon = ath9k_tx_last_beacon,