| /Linux-v5.4/drivers/md/ | 
| D | dm-raid.c | 254 static void rs_config_backup(struct raid_set *rs, struct rs_layout *l)  in rs_config_backup()  argument256 	struct mddev *mddev = &rs->md;  in rs_config_backup()
 263 static void rs_config_restore(struct raid_set *rs, struct rs_layout *l)  in rs_config_restore()  argument
 265 	struct mddev *mddev = &rs->md;  in rs_config_restore()
 394 static bool rs_is_raid0(struct raid_set *rs)  in rs_is_raid0()  argument
 396 	return !rs->md.level;  in rs_is_raid0()
 400 static bool rs_is_raid1(struct raid_set *rs)  in rs_is_raid1()  argument
 402 	return rs->md.level == 1;  in rs_is_raid1()
 406 static bool rs_is_raid10(struct raid_set *rs)  in rs_is_raid10()  argument
 408 	return rs->md.level == 10;  in rs_is_raid10()
 [all …]
 
 | 
| /Linux-v5.4/lib/reed_solomon/ | 
| D | reed_solomon.c | 74 	struct rs_codec *rs;  in codec_init()  local76 	rs = kzalloc(sizeof(*rs), gfp);  in codec_init()
 77 	if (!rs)  in codec_init()
 80 	INIT_LIST_HEAD(&rs->list);  in codec_init()
 82 	rs->mm = symsize;  in codec_init()
 83 	rs->nn = (1 << symsize) - 1;  in codec_init()
 84 	rs->fcr = fcr;  in codec_init()
 85 	rs->prim = prim;  in codec_init()
 86 	rs->nroots = nroots;  in codec_init()
 87 	rs->gfpoly = gfpoly;  in codec_init()
 [all …]
 
 | 
| D | test_rslib.c | 108 static struct wspace *alloc_ws(struct rs_codec *rs)  in alloc_ws()  argument110 	int nroots = rs->nroots;  in alloc_ws()
 112 	int nn = rs->nn;  in alloc_ws()
 151 static int get_rcw_we(struct rs_control *rs, struct wspace *ws,  in get_rcw_we()  argument
 154 	int nroots = rs->codec->nroots;  in get_rcw_we()
 158 	int nn = rs->codec->nn;  in get_rcw_we()
 170 	encode_rs16(rs, c, dlen, c + dlen, 0);  in get_rcw_we()
 232 	struct rs_codec *rs = rsc->codec;  in compute_syndrome()  local
 233 	uint16_t *alpha_to = rs->alpha_to;  in compute_syndrome()
 234 	uint16_t *index_of = rs->index_of;  in compute_syndrome()
 [all …]
 
 | 
| D | decode_rs.c | 13 	struct rs_codec *rs = rsc->codec;  variable16 	int nn = rs->nn;
 17 	int nroots = rs->nroots;
 18 	int fcr = rs->fcr;
 19 	int prim = rs->prim;
 20 	int iprim = rs->iprim;
 21 	uint16_t *alpha_to = rs->alpha_to;
 22 	uint16_t *index_of = rs->index_of;
 26 	uint16_t msk = (uint16_t) rs->nn;
 72 					alpha_to[rs_modnn(rs, index_of[syn[i]] +
 [all …]
 
 | 
| D | encode_rs.c | 13 	struct rs_codec *rs = rsc->codec;  variable15 	int nn = rs->nn;
 16 	int nroots = rs->nroots;
 17 	uint16_t *alpha_to = rs->alpha_to;
 18 	uint16_t *index_of = rs->index_of;
 19 	uint16_t *genpoly = rs->genpoly;
 21 	uint16_t msk = (uint16_t) rs->nn;
 33 				par[j] ^= alpha_to[rs_modnn(rs, fb +
 40 			par[nroots - 1] = alpha_to[rs_modnn(rs,
 
 | 
| /Linux-v5.4/drivers/spi/ | 
| D | spi-rockchip.c | 188 static inline void spi_enable_chip(struct rockchip_spi *rs, bool enable)  in spi_enable_chip()  argument190 	writel_relaxed((enable ? 1U : 0U), rs->regs + ROCKCHIP_SPI_SSIENR);  in spi_enable_chip()
 193 static inline void wait_for_idle(struct rockchip_spi *rs)  in wait_for_idle()  argument
 198 		if (!(readl_relaxed(rs->regs + ROCKCHIP_SPI_SR) & SR_BUSY))  in wait_for_idle()
 202 	dev_warn(rs->dev, "spi controller is in busy state!\n");  in wait_for_idle()
 205 static u32 get_fifo_len(struct rockchip_spi *rs)  in get_fifo_len()  argument
 210 		writel_relaxed(fifo, rs->regs + ROCKCHIP_SPI_TXFTLR);  in get_fifo_len()
 211 		if (fifo != readl_relaxed(rs->regs + ROCKCHIP_SPI_TXFTLR))  in get_fifo_len()
 215 	writel_relaxed(0, rs->regs + ROCKCHIP_SPI_TXFTLR);  in get_fifo_len()
 223 	struct rockchip_spi *rs = spi_master_get_devdata(master);  in rockchip_spi_set_cs()  local
 [all …]
 
 | 
| D | spi-mt7621.c | 67 static inline u32 mt7621_spi_read(struct mt7621_spi *rs, u32 reg)  in mt7621_spi_read()  argument69 	return ioread32(rs->base + reg);  in mt7621_spi_read()
 72 static inline void mt7621_spi_write(struct mt7621_spi *rs, u32 reg, u32 val)  in mt7621_spi_write()  argument
 74 	iowrite32(val, rs->base + reg);  in mt7621_spi_write()
 79 	struct mt7621_spi *rs = spidev_to_mt7621_spi(spi);  in mt7621_spi_set_cs()  local
 89 	master = mt7621_spi_read(rs, MT7621_SPI_MASTER);  in mt7621_spi_set_cs()
 92 	mt7621_spi_write(rs, MT7621_SPI_MASTER, master);  in mt7621_spi_set_cs()
 94 	rs->pending_write = 0;  in mt7621_spi_set_cs()
 98 	mt7621_spi_write(rs, MT7621_SPI_POLAR, polar);  in mt7621_spi_set_cs()
 103 	struct mt7621_spi *rs = spidev_to_mt7621_spi(spi);  in mt7621_spi_prepare()  local
 [all …]
 
 | 
| /Linux-v5.4/net/rds/ | 
| D | af_rds.c | 62 	struct rds_sock *rs;  in rds_release()  local67 	rs = rds_sk_to_rs(sk);  in rds_release()
 73 	rds_clear_recv_queue(rs);  in rds_release()
 74 	rds_cong_remove_socket(rs);  in rds_release()
 76 	rds_remove_bound(rs);  in rds_release()
 78 	rds_send_drop_to(rs, NULL);  in rds_release()
 79 	rds_rdma_drop_keys(rs);  in rds_release()
 80 	rds_notify_queue_get(rs, NULL);  in rds_release()
 81 	rds_notify_msg_zcopy_purge(&rs->rs_zcookie_queue);  in rds_release()
 84 	list_del_init(&rs->rs_item);  in rds_release()
 [all …]
 
 | 
| D | bind.c | 76 	struct rds_sock *rs;  in rds_find_bound()  local80 	rs = rhashtable_lookup(&bind_hash_table, key, ht_parms);  in rds_find_bound()
 81 	if (rs && (sock_flag(rds_rs_to_sk(rs), SOCK_DEAD) ||  in rds_find_bound()
 82 		   !refcount_inc_not_zero(&rds_rs_to_sk(rs)->sk_refcnt)))  in rds_find_bound()
 83 		rs = NULL;  in rds_find_bound()
 87 	rdsdebug("returning rs %p for %pI6c:%u\n", rs, addr,  in rds_find_bound()
 90 	return rs;  in rds_find_bound()
 94 static int rds_add_bound(struct rds_sock *rs, const struct in6_addr *addr,  in rds_add_bound()  argument
 122 		memcpy(rs->rs_bound_key, key, sizeof(rs->rs_bound_key));  in rds_add_bound()
 123 		rs->rs_bound_addr = *addr;  in rds_add_bound()
 [all …]
 
 | 
| D | recv.c | 87 static void rds_recv_rcvbuf_delta(struct rds_sock *rs, struct sock *sk,  in rds_recv_rcvbuf_delta()  argument96 	rs->rs_rcv_bytes += delta;  in rds_recv_rcvbuf_delta()
 103 	if (rs->rs_transport->t_type == RDS_TRANS_LOOP)  in rds_recv_rcvbuf_delta()
 106 	now_congested = rs->rs_rcv_bytes > rds_sk_rcvbuf(rs);  in rds_recv_rcvbuf_delta()
 110 	  rs, &rs->rs_bound_addr,  in rds_recv_rcvbuf_delta()
 111 	  ntohs(rs->rs_bound_port), rs->rs_rcv_bytes,  in rds_recv_rcvbuf_delta()
 112 	  rds_sk_rcvbuf(rs), now_congested, delta);  in rds_recv_rcvbuf_delta()
 115 	if (!rs->rs_congested && now_congested) {  in rds_recv_rcvbuf_delta()
 116 		rs->rs_congested = 1;  in rds_recv_rcvbuf_delta()
 123 	else if (rs->rs_congested && (rs->rs_rcv_bytes < (rds_sk_rcvbuf(rs)/2))) {  in rds_recv_rcvbuf_delta()
 [all …]
 
 | 
| D | send.c | 473 static void rds_send_sndbuf_remove(struct rds_sock *rs, struct rds_message *rm)  in rds_send_sndbuf_remove()  argument477 	assert_spin_locked(&rs->rs_lock);  in rds_send_sndbuf_remove()
 479 	BUG_ON(rs->rs_snd_bytes < len);  in rds_send_sndbuf_remove()
 480 	rs->rs_snd_bytes -= len;  in rds_send_sndbuf_remove()
 482 	if (rs->rs_snd_bytes == 0)  in rds_send_sndbuf_remove()
 502 	struct rds_sock *rs = NULL;  in rds_rdma_send_complete()  local
 513 		rs = rm->m_rs;  in rds_rdma_send_complete()
 514 		sock_hold(rds_rs_to_sk(rs));  in rds_rdma_send_complete()
 517 		spin_lock(&rs->rs_lock);  in rds_rdma_send_complete()
 518 		list_add_tail(¬ifier->n_list, &rs->rs_notify_queue);  in rds_rdma_send_complete()
 [all …]
 
 | 
| D | rdma.c | 97 	struct rds_sock *rs = mr->r_sock;  in rds_destroy_mr()  local107 	spin_lock_irqsave(&rs->rs_rdma_lock, flags);  in rds_destroy_mr()
 109 		rb_erase(&mr->r_rb_node, &rs->rs_rdma_keys);  in rds_destroy_mr()
 112 	spin_unlock_irqrestore(&rs->rs_rdma_lock, flags);  in rds_destroy_mr()
 128 void rds_rdma_drop_keys(struct rds_sock *rs)  in rds_rdma_drop_keys()  argument
 135 	spin_lock_irqsave(&rs->rs_rdma_lock, flags);  in rds_rdma_drop_keys()
 136 	while ((node = rb_first(&rs->rs_rdma_keys))) {  in rds_rdma_drop_keys()
 138 		if (mr->r_trans == rs->rs_transport)  in rds_rdma_drop_keys()
 140 		rb_erase(&mr->r_rb_node, &rs->rs_rdma_keys);  in rds_rdma_drop_keys()
 142 		spin_unlock_irqrestore(&rs->rs_rdma_lock, flags);  in rds_rdma_drop_keys()
 [all …]
 
 | 
| D | cong.c | 266 		struct rds_sock *rs;  in rds_cong_map_updated()  local269 		list_for_each_entry(rs, &rds_cong_monitor, rs_cong_list) {  in rds_cong_map_updated()
 270 			spin_lock(&rs->rs_lock);  in rds_cong_map_updated()
 271 			rs->rs_cong_notify |= (rs->rs_cong_mask & portmask);  in rds_cong_map_updated()
 272 			rs->rs_cong_mask &= ~portmask;  in rds_cong_map_updated()
 273 			spin_unlock(&rs->rs_lock);  in rds_cong_map_updated()
 274 			if (rs->rs_cong_notify)  in rds_cong_map_updated()
 275 				rds_wake_sk_sleep(rs);  in rds_cong_map_updated()
 338 void rds_cong_add_socket(struct rds_sock *rs)  in rds_cong_add_socket()  argument
 343 	if (list_empty(&rs->rs_cong_list))  in rds_cong_add_socket()
 [all …]
 
 | 
| /Linux-v5.4/fs/jffs2/ | 
| D | compr_rubin.c | 88 static void init_rubin(struct rubin_state *rs, int div, int *bits)  in init_rubin()  argument92 	rs->q = 0;  in init_rubin()
 93 	rs->p = (long) (2 * UPPER_BIT_RUBIN);  in init_rubin()
 94 	rs->bit_number = (long) 0;  in init_rubin()
 95 	rs->bit_divider = div;  in init_rubin()
 98 		rs->bits[c] = bits[c];  in init_rubin()
 102 static int encode(struct rubin_state *rs, long A, long B, int symbol)  in encode()  argument
 108 	while ((rs->q >= UPPER_BIT_RUBIN) ||  in encode()
 109 	       ((rs->p + rs->q) <= UPPER_BIT_RUBIN)) {  in encode()
 110 		rs->bit_number++;  in encode()
 [all …]
 
 | 
| /Linux-v5.4/fs/isofs/ | 
| D | rock.c | 54 			struct inode *inode, struct rock_state *rs)  in setup_rock_ridge()  argument56 	rs->len = sizeof(struct iso_directory_record) + de->name_len[0];  in setup_rock_ridge()
 57 	if (rs->len & 1)  in setup_rock_ridge()
 58 		(rs->len)++;  in setup_rock_ridge()
 59 	rs->chr = (unsigned char *)de + rs->len;  in setup_rock_ridge()
 60 	rs->len = *((unsigned char *)de) - rs->len;  in setup_rock_ridge()
 61 	if (rs->len < 0)  in setup_rock_ridge()
 62 		rs->len = 0;  in setup_rock_ridge()
 65 		rs->len -= ISOFS_SB(inode->i_sb)->s_rock_offset;  in setup_rock_ridge()
 66 		rs->chr += ISOFS_SB(inode->i_sb)->s_rock_offset;  in setup_rock_ridge()
 [all …]
 
 | 
| /Linux-v5.4/lib/ | 
| D | ratelimit.c | 27 int ___ratelimit(struct ratelimit_state *rs, const char *func)  in ___ratelimit()  argument32 	if (!rs->interval)  in ___ratelimit()
 41 	if (!raw_spin_trylock_irqsave(&rs->lock, flags))  in ___ratelimit()
 44 	if (!rs->begin)  in ___ratelimit()
 45 		rs->begin = jiffies;  in ___ratelimit()
 47 	if (time_is_before_jiffies(rs->begin + rs->interval)) {  in ___ratelimit()
 48 		if (rs->missed) {  in ___ratelimit()
 49 			if (!(rs->flags & RATELIMIT_MSG_ON_RELEASE)) {  in ___ratelimit()
 52 						func, rs->missed);  in ___ratelimit()
 53 				rs->missed = 0;  in ___ratelimit()
 [all …]
 
 | 
| /Linux-v5.4/net/ipv4/ | 
| D | tcp_rate.c | 79 			    struct rate_sample *rs)  in tcp_rate_skb_delivered()  argument87 	if (!rs->prior_delivered ||  in tcp_rate_skb_delivered()
 88 	    after(scb->tx.delivered, rs->prior_delivered)) {  in tcp_rate_skb_delivered()
 89 		rs->prior_delivered  = scb->tx.delivered;  in tcp_rate_skb_delivered()
 90 		rs->prior_mstamp     = scb->tx.delivered_mstamp;  in tcp_rate_skb_delivered()
 91 		rs->is_app_limited   = scb->tx.is_app_limited;  in tcp_rate_skb_delivered()
 92 		rs->is_retrans	     = scb->sacked & TCPCB_RETRANS;  in tcp_rate_skb_delivered()
 97 		rs->interval_us = tcp_stamp_us_delta(tp->first_tx_mstamp,  in tcp_rate_skb_delivered()
 111 		  bool is_sack_reneg, struct rate_sample *rs)  in tcp_rate_gen()  argument
 127 	rs->acked_sacked = delivered;	/* freshly ACKed or SACKed */  in tcp_rate_gen()
 [all …]
 
 | 
| /Linux-v5.4/lib/crypto/ | 
| D | des.c | 65 static const u8 rs[256] = {  variable634 	pe[15 * 2 + 0] = DES_PC2(a, b, c, d); d = rs[d];  in des_ekey()
 635 	pe[14 * 2 + 0] = DES_PC2(d, a, b, c); c = rs[c]; b = rs[b];  in des_ekey()
 636 	pe[13 * 2 + 0] = DES_PC2(b, c, d, a); a = rs[a]; d = rs[d];  in des_ekey()
 637 	pe[12 * 2 + 0] = DES_PC2(d, a, b, c); c = rs[c]; b = rs[b];  in des_ekey()
 638 	pe[11 * 2 + 0] = DES_PC2(b, c, d, a); a = rs[a]; d = rs[d];  in des_ekey()
 639 	pe[10 * 2 + 0] = DES_PC2(d, a, b, c); c = rs[c]; b = rs[b];  in des_ekey()
 640 	pe[ 9 * 2 + 0] = DES_PC2(b, c, d, a); a = rs[a]; d = rs[d];  in des_ekey()
 641 	pe[ 8 * 2 + 0] = DES_PC2(d, a, b, c); c = rs[c];  in des_ekey()
 642 	pe[ 7 * 2 + 0] = DES_PC2(c, d, a, b); b = rs[b]; a = rs[a];  in des_ekey()
 [all …]
 
 | 
| /Linux-v5.4/arch/mips/include/asm/ | 
| D | uasm.h | 200 void UASM_i_LA_mostly(u32 **buf, unsigned int rs, long addr);201 void UASM_i_LA(u32 **buf, unsigned int rs, long addr);
 211 # define UASM_i_ADDIU(buf, rs, rt, val) uasm_i_daddiu(buf, rs, rt, val)  argument
 212 # define UASM_i_ADDU(buf, rs, rt, rd) uasm_i_daddu(buf, rs, rt, rd)  argument
 213 # define UASM_i_LL(buf, rs, rt, off) uasm_i_lld(buf, rs, rt, off)  argument
 214 # define UASM_i_LW(buf, rs, rt, off) uasm_i_ld(buf, rs, rt, off)  argument
 215 # define UASM_i_LWX(buf, rs, rt, rd) uasm_i_ldx(buf, rs, rt, rd)  argument
 218 # define UASM_i_ROTR(buf, rs, rt, sh) uasm_i_drotr(buf, rs, rt, sh)  argument
 219 # define UASM_i_SC(buf, rs, rt, off) uasm_i_scd(buf, rs, rt, off)  argument
 220 # define UASM_i_SLL(buf, rs, rt, sh) uasm_i_dsll(buf, rs, rt, sh)  argument
 [all …]
 
 | 
| /Linux-v5.4/fs/reiserfs/ | 
| D | objectid.c | 11 #define objectid_map(s,rs) (old_format_only (s) ? \  argument12                          (__le32 *)((struct reiserfs_super_block_v1 *)(rs) + 1) :\
 13 			 (__le32 *)((rs) + 1))
 52 	struct reiserfs_super_block *rs = SB_DISK_SUPER_BLOCK(s);  in reiserfs_get_unused_objectid()  local
 53 	__le32 *map = objectid_map(s, rs);  in reiserfs_get_unused_objectid()
 86 	if (sb_oid_cursize(rs) > 2 && map[1] == map[2]) {  in reiserfs_get_unused_objectid()
 88 			(sb_oid_cursize(rs) - 3) * sizeof(__u32));  in reiserfs_get_unused_objectid()
 89 		set_sb_oid_cursize(rs, sb_oid_cursize(rs) - 2);  in reiserfs_get_unused_objectid()
 101 	struct reiserfs_super_block *rs = SB_DISK_SUPER_BLOCK(s);  in reiserfs_release_objectid()  local
 102 	__le32 *map = objectid_map(s, rs);  in reiserfs_release_objectid()
 [all …]
 
 | 
| /Linux-v5.4/include/linux/ | 
| D | ratelimit.h | 40 static inline void ratelimit_state_init(struct ratelimit_state *rs,  in ratelimit_state_init()  argument43 	memset(rs, 0, sizeof(*rs));  in ratelimit_state_init()
 45 	raw_spin_lock_init(&rs->lock);  in ratelimit_state_init()
 46 	rs->interval	= interval;  in ratelimit_state_init()
 47 	rs->burst	= burst;  in ratelimit_state_init()
 50 static inline void ratelimit_default_init(struct ratelimit_state *rs)  in ratelimit_default_init()  argument
 52 	return ratelimit_state_init(rs, DEFAULT_RATELIMIT_INTERVAL,  in ratelimit_default_init()
 56 static inline void ratelimit_state_exit(struct ratelimit_state *rs)  in ratelimit_state_exit()  argument
 58 	if (!(rs->flags & RATELIMIT_MSG_ON_RELEASE))  in ratelimit_state_exit()
 61 	if (rs->missed) {  in ratelimit_state_exit()
 [all …]
 
 | 
| D | rslib.h | 62 int encode_rs8(struct rs_control *rs, uint8_t *data, int len, uint16_t *par,66 int decode_rs8(struct rs_control *rs, uint8_t *data, uint16_t *par, int len,
 73 int encode_rs16(struct rs_control *rs, uint16_t *data, int len, uint16_t *par,
 77 int decode_rs16(struct rs_control *rs, uint16_t *data, uint16_t *par, int len,
 108 void free_rs(struct rs_control *rs);
 122 static inline int rs_modnn(struct rs_codec *rs, int x)  in rs_modnn()  argument
 124 	while (x >= rs->nn) {  in rs_modnn()
 125 		x -= rs->nn;  in rs_modnn()
 126 		x = (x >> rs->mm) + (x & rs->nn);  in rs_modnn()
 
 | 
| /Linux-v5.4/drivers/platform/chrome/wilco_ec/ | 
| D | properties.c | 33 			     struct ec_property_response *rs)  in send_property_msg()  argument42 	ec_msg.response_data = rs;  in send_property_msg()
 43 	ec_msg.response_size = sizeof(*rs);  in send_property_msg()
 48 	if (rs->op != rq->op)  in send_property_msg()
 50 	if (memcmp(rq->property_id, rs->property_id, sizeof(rs->property_id)))  in send_property_msg()
 60 	struct ec_property_response rs;  in wilco_ec_get_property()  local
 67 	ret = send_property_msg(ec, &rq, &rs);  in wilco_ec_get_property()
 71 	prop_msg->length = rs.length;  in wilco_ec_get_property()
 72 	memcpy(prop_msg->data, rs.data, rs.length);  in wilco_ec_get_property()
 82 	struct ec_property_response rs;  in wilco_ec_set_property()  local
 [all …]
 
 | 
| /Linux-v5.4/arch/mips/kernel/ | 
| D | mips-r2-to-r6-emul.c | 405 	s32 rt, rs;  in mult_func()  local408 	rs = regs->regs[MIPSInst_RS(ir)];  in mult_func()
 409 	res = (s64)rt * (s64)rs;  in mult_func()
 411 	rs = res;  in mult_func()
 412 	regs->lo = (s64)rs;  in mult_func()
 432 	u32 rt, rs;  in multu_func()  local
 435 	rs = regs->regs[MIPSInst_RS(ir)];  in multu_func()
 436 	res = (u64)rt * (u64)rs;  in multu_func()
 455 	s32 rt, rs;  in div_func()  local
 458 	rs = regs->regs[MIPSInst_RS(ir)];  in div_func()
 [all …]
 
 | 
| /Linux-v5.4/drivers/net/wireless/ath/ath5k/ | 
| D | desc.c | 603 				struct ath5k_rx_status *rs)  in ath5k_hw_proc_5210_rx_status()  argument614 	memset(rs, 0, sizeof(struct ath5k_rx_status));  in ath5k_hw_proc_5210_rx_status()
 619 	rs->rs_datalen = rx_status->rx_status_0 &  in ath5k_hw_proc_5210_rx_status()
 621 	rs->rs_rssi = AR5K_REG_MS(rx_status->rx_status_0,  in ath5k_hw_proc_5210_rx_status()
 623 	rs->rs_rate = AR5K_REG_MS(rx_status->rx_status_0,  in ath5k_hw_proc_5210_rx_status()
 625 	rs->rs_more = !!(rx_status->rx_status_0 &  in ath5k_hw_proc_5210_rx_status()
 632 	rs->rs_tstamp = AR5K_REG_MS(rx_status->rx_status_1,  in ath5k_hw_proc_5210_rx_status()
 636 		rs->rs_antenna = AR5K_REG_MS(rx_status->rx_status_0,  in ath5k_hw_proc_5210_rx_status()
 639 		rs->rs_antenna = (rx_status->rx_status_0 &  in ath5k_hw_proc_5210_rx_status()
 647 		rs->rs_keyix = AR5K_REG_MS(rx_status->rx_status_1,  in ath5k_hw_proc_5210_rx_status()
 [all …]
 
 |