Home
last modified time | relevance | path

Searched refs:adjust (Results 1 – 133 of 133) sorted by relevance

/linux-4.1.27/arch/tile/kernel/
Dbacktrace.c105 static bool bt_has_addi_sp(const struct BacktraceBundle *bundle, int *adjust) in bt_has_addi_sp() argument
122 *adjust = insn->operand_values[2]; in bt_has_addi_sp()
231 static bool bt_has_add_sp(const struct BacktraceBundle *bundle, int *adjust, in bt_has_add_sp() argument
241 *adjust = moveli_args[reg]; in bt_has_add_sp()
440 int adjust; in find_caller_pc_and_caller_sp() local
441 if (bt_has_addi_sp(&bundle, &adjust) in find_caller_pc_and_caller_sp()
443 || bt_has_add_sp(&bundle, &adjust, moveli_args) in find_caller_pc_and_caller_sp()
448 if (adjust <= 0) { in find_caller_pc_and_caller_sp()
454 location->sp_offset = adjust; in find_caller_pc_and_caller_sp()
Dstack.c290 unsigned long size, offset, adjust; in describe_addr() local
301 adjust = !kbt->new_context; in describe_addr()
302 address -= adjust; in describe_addr()
317 offset + adjust, size); in describe_addr()
/linux-4.1.27/drivers/tty/
Dtty_ldsem.c123 long adjust, count; in __ldsem_wake_readers() local
129 adjust = sem->wait_readers * (LDSEM_ACTIVE_BIAS - LDSEM_WAIT_BIAS); in __ldsem_wake_readers()
130 count = ldsem_atomic_update(adjust, sem); in __ldsem_wake_readers()
134 if (ldsem_cmpxchg(&count, count - adjust, sem)) in __ldsem_wake_readers()
204 long adjust = -LDSEM_ACTIVE_BIAS + LDSEM_WAIT_BIAS; in down_read_failed() local
213 if (ldsem_cmpxchg(&count, count + adjust, sem)) in down_read_failed()
272 long adjust = -LDSEM_ACTIVE_BIAS; in down_write_failed() local
282 if (ldsem_cmpxchg(&count, count + adjust, sem)) in down_write_failed()
/linux-4.1.27/Documentation/video4linux/
Dradiotrack.txt107 radio enable, tuner adjust disable)
110 radio disable, tuner adjust disable)
116 radio enable, tuner adjust disable)
121 radio enable, tuner adjust disable)
126 radio enable, tuner adjust disable)
138 disable, "zero" bit phase 1, tuner adjust)
140 disable, "zero" bit phase 2, tuner adjust)
143 disable, "one" bit phase 1, tuner adjust)
145 disable, "one" bit phase 2, tuner adjust)
Dsi470x.txt76 commands. Please adjust the audio devices to your needs (/dev/dsp* and hw:x,x).
Dsi4713.txt106 it is possible to adjust the front-end gain of the audio input and always
Dvideobuf83 check it for rationality and adjust it if need be. As a practical rule, a
/linux-4.1.27/Documentation/devicetree/bindings/input/touchscreen/
Dsun4i.txt14 - allwinner,tp-sensitive-adjust : integer (4 bits)
15 adjust sensitivity of pen down detection
36 allwinner,tp-sensitive-adjust = <0>;
/linux-4.1.27/drivers/net/ethernet/amd/xgbe/
Dxgbe-ptp.c143 u64 adjust; in xgbe_adjfreq() local
152 adjust = pdata->tstamp_addend; in xgbe_adjfreq()
153 adjust *= delta; in xgbe_adjfreq()
154 diff = div_u64(adjust, 1000000000UL); in xgbe_adjfreq()
/linux-4.1.27/drivers/media/platform/exynos4-is/
Dfimc-is-param.c102 __hw_param_copy(&par->isp.adjust, &cfg->isp.adjust); in __fimc_is_hw_update_param()
375 isp->adjust.contrast = val; in __is_set_isp_adjust()
378 isp->adjust.saturation = val; in __is_set_isp_adjust()
381 isp->adjust.sharpness = val; in __is_set_isp_adjust()
384 isp->adjust.exposure = val; in __is_set_isp_adjust()
387 isp->adjust.brightness = val; in __is_set_isp_adjust()
390 isp->adjust.hue = val; in __is_set_isp_adjust()
393 isp->adjust.contrast = 0; in __is_set_isp_adjust()
394 isp->adjust.saturation = 0; in __is_set_isp_adjust()
395 isp->adjust.sharpness = 0; in __is_set_isp_adjust()
[all …]
Dfimc-is-param.h695 struct param_isp_adjust adjust; member
/linux-4.1.27/drivers/media/tuners/
Dtda9887.c310 static char *adjust[32] = { in dump_write_message() local
360 adjust[buf[2] & 0x1f]); in dump_write_message()
435 static unsigned int adjust = UNSET; variable
440 module_param(adjust, int, 0644);
467 if (adjust < 0x20) { in tda9887_set_insmod()
469 buf[2] |= adjust; in tda9887_set_insmod()
/linux-4.1.27/drivers/ata/
Dpata_hpt37x.c982 int dpll, adjust; in hpt37x_init_one() local
997 for (adjust = 0; adjust < 8; adjust++) { in hpt37x_init_one()
1004 if (adjust & 1) in hpt37x_init_one()
1005 f_low -= adjust >> 1; in hpt37x_init_one()
1007 f_high += adjust >> 1; in hpt37x_init_one()
1011 if (adjust == 8) { in hpt37x_init_one()
Dpata_hpt3x2n.c497 int adjust; in hpt3x2n_init_one() local
575 for (adjust = 0; adjust < 8; adjust++) { in hpt3x2n_init_one()
580 if (adjust == 8) { in hpt3x2n_init_one()
/linux-4.1.27/drivers/rtc/
Drtc-sysfs.c171 int adjust = 0; in rtc_sysfs_set_wakealarm() local
188 adjust = 1; in rtc_sysfs_set_wakealarm()
191 if (adjust) { in rtc_sysfs_set_wakealarm()
/linux-4.1.27/security/apparmor/
Dpath.c164 int adjust = (flags & PATH_IS_DIR) ? 1 : 0; in get_name_to_buffer() local
165 int error = d_namespace_path(path, buffer, size - adjust, name, flags); in get_name_to_buffer()
/linux-4.1.27/drivers/media/platform/vsp1/
Dvsp1_video.c280 struct v4l2_pix_format_mplane *adjust) in vsp1_video_format_adjust() argument
284 *adjust = *format; in vsp1_video_format_adjust()
285 __vsp1_video_try_format(video, adjust, NULL); in vsp1_video_format_adjust()
287 if (format->width != adjust->width || in vsp1_video_format_adjust()
288 format->height != adjust->height || in vsp1_video_format_adjust()
289 format->pixelformat != adjust->pixelformat || in vsp1_video_format_adjust()
290 format->num_planes != adjust->num_planes) in vsp1_video_format_adjust()
295 adjust->plane_fmt[i].bytesperline) in vsp1_video_format_adjust()
298 adjust->plane_fmt[i].sizeimage = in vsp1_video_format_adjust()
299 max(adjust->plane_fmt[i].sizeimage, in vsp1_video_format_adjust()
/linux-4.1.27/drivers/gpu/drm/nouveau/nvkm/engine/dmaobj/
Dnv04.c46 u64 adjust = priv->base.start & 0x00000fff; in nv04_dmaobj_bind() local
74 nv_wo32(*pgpuobj, 0x00, priv->flags0 | (adjust << 20)); in nv04_dmaobj_bind()
/linux-4.1.27/drivers/ide/
Dhpt366.c1064 int adjust; in init_chipset_hpt366() local
1093 for (adjust = 0; adjust < 8; adjust++) { in init_chipset_hpt366()
1100 if (adjust & 1) in init_chipset_hpt366()
1101 f_low -= adjust >> 1; in init_chipset_hpt366()
1103 f_low += adjust >> 1; in init_chipset_hpt366()
1105 if (adjust == 8) { in init_chipset_hpt366()
/linux-4.1.27/scripts/
Dmakelst31 $3 -r --source --adjust-vma=${t6:-0} $1
/linux-4.1.27/Documentation/ABI/testing/
Dsysfs-driver-hid-picolcd31 Description: Make it possible to adjust defio refresh rate.
40 it only makes sense to adjust this value if only one or two
Dsysfs-bus-iio-frequency-adf435018 adjust the reference frequency accordingly.
Dsysfs-class-mtd141 This allows the user to examine and adjust the criteria by which
/linux-4.1.27/kernel/time/
Dtime.c143 struct timespec adjust; in warp_clock() local
146 adjust.tv_sec = sys_tz.tz_minuteswest * 60; in warp_clock()
147 adjust.tv_nsec = 0; in warp_clock()
148 timekeeping_inject_offset(&adjust); in warp_clock()
Dntp.c500 struct timespec64 adjust = now; in sync_cmos_clock() local
504 adjust.tv_sec -= (sys_tz.tz_minuteswest * 60); in sync_cmos_clock()
506 fail = update_persistent_clock64(adjust); in sync_cmos_clock()
511 fail = rtc_set_ntp_time(adjust); in sync_cmos_clock()
DKconfig45 # Automatically adjust the min. reprogramming time for
/linux-4.1.27/net/netfilter/
Dnf_nat_helper.c99 unsigned int rep_len, bool adjust) in __nf_nat_mangle_tcp_packet() argument
127 if (adjust && rep_len != match_len) in __nf_nat_mangle_tcp_packet()
/linux-4.1.27/include/net/netfilter/
Dnf_nat_helper.h14 unsigned int rep_len, bool adjust);
/linux-4.1.27/drivers/infiniband/hw/qib/
Dqib_eeprom.c114 static u8 flash_csum(struct qib_flash *ifp, int adjust) in flash_csum() argument
131 if (adjust) in flash_csum()
/linux-4.1.27/include/linux/
Dpage-flags-layout.h21 #error ZONES_SHIFT -- too many zones configured adjust calculation
/linux-4.1.27/arch/x86/um/
Dsetjmp_64.S24 pop %rsi # Return address, and adjust the stack
Dsetjmp_32.S27 popl %ecx # Return address, and adjust the stack
/linux-4.1.27/arch/s390/kernel/
Dtime.c308 struct timex adjust; in adjust_time() local
315 adjust.offset = ticks * (1000000 / HZ); in adjust_time()
321 adjust.offset = -ticks * (1000000 / HZ); in adjust_time()
324 if (adjust.offset != 0) { in adjust_time()
326 "by %li microseconds\n", adjust.offset); in adjust_time()
327 adjust.modes = ADJ_OFFSET_SINGLESHOT; in adjust_time()
328 do_adjtimex(&adjust); in adjust_time()
/linux-4.1.27/drivers/platform/x86/
Dintel_ips.c300 struct task_struct *adjust; member
1040 wake_up_process(ips->adjust); in ips_monitor()
1637 ips->adjust = kthread_create(ips_adjust, ips, "ips-adjust"); in ips_probe()
1638 if (IS_ERR(ips->adjust)) { in ips_probe()
1672 kthread_stop(ips->adjust); in ips_probe()
1712 if (ips->adjust) in ips_remove()
1713 kthread_stop(ips->adjust); in ips_remove()
/linux-4.1.27/kernel/debug/kdb/
Dkdb_main.c2084 int adjust = 0; in kdb_dmesg() local
2099 adjust = simple_strtoul(argv[2], &cp, 0); in kdb_dmesg()
2100 if (*cp || adjust < 0) in kdb_dmesg()
2101 adjust = 0; in kdb_dmesg()
2117 if (adjust >= n) in kdb_dmesg()
2120 else if (adjust - lines >= n) in kdb_dmesg()
2122 "lines printed\n", n, n - adjust); in kdb_dmesg()
2123 skip = adjust; in kdb_dmesg()
2126 skip = n - lines - adjust; in kdb_dmesg()
2128 if (adjust >= n) { in kdb_dmesg()
/linux-4.1.27/arch/arc/lib/
Dmemset.S55 ; adjust bzero args to memset args
/linux-4.1.27/arch/metag/lib/
Dmemmove.S24 ! adjust pointer to the end of mem
77 ! adjust A1.2
240 ! adjust A1.2
Dmemcpy.S178 ! Re-adjust the source pointer (A1.2) back to the actual (unaligned) byte
/linux-4.1.27/Documentation/devicetree/
Ddynamic-resolution-notes.txt19 3. Using the __local__fixups__ node information adjust all local references
/linux-4.1.27/include/media/
Dadv7842.h136 bool adjust; member
/linux-4.1.27/Documentation/devicetree/bindings/pinctrl/
Dfsl,mxs-pinctrl.txt28 one is to adjust the pin configuration for some particular pins that need a
39 there to adjust configurations for some pins in the group.
/linux-4.1.27/arch/arm/nwfpe/
Dfpmodule.inl27 that caused the invalid instruction trap to occur. We adjust
/linux-4.1.27/Documentation/sound/alsa/
Dpowersave.txt25 adjust the value via sysfs on the fly. For example, to turn on the
/linux-4.1.27/kernel/gcov/
DKconfig59 In such a case use this option to adjust the format used in the kernel
/linux-4.1.27/Documentation/devicetree/bindings/clock/ti/
Dmux.txt8 gate or adjust the parent rate via a divider or multiplier.
/linux-4.1.27/Documentation/hwmon/
Dadt746226 programmable. Once configured, the ADT7462 will adjust the PWM outputs in
Dadt747026 programmable. Once configured, the ADT7470 will adjust the PWM outputs in
Dadt747549 programmable. Once configured, the ADT747x will adjust the PWM outputs in
Dlm8573 programmable. Once configured, the LM85 will adjust the PWM outputs in
228 adjust the Tmin value to maintain the measured temperature sensor at a
Dit87258 The driver supports temp[1-3]_offset sysfs attributes to adjust the reported
Ddme1737269 Required for chip to adjust the
/linux-4.1.27/Documentation/ABI/stable/
Dsysfs-devices-system-xen_memory46 The target number of pages to adjust this domain's
/linux-4.1.27/arch/x86/crypto/
Dcrct10dif-pcl-asm_64.S74 # adjust the 16-bit initial_crc value, scale it to 32 bits
Daesni-intel_avx-x86_64.S1297 sub %r13, %r12 # adjust the shuffle mask pointer to be
1320 sub %r13, %r12 # adjust the shuffle mask pointer to be
2574 sub %r13, %r12 # adjust the shuffle mask pointer
2597 sub %r13, %r12 # adjust the shuffle mask pointer to be
Daesni-intel_asm.S1377 # adjust the shuffle mask pointer to be able to shift 16-%r13 bytes
1639 # adjust the shuffle mask pointer to be able to shift 16-r13 bytes
/linux-4.1.27/Documentation/laptops/
Dsonypi.txt145 different way to adjust the backlighting of the screen. There
146 is a userspace utility to adjust the brightness on those models,
Dlaptop-mode.txt305 # The drives for which to adjust the idle timeout. Separate them by a space,
366 # Shall we adjust the idle timeout on a hard drive?
/linux-4.1.27/arch/arm/lib/
Dbacktrace.S71 ldr r3, .Ldsi+4 @ adjust saved 'pc' back one
/linux-4.1.27/arch/powerpc/platforms/cell/
DKconfig120 This governor checks for spu usage to adjust the cpu frequency.
/linux-4.1.27/arch/unicore32/lib/
Dbacktrace.S66 ldw r3, .Ldsi+4 @ adjust saved 'pc' back one
/linux-4.1.27/arch/arm/mach-omap2/
Dsram243x.S162 blne voltage_shift_c @ adjust voltage
186 cmp r2, #0x1 @ (SDR or DDR) do we need to adjust DLL
Dsram242x.S162 blne voltage_shift_c @ adjust voltage
186 cmp r2, #0x1 @ (SDR or DDR) do we need to adjust DLL
/linux-4.1.27/drivers/gpu/drm/nouveau/nvkm/subdev/clk/
Dbase.c40 nvkm_clk_adjust(struct nvkm_clk *clk, bool adjust, in nvkm_clk_adjust() argument
62 if (adjust) in nvkm_clk_adjust()
/linux-4.1.27/Documentation/fb/
Dintelfb.txt45 usage, adjust the value up or down, (0 for maximum usage, 63/127 MB
Dintel810.txt122 memory. Depending on your usage, adjust the value up or down
/linux-4.1.27/drivers/video/fbdev/omap2/dss/
DKconfig111 This can be used to adjust the minimum FCK/PCK ratio.
/linux-4.1.27/Documentation/scsi/
Dqlogicfas.txt28 the Linux PCMCIA driver, you will have to adjust it or otherwise stop
Dtmscsim.txt174 (1 / 112 ns = 8.9 MHz). At least in theory. The driver is able to adjust the
261 possibility to adjust settings before you are able to write to the
Daic79xx.txt119 - For pre-2.5.X kernels, carefully adjust our segment
Dscsi_mid_low_api.txt161 If the LLD wants to adjust the default queue settings, it can invoke
663 * to adjust the queue depth on the device.
669 * >0 - adjust queue depth to this new depth
DChangeLog.1992-1997510 us to dynamically adjust the size of the list by adding more pages
/linux-4.1.27/drivers/infiniband/hw/ipath/
Dipath_eeprom.c676 static u8 flash_csum(struct ipath_flash *ifp, int adjust) in flash_csum() argument
693 if (adjust) in flash_csum()
/linux-4.1.27/Documentation/device-mapper/
Dcache-policies.txt40 costs into account and to adjust to varying load patterns automatically.
/linux-4.1.27/Documentation/networking/
Dtcp.txt24 congestion window is in use. It is used to adjust
Dbatman-adv.txt99 In very mobile scenarios, you might want to adjust the originator
De1000e.txt73 timeframe, it will adjust the InterruptThrottleRate to an appropriate value
De1000.txt105 timeframe, it will adjust the InterruptThrottleRate to an appropriate value
Dscaling.txt75 to spread receive interrupts between CPUs. To manually adjust the IRQ
Dbonding.txt1377 sysfs filesystem is mounted elsewhere, you will need to adjust the
2231 It is possible to adjust TCP/IP's congestion limits by
Dip-sysctl.txt421 TCP stack can then dynamically adjust flow reordering level
/linux-4.1.27/Documentation/x86/x86_64/
Dkernel-stacks45 nested IST interrupts then the handler must adjust the IST values on
/linux-4.1.27/fs/xfs/libxfs/
Dxfs_bmap.c3356 xfs_fsblock_t adjust; /* adjustment to block numbers */ in xfs_bmap_adjacent() local
3385 adjust = ap->offset - in xfs_bmap_adjacent()
3387 if (adjust && in xfs_bmap_adjacent()
3388 ISVALID(ap->blkno + adjust, ap->prev.br_startblock)) in xfs_bmap_adjacent()
3389 ap->blkno += adjust; in xfs_bmap_adjacent()
3414 adjust = prevdiff = ap->offset - in xfs_bmap_adjacent()
3428 prevbno += adjust; in xfs_bmap_adjacent()
3430 prevdiff += adjust; in xfs_bmap_adjacent()
3452 adjust = gotdiff = ap->got.br_startoff - ap->offset; in xfs_bmap_adjacent()
3467 gotbno -= adjust; in xfs_bmap_adjacent()
[all …]
/linux-4.1.27/arch/arm/mach-ep93xx/
Dcrunch-bits.S86 sub r2, r2, #4 @ adjust pc back
/linux-4.1.27/arch/alpha/lib/
Dstxcpy.S277 srl t12, t5, t12 # e0 : adjust final null return value
Dev6-stxcpy.S307 srl t12, t5, t12 # U : adjust final null return value
/linux-4.1.27/Documentation/accounting/
Dtaskstats-struct.txt119 * On some architectures, value will adjust for cpu time stolen
/linux-4.1.27/Documentation/sound/oss/
DSoundPro27 adjust the detection routine.
/linux-4.1.27/arch/m68k/math-emu/
Dfp_decode.h227 | adjust stack for byte moves from/to stack
/linux-4.1.27/arch/arm/kernel/
Diwmmxt.S93 sub r2, r2, #4 @ adjust pc back
/linux-4.1.27/Documentation/input/
Dntrig.txt59 to logical sizes is used to adjust the size based filter parameters.
/linux-4.1.27/arch/frv/kernel/
Dhead-mmu-fr451.S159 # adjust LED bank address
Dhead-uc-fr401.S166 # adjust LED bank address
Dhead-uc-fr555.S152 # adjust LED bank address
/linux-4.1.27/drivers/media/i2c/
Dks0127.c191 struct adjust { struct
Dadv7842.c2446 if (s && s->adjust) { in adv7842_s_sdp_io()
/linux-4.1.27/arch/m68k/fpsp040/
Dbindec.S87 | or less than LEN -1 digits, adjust ILOG and repeat from
608 | or less than LEN -1 digits, adjust ILOG and repeat from
/linux-4.1.27/arch/sparc/lib/
Dchecksum_32.S126 sub %g7, %g1, %g7 ! adjust jmp ptr
127 sub %g7, %o4, %g7 ! final jmp ptr adjust
/linux-4.1.27/drivers/input/touchscreen/
Dads7846.c424 #define SHOW(name, var, adjust) static ssize_t \ argument
432 return sprintf(buf, "%u\n", adjust(ts, v)); \
/linux-4.1.27/arch/xtensa/kernel/
Dvectors.S102 addi a2, a1, -16-PT_SIZE # adjust stack pointer
/linux-4.1.27/arch/m68k/ifpsp060/src/
Dpfpsp.S1486 addi.w &0x3c01,%d0 # adjust new exponent
2372 # fix_skewed_ops() - adjust src operand in fsave frame #
3072 # fix_skewed_ops() - adjust src operand in fsave frame #
3746 # fix_skewed_ops() - adjust fsave operand #
3855 # d0 = number of bytes to adjust <ea> by #
5028 # _imem_read_word() increased the extwptr by 2. need to adjust here.
5029 subq.l &0x2,%a0 # adjust <ea>
Disp.S1425 # _imem_read_word() increased the extwptr by 2. need to adjust here.
1426 subq.l &0x2,%a0 # adjust <ea>
Dilsp.S358 # now test the trial quotient and adjust. This step plus the
Dfpsp.S1487 addi.w &0x3c01,%d0 # adjust new exponent
2373 # fix_skewed_ops() - adjust src operand in fsave frame #
3073 # fix_skewed_ops() - adjust src operand in fsave frame #
3747 # fix_skewed_ops() - adjust fsave operand #
18979 # _imem_read_word() increased the extwptr by 2. need to adjust here.
18980 subq.l &0x2,%a0 # adjust <ea>
Dfplsp.S10960 sub.w &32, %d1 # adjust shft amt by 32
/linux-4.1.27/arch/arm/boot/dts/
Darmada-xp-synology-ds414.dts54 * installing it from u-boot prompt) or adjust the Devive Tree
Darmada-370-synology-ds213j.dts54 * installing it from u-boot prompt) or adjust the Devive Tree
/linux-4.1.27/Documentation/pps/
Dpps.txt27 can use it to adjust system clock time.
/linux-4.1.27/Documentation/
Dparport.txt255 If that works fine, try with 'io=0x378 irq=7' (adjust for your
Dapplying-patches.txt111 usually adjust the line numbers and apply the patch.
143 message similar to that, then it means that patch had to adjust the location
Dsvga.txt176 buffer. (If you have old LILO, you can adjust heap_end_ptr and loadflags
Dbcache.txt267 throttling background writeback and using a PD controller to smoothly adjust
Dvfio.txt323 the DMA window is and adjust rlimit before doing any real job.
Dkernel-parameters.txt887 The kernel tries to adjust MTRR layout from continuous
1093 The kernel tries to adjust MTRR layout from continuous
3483 ports for other uses may adjust the range that the
3879 generated by hotkey, video driver will adjust brightness
DSubmittingPatches460 counter-productive waste of time and energy. Rule (b) allows you to adjust
/linux-4.1.27/Documentation/hid/
Duhid.txt137 For messages sent by user-space to the kernel, you must adjust the
/linux-4.1.27/Documentation/thermal/
Dintel_powerclamp.txt124 powerclamp moniors the actual idle for a given time window and adjust
/linux-4.1.27/Documentation/ide/
DChangeLog.ide-tape.1995-200299 * adjust our polling frequency to a much lower value,
/linux-4.1.27/Documentation/locking/
Drt-mutex-design.txt362 process must adjust its priority. With the help of the pi_list of a
386 is called to adjust the priority of the task to the new priority.
677 should adjust its priority accordingly.
/linux-4.1.27/drivers/gpu/drm/nouveau/nvkm/engine/gr/fuc/
Dhub.fuc191 // wait for it to complete, and adjust context size
/linux-4.1.27/Documentation/dmaengine/
Dprovider.txt34 is why most if not all of the DMA controllers can adjust this, using a
/linux-4.1.27/Documentation/serial/
Dmoxa-smartio123 You may need to adjust IRQ usage in BIOS to avoid from IRQ conflict
/linux-4.1.27/Documentation/vm/
Dhugetlbpage.txt87 This command will try to adjust the number of default sized huge pages in the
/linux-4.1.27/net/ipv4/
DKconfig591 adjust the alpha and beta parameters to achieve a higher average
/linux-4.1.27/Documentation/PCI/
DMSI-HOWTO.txt270 This function, in contrast with pci_enable_msi_range(), does not adjust
/linux-4.1.27/Documentation/filesystems/caching/
Dnetfs-api.txt425 cache to adjust its metadata for data tracking appropriately:
/linux-4.1.27/drivers/staging/speakup/
Dspkguide.txt701 Your synth should now start talking, and you should be able to adjust
734 Your DecTalk PC should start talking, and then you can adjust the pitch,
/linux-4.1.27/Documentation/cgroups/
Dcpusets.txt612 from one cpuset to another, then the kernel will adjust the task's
/linux-4.1.27/Documentation/x86/
Dboot.txt785 covered by setup_move_size, so you may need to adjust this
/linux-4.1.27/arch/arm/
DKconfig.debug472 Please adjust DEBUG_UART_PHYS and DEBUG_UART_BASE configuration
/linux-4.1.27/init/
DKconfig646 default, you can adjust this using the rcutree.rcu_idle_gp_delay
/linux-4.1.27/Documentation/filesystems/
Dproc.txt1425 These file can be used to adjust the badness heuristic used to select which
/linux-4.1.27/arch/x86/
DKconfig1454 Documentation/kernel-parameters.txt to adjust this.
/linux-4.1.27/Documentation/virtual/uml/
DUserModeLinux-HOWTO.txt1785 192.168.0.251 and a UML-side IP of 192.168.0.250 - adjust to suit your