svn commit: r191983 - in head/sys: dev/usb/wlan modules/usb/upgt
Robert Watson
rwatson at FreeBSD.org
Wed May 13 17:09:43 UTC 2009
On Mon, 11 May 2009, Weongyo Jeong wrote:
> Author: weongyo
> Date: Mon May 11 02:39:49 2009
> New Revision: 191983
> URL: http://svn.freebsd.org/changeset/base/191983
>
> Log:
> ports upgt(4) driver for USB2.
Ah, great! Do you have any similar plans regarding urtw?
Robert N M Watson
Computer Laboratory
University of Cambridge
>
> Added:
> head/sys/dev/usb/wlan/if_upgt.c (contents, props changed)
> head/sys/dev/usb/wlan/if_upgtvar.h (contents, props changed)
> head/sys/modules/usb/upgt/
> head/sys/modules/usb/upgt/Makefile (contents, props changed)
>
> Added: head/sys/dev/usb/wlan/if_upgt.c
> ==============================================================================
> --- /dev/null 00:00:00 1970 (empty, because file is newly added)
> +++ head/sys/dev/usb/wlan/if_upgt.c Mon May 11 02:39:49 2009 (r191983)
> @@ -0,0 +1,2404 @@
> +/* $OpenBSD: if_upgt.c,v 1.35 2008/04/16 18:32:15 damien Exp $ */
> +/* $FreeBSD$ */
> +
> +/*
> + * Copyright (c) 2007 Marcus Glocker <mglocker at openbsd.org>
> + *
> + * Permission to use, copy, modify, and distribute this software for any
> + * purpose with or without fee is hereby granted, provided that the above
> + * copyright notice and this permission notice appear in all copies.
> + *
> + * THE SOFTWARE IS PROVIDED "AS IS" AND THE AUTHOR DISCLAIMS ALL WARRANTIES
> + * WITH REGARD TO THIS SOFTWARE INCLUDING ALL IMPLIED WARRANTIES OF
> + * MERCHANTABILITY AND FITNESS. IN NO EVENT SHALL THE AUTHOR BE LIABLE FOR
> + * ANY SPECIAL, DIRECT, INDIRECT, OR CONSEQUENTIAL DAMAGES OR ANY DAMAGES
> + * WHATSOEVER RESULTING FROM LOSS OF USE, DATA OR PROFITS, WHETHER IN AN
> + * ACTION OF CONTRACT, NEGLIGENCE OR OTHER TORTIOUS ACTION, ARISING OUT OF
> + * OR IN CONNECTION WITH THE USE OR PERFORMANCE OF THIS SOFTWARE.
> + */
> +
> +#include <sys/param.h>
> +#include <sys/systm.h>
> +#include <sys/kernel.h>
> +#include <sys/endian.h>
> +#include <sys/firmware.h>
> +#include <sys/linker.h>
> +#include <sys/mbuf.h>
> +#include <sys/malloc.h>
> +#include <sys/module.h>
> +#include <sys/socket.h>
> +#include <sys/sockio.h>
> +#include <sys/sysctl.h>
> +
> +#include <net/if.h>
> +#include <net/if_arp.h>
> +#include <net/ethernet.h>
> +#include <net/if_dl.h>
> +#include <net/if_media.h>
> +#include <net/if_types.h>
> +
> +#include <sys/bus.h>
> +#include <machine/bus.h>
> +
> +#include <net80211/ieee80211_var.h>
> +#include <net80211/ieee80211_phy.h>
> +#include <net80211/ieee80211_radiotap.h>
> +#include <net80211/ieee80211_regdomain.h>
> +
> +#include <net/bpf.h>
> +
> +#include <dev/usb/usb.h>
> +#include <dev/usb/usb_core.h>
> +#include <dev/usb/usb_busdma.h>
> +#include <dev/usb/usb_debug.h>
> +#include <dev/usb/usb_error.h>
> +#include <dev/usb/usb_lookup.h>
> +#include <dev/usb/usb_util.h>
> +#include "usbdevs.h"
> +
> +#include <dev/usb/wlan/if_upgtvar.h>
> +
> +/*
> + * Driver for the USB PrismGT devices.
> + *
> + * For now just USB 2.0 devices with the GW3887 chipset are supported.
> + * The driver has been written based on the firmware version 2.13.1.0_LM87.
> + *
> + * TODO's:
> + * - MONITOR mode test.
> + * - Add HOSTAP mode.
> + * - Add IBSS mode.
> + * - Support the USB 1.0 devices (NET2280, ISL3880, ISL3886 chipsets).
> + *
> + * Parts of this driver has been influenced by reading the p54u driver
> + * written by Jean-Baptiste Note <jean-baptiste.note at m4x.org> and
> + * Sebastien Bourdeauducq <lekernel at prism54.org>.
> + */
> +
> +SYSCTL_NODE(_hw, OID_AUTO, upgt, CTLFLAG_RD, 0,
> + "USB PrismGT GW3887 driver parameters");
> +
> +#ifdef UPGT_DEBUG
> +int upgt_debug = 0;
> +SYSCTL_INT(_hw_upgt, OID_AUTO, debug, CTLFLAG_RW, &upgt_debug,
> + 0, "control debugging printfs");
> +TUNABLE_INT("hw.upgt.debug", &upgt_debug);
> +enum {
> + UPGT_DEBUG_XMIT = 0x00000001, /* basic xmit operation */
> + UPGT_DEBUG_RECV = 0x00000002, /* basic recv operation */
> + UPGT_DEBUG_RESET = 0x00000004, /* reset processing */
> + UPGT_DEBUG_INTR = 0x00000008, /* INTR */
> + UPGT_DEBUG_TX_PROC = 0x00000010, /* tx ISR proc */
> + UPGT_DEBUG_RX_PROC = 0x00000020, /* rx ISR proc */
> + UPGT_DEBUG_STATE = 0x00000040, /* 802.11 state transitions */
> + UPGT_DEBUG_STAT = 0x00000080, /* statistic */
> + UPGT_DEBUG_FW = 0x00000100, /* firmware */
> + UPGT_DEBUG_ANY = 0xffffffff
> +};
> +#define DPRINTF(sc, m, fmt, ...) do { \
> + if (sc->sc_debug & (m)) \
> + printf(fmt, __VA_ARGS__); \
> +} while (0)
> +#else
> +#define DPRINTF(sc, m, fmt, ...) do { \
> + (void) sc; \
> +} while (0)
> +#endif
> +
> +/*
> + * Prototypes.
> + */
> +static device_probe_t upgt_match;
> +static device_attach_t upgt_attach;
> +static device_detach_t upgt_detach;
> +static int upgt_alloc_tx(struct upgt_softc *);
> +static int upgt_alloc_rx(struct upgt_softc *);
> +static int upgt_device_reset(struct upgt_softc *);
> +static void upgt_bulk_tx(struct upgt_softc *, struct upgt_data *);
> +static int upgt_fw_verify(struct upgt_softc *);
> +static int upgt_mem_init(struct upgt_softc *);
> +static int upgt_fw_load(struct upgt_softc *);
> +static int upgt_fw_copy(const uint8_t *, char *, int);
> +static uint32_t upgt_crc32_le(const void *, size_t);
> +static struct mbuf *
> + upgt_rxeof(struct usb2_xfer *, struct upgt_data *, int *);
> +static struct mbuf *
> + upgt_rx(struct upgt_softc *, uint8_t *, int, int *);
> +static void upgt_txeof(struct usb2_xfer *, struct upgt_data *);
> +static int upgt_eeprom_read(struct upgt_softc *);
> +static int upgt_eeprom_parse(struct upgt_softc *);
> +static void upgt_eeprom_parse_hwrx(struct upgt_softc *, uint8_t *);
> +static void upgt_eeprom_parse_freq3(struct upgt_softc *, uint8_t *, int);
> +static void upgt_eeprom_parse_freq4(struct upgt_softc *, uint8_t *, int);
> +static void upgt_eeprom_parse_freq6(struct upgt_softc *, uint8_t *, int);
> +static uint32_t upgt_chksum_le(const uint32_t *, size_t);
> +static void upgt_tx_done(struct upgt_softc *, uint8_t *);
> +static void upgt_init(void *);
> +static void upgt_init_locked(struct upgt_softc *);
> +static int upgt_ioctl(struct ifnet *, u_long, caddr_t);
> +static void upgt_start(struct ifnet *);
> +static int upgt_raw_xmit(struct ieee80211_node *, struct mbuf *,
> + const struct ieee80211_bpf_params *);
> +static void upgt_scan_start(struct ieee80211com *);
> +static void upgt_scan_end(struct ieee80211com *);
> +static void upgt_set_channel(struct ieee80211com *);
> +static struct ieee80211vap *upgt_vap_create(struct ieee80211com *,
> + const char name[IFNAMSIZ], int unit, int opmode,
> + int flags, const uint8_t bssid[IEEE80211_ADDR_LEN],
> + const uint8_t mac[IEEE80211_ADDR_LEN]);
> +static void upgt_vap_delete(struct ieee80211vap *);
> +static void upgt_update_mcast(struct ifnet *);
> +static uint8_t upgt_rx_rate(struct upgt_softc *, const int);
> +static void upgt_set_multi(void *);
> +static void upgt_stop(struct upgt_softc *);
> +static void upgt_setup_rates(struct ieee80211vap *, struct ieee80211com *);
> +static int upgt_set_macfilter(struct upgt_softc *, uint8_t);
> +static int upgt_newstate(struct ieee80211vap *, enum ieee80211_state, int);
> +static void upgt_set_chan(struct upgt_softc *, struct ieee80211_channel *);
> +static void upgt_set_led(struct upgt_softc *, int);
> +static void upgt_set_led_blink(void *);
> +static void upgt_get_stats(struct upgt_softc *);
> +static void upgt_mem_free(struct upgt_softc *, uint32_t);
> +static uint32_t upgt_mem_alloc(struct upgt_softc *);
> +static void upgt_free_tx(struct upgt_softc *);
> +static void upgt_free_rx(struct upgt_softc *);
> +static void upgt_watchdog(void *);
> +static void upgt_abort_xfers(struct upgt_softc *);
> +static void upgt_abort_xfers_locked(struct upgt_softc *);
> +static void upgt_sysctl_node(struct upgt_softc *);
> +static struct upgt_data *
> + upgt_getbuf(struct upgt_softc *);
> +static struct upgt_data *
> + upgt_gettxbuf(struct upgt_softc *);
> +static int upgt_tx_start(struct upgt_softc *, struct mbuf *,
> + struct ieee80211_node *, struct upgt_data *);
> +
> +static const char *upgt_fwname = "upgt-gw3887";
> +
> +static const struct usb2_device_id upgt_devs_2[] = {
> +#define UPGT_DEV(v,p) { USB_VP(USB_VENDOR_##v, USB_PRODUCT_##v##_##p) }
> + /* version 2 devices */
> + UPGT_DEV(ACCTON, PRISM_GT),
> + UPGT_DEV(BELKIN, F5D7050),
> + UPGT_DEV(CISCOLINKSYS, WUSB54AG),
> + UPGT_DEV(CONCEPTRONIC, PRISM_GT),
> + UPGT_DEV(DELL, PRISM_GT_1),
> + UPGT_DEV(DELL, PRISM_GT_2),
> + UPGT_DEV(FSC, E5400),
> + UPGT_DEV(GLOBESPAN, PRISM_GT_1),
> + UPGT_DEV(GLOBESPAN, PRISM_GT_2),
> + UPGT_DEV(INTERSIL, PRISM_GT),
> + UPGT_DEV(SMC, 2862WG),
> + UPGT_DEV(WISTRONNEWEB, UR045G),
> + UPGT_DEV(XYRATEX, PRISM_GT_1),
> + UPGT_DEV(XYRATEX, PRISM_GT_2),
> + UPGT_DEV(ZCOM, XG703A),
> + UPGT_DEV(ZCOM, XM142)
> +};
> +
> +static usb2_callback_t upgt_bulk_rx_callback;
> +static usb2_callback_t upgt_bulk_tx_callback;
> +
> +static const struct usb2_config upgt_config[UPGT_N_XFERS] = {
> + [UPGT_BULK_TX] = {
> + .type = UE_BULK,
> + .endpoint = UE_ADDR_ANY,
> + .direction = UE_DIR_OUT,
> + .bufsize = MCLBYTES,
> + .flags = {
> + .ext_buffer = 1,
> + .force_short_xfer = 1,
> + .pipe_bof = 1
> + },
> + .callback = upgt_bulk_tx_callback,
> + .timeout = UPGT_USB_TIMEOUT, /* ms */
> + },
> + [UPGT_BULK_RX] = {
> + .type = UE_BULK,
> + .endpoint = UE_ADDR_ANY,
> + .direction = UE_DIR_IN,
> + .bufsize = MCLBYTES,
> + .flags = {
> + .ext_buffer = 1,
> + .pipe_bof = 1,
> + .short_xfer_ok = 1
> + },
> + .callback = upgt_bulk_rx_callback,
> + },
> +};
> +
> +static int
> +upgt_match(device_t dev)
> +{
> + struct usb2_attach_arg *uaa = device_get_ivars(dev);
> +
> + if (uaa->usb2_mode != USB_MODE_HOST)
> + return (ENXIO);
> + if (uaa->info.bConfigIndex != UPGT_CONFIG_INDEX)
> + return (ENXIO);
> + if (uaa->info.bIfaceIndex != UPGT_IFACE_INDEX)
> + return (ENXIO);
> +
> + return (usb2_lookup_id_by_uaa(upgt_devs_2, sizeof(upgt_devs_2), uaa));
> +}
> +
> +static int
> +upgt_attach(device_t dev)
> +{
> + int error;
> + struct ieee80211com *ic;
> + struct ifnet *ifp;
> + struct upgt_softc *sc = device_get_softc(dev);
> + struct usb2_attach_arg *uaa = device_get_ivars(dev);
> + uint8_t bands, iface_index = UPGT_IFACE_INDEX;
> +
> + sc->sc_dev = dev;
> + sc->sc_udev = uaa->device;
> +#ifdef UPGT_DEBUG
> + sc->sc_debug = upgt_debug;
> +#endif
> +
> + mtx_init(&sc->sc_mtx, device_get_nameunit(sc->sc_dev), MTX_NETWORK_LOCK,
> + MTX_DEF);
> + callout_init(&sc->sc_led_ch, 0);
> + callout_init(&sc->sc_watchdog_ch, 0);
> +
> + /* Allocate TX and RX xfers. */
> + error = upgt_alloc_tx(sc);
> + if (error)
> + goto fail1;
> + error = upgt_alloc_rx(sc);
> + if (error)
> + goto fail2;
> +
> + error = usb2_transfer_setup(uaa->device, &iface_index, sc->sc_xfer,
> + upgt_config, UPGT_N_XFERS, sc, &sc->sc_mtx);
> + if (error) {
> + device_printf(dev, "could not allocate USB transfers, "
> + "err=%s\n", usb2_errstr(error));
> + goto fail3;
> + }
> +
> + ifp = sc->sc_ifp = if_alloc(IFT_IEEE80211);
> + if (ifp == NULL) {
> + device_printf(dev, "can not if_alloc()\n");
> + goto fail4;
> + }
> +
> + /* Initialize the device. */
> + error = upgt_device_reset(sc);
> + if (error)
> + goto fail5;
> + /* Verify the firmware. */
> + error = upgt_fw_verify(sc);
> + if (error)
> + goto fail5;
> + /* Calculate device memory space. */
> + if (sc->sc_memaddr_frame_start == 0 || sc->sc_memaddr_frame_end == 0) {
> + device_printf(dev,
> + "could not find memory space addresses on FW!\n");
> + error = EIO;
> + goto fail5;
> + }
> + sc->sc_memaddr_frame_end -= UPGT_MEMSIZE_RX + 1;
> + sc->sc_memaddr_rx_start = sc->sc_memaddr_frame_end + 1;
> +
> + DPRINTF(sc, UPGT_DEBUG_FW, "memory address frame start=0x%08x\n",
> + sc->sc_memaddr_frame_start);
> + DPRINTF(sc, UPGT_DEBUG_FW, "memory address frame end=0x%08x\n",
> + sc->sc_memaddr_frame_end);
> + DPRINTF(sc, UPGT_DEBUG_FW, "memory address rx start=0x%08x\n",
> + sc->sc_memaddr_rx_start);
> +
> + upgt_mem_init(sc);
> +
> + /* Load the firmware. */
> + error = upgt_fw_load(sc);
> + if (error)
> + goto fail5;
> +
> + /* Read the whole EEPROM content and parse it. */
> + error = upgt_eeprom_read(sc);
> + if (error)
> + goto fail5;
> + error = upgt_eeprom_parse(sc);
> + if (error)
> + goto fail5;
> +
> + /* all works related with the device have done here. */
> + upgt_abort_xfers(sc);
> +
> + /* Setup the 802.11 device. */
> + ifp->if_softc = sc;
> + if_initname(ifp, "upgt", device_get_unit(sc->sc_dev));
> + ifp->if_flags = IFF_BROADCAST | IFF_SIMPLEX | IFF_MULTICAST;
> + ifp->if_init = upgt_init;
> + ifp->if_ioctl = upgt_ioctl;
> + ifp->if_start = upgt_start;
> + IFQ_SET_MAXLEN(&ifp->if_snd, IFQ_MAXLEN);
> + IFQ_SET_READY(&ifp->if_snd);
> +
> + ic = ifp->if_l2com;
> + ic->ic_ifp = ifp;
> + ic->ic_phytype = IEEE80211_T_OFDM; /* not only, but not used */
> + ic->ic_opmode = IEEE80211_M_STA;
> + /* set device capabilities */
> + ic->ic_caps =
> + IEEE80211_C_STA /* station mode */
> + | IEEE80211_C_MONITOR /* monitor mode */
> + | IEEE80211_C_SHPREAMBLE /* short preamble supported */
> + | IEEE80211_C_SHSLOT /* short slot time supported */
> + | IEEE80211_C_BGSCAN /* capable of bg scanning */
> + | IEEE80211_C_WPA /* 802.11i */
> + ;
> +
> + bands = 0;
> + setbit(&bands, IEEE80211_MODE_11B);
> + setbit(&bands, IEEE80211_MODE_11G);
> + ieee80211_init_channels(ic, NULL, &bands);
> +
> + ieee80211_ifattach(ic, sc->sc_myaddr);
> + ic->ic_raw_xmit = upgt_raw_xmit;
> + ic->ic_scan_start = upgt_scan_start;
> + ic->ic_scan_end = upgt_scan_end;
> + ic->ic_set_channel = upgt_set_channel;
> +
> + ic->ic_vap_create = upgt_vap_create;
> + ic->ic_vap_delete = upgt_vap_delete;
> + ic->ic_update_mcast = upgt_update_mcast;
> +
> + bpfattach(ifp, DLT_IEEE802_11_RADIO,
> + sizeof(struct ieee80211_frame) + sizeof(sc->sc_txtap));
> + sc->sc_rxtap_len = sizeof(sc->sc_rxtap);
> + sc->sc_rxtap.wr_ihdr.it_len = htole16(sc->sc_rxtap_len);
> + sc->sc_rxtap.wr_ihdr.it_present = htole32(UPGT_RX_RADIOTAP_PRESENT);
> + sc->sc_txtap_len = sizeof(sc->sc_txtap);
> + sc->sc_txtap.wt_ihdr.it_len = htole16(sc->sc_txtap_len);
> + sc->sc_txtap.wt_ihdr.it_present = htole32(UPGT_TX_RADIOTAP_PRESENT);
> +
> + upgt_sysctl_node(sc);
> +
> + if (bootverbose)
> + ieee80211_announce(ic);
> +
> + return (0);
> +
> +fail5: if_free(ifp);
> +fail4: usb2_transfer_unsetup(sc->sc_xfer, UPGT_N_XFERS);
> +fail3: upgt_free_rx(sc);
> +fail2: upgt_free_tx(sc);
> +fail1: mtx_destroy(&sc->sc_mtx);
> +
> + return (error);
> +}
> +
> +static void
> +upgt_txeof(struct usb2_xfer *xfer, struct upgt_data *data)
> +{
> + struct upgt_softc *sc = xfer->priv_sc;
> + struct ifnet *ifp = sc->sc_ifp;
> + struct mbuf *m;
> +
> + UPGT_ASSERT_LOCKED(sc);
> +
> + /*
> + * Do any tx complete callback. Note this must be done before releasing
> + * the node reference.
> + */
> + if (data->m) {
> + m = data->m;
> + if (m->m_flags & M_TXCB) {
> + /* XXX status? */
> + ieee80211_process_callback(data->ni, m, 0);
> + }
> + m_freem(m);
> + data->m = NULL;
> + }
> + if (data->ni) {
> + ieee80211_free_node(data->ni);
> + data->ni = NULL;
> + }
> + ifp->if_opackets++;
> +}
> +
> +static void
> +upgt_get_stats(struct upgt_softc *sc)
> +{
> + struct upgt_data *data_cmd;
> + struct upgt_lmac_mem *mem;
> + struct upgt_lmac_stats *stats;
> +
> + data_cmd = upgt_getbuf(sc);
> + if (data_cmd == NULL) {
> + device_printf(sc->sc_dev, "%s: out of buffer.\n", __func__);
> + return;
> + }
> +
> + /*
> + * Transmit the URB containing the CMD data.
> + */
> + bzero(data_cmd->buf, MCLBYTES);
> +
> + mem = (struct upgt_lmac_mem *)data_cmd->buf;
> + mem->addr = htole32(sc->sc_memaddr_frame_start +
> + UPGT_MEMSIZE_FRAME_HEAD);
> +
> + stats = (struct upgt_lmac_stats *)(mem + 1);
> +
> + stats->header1.flags = 0;
> + stats->header1.type = UPGT_H1_TYPE_CTRL;
> + stats->header1.len = htole16(
> + sizeof(struct upgt_lmac_stats) - sizeof(struct upgt_lmac_header));
> +
> + stats->header2.reqid = htole32(sc->sc_memaddr_frame_start);
> + stats->header2.type = htole16(UPGT_H2_TYPE_STATS);
> + stats->header2.flags = 0;
> +
> + data_cmd->buflen = sizeof(*mem) + sizeof(*stats);
> +
> + mem->chksum = upgt_chksum_le((uint32_t *)stats,
> + data_cmd->buflen - sizeof(*mem));
> +
> + upgt_bulk_tx(sc, data_cmd);
> +}
> +
> +static int
> +upgt_ioctl(struct ifnet *ifp, u_long cmd, caddr_t data)
> +{
> + struct upgt_softc *sc = ifp->if_softc;
> + struct ieee80211com *ic = ifp->if_l2com;
> + struct ifreq *ifr = (struct ifreq *) data;
> + int error = 0, startall = 0;
> +
> + switch (cmd) {
> + case SIOCSIFFLAGS:
> + mtx_lock(&Giant);
> + if (ifp->if_flags & IFF_UP) {
> + if (ifp->if_drv_flags & IFF_DRV_RUNNING) {
> + if ((ifp->if_flags ^ sc->sc_if_flags) &
> + (IFF_ALLMULTI | IFF_PROMISC))
> + upgt_set_multi(sc);
> + } else {
> + upgt_init(sc);
> + startall = 1;
> + }
> + } else {
> + if (ifp->if_drv_flags & IFF_DRV_RUNNING)
> + upgt_stop(sc);
> + }
> + sc->sc_if_flags = ifp->if_flags;
> + if (startall)
> + ieee80211_start_all(ic);
> + mtx_unlock(&Giant);
> + break;
> + case SIOCGIFMEDIA:
> + error = ifmedia_ioctl(ifp, ifr, &ic->ic_media, cmd);
> + break;
> + case SIOCGIFADDR:
> + error = ether_ioctl(ifp, cmd, data);
> + break;
> + default:
> + error = EINVAL;
> + break;
> + }
> + return error;
> +}
> +
> +static void
> +upgt_stop_locked(struct upgt_softc *sc)
> +{
> + struct ifnet *ifp = sc->sc_ifp;
> +
> + UPGT_ASSERT_LOCKED(sc);
> +
> + if (ifp->if_drv_flags & IFF_DRV_RUNNING)
> + upgt_set_macfilter(sc, IEEE80211_S_INIT);
> + upgt_abort_xfers_locked(sc);
> +}
> +
> +static void
> +upgt_stop(struct upgt_softc *sc)
> +{
> + struct ifnet *ifp = sc->sc_ifp;
> +
> + UPGT_LOCK(sc);
> + upgt_stop_locked(sc);
> + UPGT_UNLOCK(sc);
> +
> + /* device down */
> + sc->sc_tx_timer = 0;
> + ifp->if_drv_flags &= ~(IFF_DRV_RUNNING | IFF_DRV_OACTIVE);
> + sc->sc_flags &= ~UPGT_FLAG_INITDONE;
> +}
> +
> +static void
> +upgt_set_led(struct upgt_softc *sc, int action)
> +{
> + struct upgt_data *data_cmd;
> + struct upgt_lmac_mem *mem;
> + struct upgt_lmac_led *led;
> +
> + data_cmd = upgt_getbuf(sc);
> + if (data_cmd == NULL) {
> + device_printf(sc->sc_dev, "%s: out of buffers.\n", __func__);
> + return;
> + }
> +
> + /*
> + * Transmit the URB containing the CMD data.
> + */
> + bzero(data_cmd->buf, MCLBYTES);
> +
> + mem = (struct upgt_lmac_mem *)data_cmd->buf;
> + mem->addr = htole32(sc->sc_memaddr_frame_start +
> + UPGT_MEMSIZE_FRAME_HEAD);
> +
> + led = (struct upgt_lmac_led *)(mem + 1);
> +
> + led->header1.flags = UPGT_H1_FLAGS_TX_NO_CALLBACK;
> + led->header1.type = UPGT_H1_TYPE_CTRL;
> + led->header1.len = htole16(
> + sizeof(struct upgt_lmac_led) -
> + sizeof(struct upgt_lmac_header));
> +
> + led->header2.reqid = htole32(sc->sc_memaddr_frame_start);
> + led->header2.type = htole16(UPGT_H2_TYPE_LED);
> + led->header2.flags = 0;
> +
> + switch (action) {
> + case UPGT_LED_OFF:
> + led->mode = htole16(UPGT_LED_MODE_SET);
> + led->action_fix = 0;
> + led->action_tmp = htole16(UPGT_LED_ACTION_OFF);
> + led->action_tmp_dur = 0;
> + break;
> + case UPGT_LED_ON:
> + led->mode = htole16(UPGT_LED_MODE_SET);
> + led->action_fix = 0;
> + led->action_tmp = htole16(UPGT_LED_ACTION_ON);
> + led->action_tmp_dur = 0;
> + break;
> + case UPGT_LED_BLINK:
> + if (sc->sc_state != IEEE80211_S_RUN) {
> + STAILQ_INSERT_TAIL(&sc->sc_tx_inactive, data_cmd, next);
> + return;
> + }
> + if (sc->sc_led_blink) {
> + /* previous blink was not finished */
> + STAILQ_INSERT_TAIL(&sc->sc_tx_inactive, data_cmd, next);
> + return;
> + }
> + led->mode = htole16(UPGT_LED_MODE_SET);
> + led->action_fix = htole16(UPGT_LED_ACTION_OFF);
> + led->action_tmp = htole16(UPGT_LED_ACTION_ON);
> + led->action_tmp_dur = htole16(UPGT_LED_ACTION_TMP_DUR);
> + /* lock blink */
> + sc->sc_led_blink = 1;
> + callout_reset(&sc->sc_led_ch, hz, upgt_set_led_blink, sc);
> + break;
> + default:
> + STAILQ_INSERT_TAIL(&sc->sc_tx_inactive, data_cmd, next);
> + return;
> + }
> +
> + data_cmd->buflen = sizeof(*mem) + sizeof(*led);
> +
> + mem->chksum = upgt_chksum_le((uint32_t *)led,
> + data_cmd->buflen - sizeof(*mem));
> +
> + upgt_bulk_tx(sc, data_cmd);
> +}
> +
> +static void
> +upgt_set_led_blink(void *arg)
> +{
> + struct upgt_softc *sc = arg;
> +
> + /* blink finished, we are ready for a next one */
> + sc->sc_led_blink = 0;
> +}
> +
> +static void
> +upgt_init(void *priv)
> +{
> + struct upgt_softc *sc = priv;
> + struct ifnet *ifp = sc->sc_ifp;
> + struct ieee80211com *ic = ifp->if_l2com;
> +
> + UPGT_LOCK(sc);
> + upgt_init_locked(sc);
> + UPGT_UNLOCK(sc);
> +
> + if (ifp->if_drv_flags & IFF_DRV_RUNNING)
> + ieee80211_start_all(ic); /* start all vap's */
> +}
> +
> +static void
> +upgt_init_locked(struct upgt_softc *sc)
> +{
> + struct ifnet *ifp = sc->sc_ifp;
> +
> + UPGT_ASSERT_LOCKED(sc);
> +
> + if (ifp->if_drv_flags & IFF_DRV_RUNNING)
> + upgt_stop_locked(sc);
> +
> + usb2_transfer_start(sc->sc_xfer[UPGT_BULK_RX]);
> +
> + (void)upgt_set_macfilter(sc, IEEE80211_S_SCAN);
> +
> + ifp->if_drv_flags &= ~IFF_DRV_OACTIVE;
> + ifp->if_drv_flags |= IFF_DRV_RUNNING;
> + sc->sc_flags |= UPGT_FLAG_INITDONE;
> +
> + callout_reset(&sc->sc_watchdog_ch, hz, upgt_watchdog, sc);
> +}
> +
> +static int
> +upgt_set_macfilter(struct upgt_softc *sc, uint8_t state)
> +{
> + struct ifnet *ifp = sc->sc_ifp;
> + struct ieee80211com *ic = ifp->if_l2com;
> + struct ieee80211vap *vap = TAILQ_FIRST(&ic->ic_vaps);
> + struct ieee80211_node *ni = vap->iv_bss;
> + struct upgt_data *data_cmd;
> + struct upgt_lmac_mem *mem;
> + struct upgt_lmac_filter *filter;
> + uint8_t broadcast[] = { 0xff, 0xff, 0xff, 0xff, 0xff, 0xff };
> +
> + UPGT_ASSERT_LOCKED(sc);
> +
> + data_cmd = upgt_getbuf(sc);
> + if (data_cmd == NULL) {
> + device_printf(sc->sc_dev, "out of TX buffers.\n");
> + return (ENOBUFS);
> + }
> +
> + /*
> + * Transmit the URB containing the CMD data.
> + */
> + bzero(data_cmd->buf, MCLBYTES);
> +
> + mem = (struct upgt_lmac_mem *)data_cmd->buf;
> + mem->addr = htole32(sc->sc_memaddr_frame_start +
> + UPGT_MEMSIZE_FRAME_HEAD);
> +
> + filter = (struct upgt_lmac_filter *)(mem + 1);
> +
> + filter->header1.flags = UPGT_H1_FLAGS_TX_NO_CALLBACK;
> + filter->header1.type = UPGT_H1_TYPE_CTRL;
> + filter->header1.len = htole16(
> + sizeof(struct upgt_lmac_filter) -
> + sizeof(struct upgt_lmac_header));
> +
> + filter->header2.reqid = htole32(sc->sc_memaddr_frame_start);
> + filter->header2.type = htole16(UPGT_H2_TYPE_MACFILTER);
> + filter->header2.flags = 0;
> +
> + switch (state) {
> + case IEEE80211_S_INIT:
> + DPRINTF(sc, UPGT_DEBUG_STATE, "%s: set MAC filter to INIT\n",
> + __func__);
> + filter->type = htole16(UPGT_FILTER_TYPE_RESET);
> + break;
> + case IEEE80211_S_SCAN:
> + DPRINTF(sc, UPGT_DEBUG_STATE,
> + "set MAC filter to SCAN (bssid %s)\n",
> + ether_sprintf(broadcast));
> + filter->type = htole16(UPGT_FILTER_TYPE_NONE);
> + IEEE80211_ADDR_COPY(filter->dst, sc->sc_myaddr);
> + IEEE80211_ADDR_COPY(filter->src, broadcast);
> + filter->unknown1 = htole16(UPGT_FILTER_UNKNOWN1);
> + filter->rxaddr = htole32(sc->sc_memaddr_rx_start);
> + filter->unknown2 = htole16(UPGT_FILTER_UNKNOWN2);
> + filter->rxhw = htole32(sc->sc_eeprom_hwrx);
> + filter->unknown3 = htole16(UPGT_FILTER_UNKNOWN3);
> + break;
> + case IEEE80211_S_RUN:
> + /* XXX monitor mode isn't tested yet. */
> + if (vap->iv_opmode == IEEE80211_M_MONITOR) {
> + filter->type = htole16(UPGT_FILTER_TYPE_MONITOR);
> + IEEE80211_ADDR_COPY(filter->dst, sc->sc_myaddr);
> + IEEE80211_ADDR_COPY(filter->src, ni->ni_bssid);
> + filter->unknown1 = htole16(UPGT_FILTER_MONITOR_UNKNOWN1);
> + filter->rxaddr = htole32(sc->sc_memaddr_rx_start);
> + filter->unknown2 = htole16(UPGT_FILTER_MONITOR_UNKNOWN2);
> + filter->rxhw = htole32(sc->sc_eeprom_hwrx);
> + filter->unknown3 = htole16(UPGT_FILTER_MONITOR_UNKNOWN3);
> + } else {
> + DPRINTF(sc, UPGT_DEBUG_STATE,
> + "set MAC filter to RUN (bssid %s)\n",
> + ether_sprintf(ni->ni_bssid));
> + filter->type = htole16(UPGT_FILTER_TYPE_STA);
> + IEEE80211_ADDR_COPY(filter->dst, sc->sc_myaddr);
> + IEEE80211_ADDR_COPY(filter->src, ni->ni_bssid);
> + filter->unknown1 = htole16(UPGT_FILTER_UNKNOWN1);
> + filter->rxaddr = htole32(sc->sc_memaddr_rx_start);
> + filter->unknown2 = htole16(UPGT_FILTER_UNKNOWN2);
> + filter->rxhw = htole32(sc->sc_eeprom_hwrx);
> + filter->unknown3 = htole16(UPGT_FILTER_UNKNOWN3);
> + }
> + break;
> + default:
> + device_printf(sc->sc_dev,
> + "MAC filter does not know that state!\n");
> + break;
> + }
> +
> + data_cmd->buflen = sizeof(*mem) + sizeof(*filter);
> +
> + mem->chksum = upgt_chksum_le((uint32_t *)filter,
> + data_cmd->buflen - sizeof(*mem));
> +
> + upgt_bulk_tx(sc, data_cmd);
> +
> + return (0);
> +}
> +
> +static void
> +upgt_setup_rates(struct ieee80211vap *vap, struct ieee80211com *ic)
> +{
> + struct ifnet *ifp = ic->ic_ifp;
> + struct upgt_softc *sc = ifp->if_softc;
> + const struct ieee80211_txparam *tp;
> +
> + /*
> + * 0x01 = OFMD6 0x10 = DS1
> + * 0x04 = OFDM9 0x11 = DS2
> + * 0x06 = OFDM12 0x12 = DS5
> + * 0x07 = OFDM18 0x13 = DS11
> + * 0x08 = OFDM24
> + * 0x09 = OFDM36
> + * 0x0a = OFDM48
> + * 0x0b = OFDM54
> + */
> + const uint8_t rateset_auto_11b[] =
> + { 0x13, 0x13, 0x12, 0x11, 0x11, 0x10, 0x10, 0x10 };
> + const uint8_t rateset_auto_11g[] =
> + { 0x0b, 0x0a, 0x09, 0x08, 0x07, 0x06, 0x04, 0x01 };
> + const uint8_t rateset_fix_11bg[] =
> + { 0x10, 0x11, 0x12, 0x13, 0x01, 0x04, 0x06, 0x07,
> + 0x08, 0x09, 0x0a, 0x0b };
> +
> + tp = &vap->iv_txparms[ieee80211_chan2mode(ic->ic_curchan)];
> +
> + /* XXX */
> + if (tp->ucastrate == IEEE80211_FIXED_RATE_NONE) {
> + /*
> + * Automatic rate control is done by the device.
> + * We just pass the rateset from which the device
> + * will pickup a rate.
> + */
> + if (ic->ic_curmode == IEEE80211_MODE_11B)
> + bcopy(rateset_auto_11b, sc->sc_cur_rateset,
> + sizeof(sc->sc_cur_rateset));
> + if (ic->ic_curmode == IEEE80211_MODE_11G ||
> + ic->ic_curmode == IEEE80211_MODE_AUTO)
> + bcopy(rateset_auto_11g, sc->sc_cur_rateset,
> + sizeof(sc->sc_cur_rateset));
> + } else {
> + /* set a fixed rate */
> + memset(sc->sc_cur_rateset, rateset_fix_11bg[tp->ucastrate],
> + sizeof(sc->sc_cur_rateset));
> + }
> +}
> +
> +static void
> +upgt_set_multi(void *arg)
> +{
> + struct upgt_softc *sc = arg;
> + struct ifnet *ifp = sc->sc_ifp;
> +
> + if (!(ifp->if_flags & IFF_UP))
> + return;
> +
> + /*
> + * XXX don't know how to set a device. Lack of docs. Just try to set
> + * IFF_ALLMULTI flag here.
> + */
> + IF_ADDR_LOCK(ifp);
> + ifp->if_flags |= IFF_ALLMULTI;
> + IF_ADDR_UNLOCK(ifp);
> +}
> +
> +static void
> +upgt_start(struct ifnet *ifp)
> +{
> + struct upgt_softc *sc = ifp->if_softc;
> + struct upgt_data *data_tx;
> + struct ieee80211_node *ni;
> + struct mbuf *m;
> +
> + if ((ifp->if_drv_flags & IFF_DRV_RUNNING) == 0)
> + return;
> +
> + UPGT_LOCK(sc);
> + for (;;) {
> + IFQ_DRV_DEQUEUE(&ifp->if_snd, m);
> + if (m == NULL)
> + break;
> +
> + data_tx = upgt_gettxbuf(sc);
> + if (data_tx == NULL) {
> + IFQ_DRV_PREPEND(&ifp->if_snd, m);
> + break;
> + }
> +
> + ni = (struct ieee80211_node *)m->m_pkthdr.rcvif;
> + m->m_pkthdr.rcvif = NULL;
> +
> + if (upgt_tx_start(sc, m, ni, data_tx) != 0) {
> + STAILQ_INSERT_HEAD(&sc->sc_tx_inactive, data_tx, next);
> + UPGT_STAT_INC(sc, st_tx_inactive);
> + ieee80211_free_node(ni);
> + ifp->if_oerrors++;
> + continue;
> + }
> + sc->sc_tx_timer = 5;
> + }
> + UPGT_UNLOCK(sc);
> +}
> +
> +static int
> +upgt_raw_xmit(struct ieee80211_node *ni, struct mbuf *m,
> + const struct ieee80211_bpf_params *params)
> +{
> + struct ieee80211com *ic = ni->ni_ic;
> + struct ifnet *ifp = ic->ic_ifp;
> + struct upgt_softc *sc = ifp->if_softc;
> + struct upgt_data *data_tx = NULL;
> +
> + /* prevent management frames from being sent if we're not ready */
> + if (!(ifp->if_drv_flags & IFF_DRV_RUNNING)) {
> + m_freem(m);
> + ieee80211_free_node(ni);
> + return ENETDOWN;
> + }
> +
> + UPGT_LOCK(sc);
> + data_tx = upgt_gettxbuf(sc);
> + if (data_tx == NULL) {
> + ieee80211_free_node(ni);
> + m_freem(m);
> + UPGT_UNLOCK(sc);
> + return (ENOBUFS);
> + }
> +
> + if (upgt_tx_start(sc, m, ni, data_tx) != 0) {
> + STAILQ_INSERT_HEAD(&sc->sc_tx_inactive, data_tx, next);
> + UPGT_STAT_INC(sc, st_tx_inactive);
> + ieee80211_free_node(ni);
> + ifp->if_oerrors++;
> + UPGT_UNLOCK(sc);
> + return (EIO);
> + }
> + UPGT_UNLOCK(sc);
> +
> + sc->sc_tx_timer = 5;
> + return (0);
> +}
> +
> +static void
> +upgt_watchdog(void *arg)
> +{
> + struct upgt_softc *sc = arg;
> + struct ifnet *ifp = sc->sc_ifp;
> +
> + if (sc->sc_tx_timer > 0) {
> + if (--sc->sc_tx_timer == 0) {
> + device_printf(sc->sc_dev, "watchdog timeout\n");
> + /* upgt_init(ifp); XXX needs a process context ? */
> + ifp->if_oerrors++;
> + return;
> + }
> + callout_reset(&sc->sc_watchdog_ch, hz, upgt_watchdog, sc);
> + }
> +}
> +
> +static uint32_t
> +upgt_mem_alloc(struct upgt_softc *sc)
> +{
> + int i;
> +
> + for (i = 0; i < sc->sc_memory.pages; i++) {
> + if (sc->sc_memory.page[i].used == 0) {
> + sc->sc_memory.page[i].used = 1;
> + return (sc->sc_memory.page[i].addr);
> + }
> + }
> +
> + return (0);
> +}
> +
> +static void
> +upgt_scan_start(struct ieee80211com *ic)
> +{
> + /* do nothing. */
> +}
> +
> +static void
> +upgt_scan_end(struct ieee80211com *ic)
> +{
> + /* do nothing. */
> +}
> +
> +static void
> +upgt_set_channel(struct ieee80211com *ic)
> +{
> + struct upgt_softc *sc = ic->ic_ifp->if_softc;
> +
> + UPGT_LOCK(sc);
> + upgt_set_chan(sc, ic->ic_curchan);
> + UPGT_UNLOCK(sc);
> +}
> +
> +static void
> +upgt_set_chan(struct upgt_softc *sc, struct ieee80211_channel *c)
> +{
> + struct ifnet *ifp = sc->sc_ifp;
> + struct ieee80211com *ic = ifp->if_l2com;
> + struct upgt_data *data_cmd;
> + struct upgt_lmac_mem *mem;
> + struct upgt_lmac_channel *chan;
> + int channel;
> +
> + UPGT_ASSERT_LOCKED(sc);
> +
> + channel = ieee80211_chan2ieee(ic, c);
> + if (channel == 0 || channel == IEEE80211_CHAN_ANY) {
> + /* XXX should NEVER happen */
> + device_printf(sc->sc_dev,
> + "%s: invalid channel %x\n", __func__, channel);
> + return;
> + }
> +
> + DPRINTF(sc, UPGT_DEBUG_STATE, "%s: channel %d\n", __func__, channel);
> +
> + data_cmd = upgt_getbuf(sc);
> + if (data_cmd == NULL) {
> + device_printf(sc->sc_dev, "%s: out of buffers.\n", __func__);
> + return;
> + }
> + /*
> + * Transmit the URB containing the CMD data.
> + */
> + bzero(data_cmd->buf, MCLBYTES);
> +
> + mem = (struct upgt_lmac_mem *)data_cmd->buf;
> + mem->addr = htole32(sc->sc_memaddr_frame_start +
> + UPGT_MEMSIZE_FRAME_HEAD);
> +
> + chan = (struct upgt_lmac_channel *)(mem + 1);
> +
> + chan->header1.flags = UPGT_H1_FLAGS_TX_NO_CALLBACK;
> + chan->header1.type = UPGT_H1_TYPE_CTRL;
> + chan->header1.len = htole16(
> + sizeof(struct upgt_lmac_channel) - sizeof(struct upgt_lmac_header));
> +
>
> *** DIFF OUTPUT TRUNCATED AT 1000 LINES ***
>
More information about the svn-src-all
mailing list