]> pilppa.com Git - linux-2.6-omap-h63xx.git/commitdiff
ARM: OMAP: Temporary change to avoid merge conflicts
authorTony Lindgren <tony@atomide.com>
Wed, 29 Jun 2005 13:21:36 +0000 (06:21 -0700)
committerTony Lindgren <tony@atomide.com>
Wed, 29 Jun 2005 13:21:36 +0000 (06:21 -0700)
Added back arch/arm/mach-omap/time.c and removed
drivers/i2c/chips/tps65010.c to avoid merge conflicts.

arch/arm/mach-omap/time.c [new file with mode: 0644]
drivers/i2c/chips/tps65010.c [deleted file]

diff --git a/arch/arm/mach-omap/time.c b/arch/arm/mach-omap/time.c
new file mode 100644 (file)
index 0000000..4205fdc
--- /dev/null
@@ -0,0 +1,384 @@
+/*
+ * linux/arch/arm/mach-omap/time.c
+ *
+ * OMAP Timers
+ *
+ * Copyright (C) 2004 Nokia Corporation
+ * Partial timer rewrite and additional VST timer support by
+ * Tony Lindgen <tony@atomide.com> and
+ * Tuukka Tikkanen <tuukka.tikkanen@elektrobit.com>
+ *
+ * MPU timer code based on the older MPU timer code for OMAP
+ * Copyright (C) 2000 RidgeRun, Inc.
+ * Author: Greg Lonnon <glonnon@ridgerun.com>
+ *
+ * This program is free software; you can redistribute it and/or modify it
+ * under the terms of the GNU General Public License as published by the
+ * Free Software Foundation; either version 2 of the License, or (at your
+ * option) any later version.
+ *
+ * THIS SOFTWARE IS PROVIDED ``AS IS'' AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN
+ * NO EVENT SHALL THE AUTHOR BE LIABLE FOR ANY DIRECT, INDIRECT,
+ * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT
+ * NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF
+ * USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON
+ * ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT
+ * (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF
+ * THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ *
+ * You should have received a copy of the  GNU General Public License along
+ * with this program; if not, write  to the Free Software Foundation, Inc.,
+ * 675 Mass Ave, Cambridge, MA 02139, USA.
+ */
+
+#include <linux/config.h>
+#include <linux/kernel.h>
+#include <linux/init.h>
+#include <linux/delay.h>
+#include <linux/interrupt.h>
+#include <linux/sched.h>
+#include <linux/spinlock.h>
+
+#include <asm/system.h>
+#include <asm/hardware.h>
+#include <asm/io.h>
+#include <asm/leds.h>
+#include <asm/irq.h>
+#include <asm/mach/irq.h>
+#include <asm/mach/time.h>
+
+struct sys_timer omap_timer;
+
+#ifdef CONFIG_OMAP_MPU_TIMER
+
+/*
+ * ---------------------------------------------------------------------------
+ * MPU timer
+ * ---------------------------------------------------------------------------
+ */
+#define OMAP_MPU_TIMER1_BASE           (0xfffec500)
+#define OMAP_MPU_TIMER2_BASE           (0xfffec600)
+#define OMAP_MPU_TIMER3_BASE           (0xfffec700)
+#define OMAP_MPU_TIMER_BASE            OMAP_MPU_TIMER1_BASE
+#define OMAP_MPU_TIMER_OFFSET          0x100
+
+#define MPU_TIMER_FREE                 (1 << 6)
+#define MPU_TIMER_CLOCK_ENABLE         (1 << 5)
+#define MPU_TIMER_AR                   (1 << 1)
+#define MPU_TIMER_ST                   (1 << 0)
+
+/* cycles to nsec conversions taken from arch/i386/kernel/timers/timer_tsc.c,
+ * converted to use kHz by Kevin Hilman */
+/* convert from cycles(64bits) => nanoseconds (64bits)
+ *  basic equation:
+ *             ns = cycles / (freq / ns_per_sec)
+ *             ns = cycles * (ns_per_sec / freq)
+ *             ns = cycles * (10^9 / (cpu_khz * 10^3))
+ *             ns = cycles * (10^6 / cpu_khz)
+ *
+ *     Then we use scaling math (suggested by george at mvista.com) to get:
+ *             ns = cycles * (10^6 * SC / cpu_khz / SC
+ *             ns = cycles * cyc2ns_scale / SC
+ *
+ *     And since SC is a constant power of two, we can convert the div
+ *  into a shift.
+ *                     -johnstul at us.ibm.com "math is hard, lets go shopping!"
+ */
+static unsigned long cyc2ns_scale;
+#define CYC2NS_SCALE_FACTOR 10 /* 2^10, carefully chosen */
+
+static inline void set_cyc2ns_scale(unsigned long cpu_khz)
+{
+       cyc2ns_scale = (1000000 << CYC2NS_SCALE_FACTOR)/cpu_khz;
+}
+
+static inline unsigned long long cycles_2_ns(unsigned long long cyc)
+{
+       return (cyc * cyc2ns_scale) >> CYC2NS_SCALE_FACTOR;
+}
+
+/*
+ * MPU_TICKS_PER_SEC must be an even number, otherwise machinecycles_to_usecs
+ * will break. On P2, the timer count rate is 6.5 MHz after programming PTV
+ * with 0. This divides the 13MHz input by 2, and is undocumented.
+ */
+#ifdef CONFIG_MACH_OMAP_PERSEUS2
+/* REVISIT: This ifdef construct should be replaced by a query to clock
+ * framework to see if timer base frequency is 12.0, 13.0 or 19.2 MHz.
+ */
+#define MPU_TICKS_PER_SEC              (13000000 / 2)
+#else
+#define MPU_TICKS_PER_SEC              (12000000 / 2)
+#endif
+
+#define MPU_TIMER_TICK_PERIOD          ((MPU_TICKS_PER_SEC / HZ) - 1)
+
+typedef struct {
+       u32 cntl;                       /* CNTL_TIMER, R/W */
+       u32 load_tim;                   /* LOAD_TIM,   W */
+       u32 read_tim;                   /* READ_TIM,   R */
+} omap_mpu_timer_regs_t;
+
+#define omap_mpu_timer_base(n)                                         \
+((volatile omap_mpu_timer_regs_t*)IO_ADDRESS(OMAP_MPU_TIMER_BASE +     \
+                                (n)*OMAP_MPU_TIMER_OFFSET))
+
+static inline unsigned long omap_mpu_timer_read(int nr)
+{
+       volatile omap_mpu_timer_regs_t* timer = omap_mpu_timer_base(nr);
+       return timer->read_tim;
+}
+
+static inline void omap_mpu_timer_start(int nr, unsigned long load_val)
+{
+       volatile omap_mpu_timer_regs_t* timer = omap_mpu_timer_base(nr);
+
+       timer->cntl = MPU_TIMER_CLOCK_ENABLE;
+       udelay(1);
+       timer->load_tim = load_val;
+        udelay(1);
+       timer->cntl = (MPU_TIMER_CLOCK_ENABLE | MPU_TIMER_AR | MPU_TIMER_ST);
+}
+
+unsigned long omap_mpu_timer_ticks_to_usecs(unsigned long nr_ticks)
+{
+       unsigned long long nsec;
+
+       nsec = cycles_2_ns((unsigned long long)nr_ticks);
+       return (unsigned long)nsec / 1000;
+}
+
+/*
+ * Last processed system timer interrupt
+ */
+static unsigned long omap_mpu_timer_last = 0;
+
+/*
+ * Returns elapsed usecs since last system timer interrupt
+ */
+static unsigned long omap_mpu_timer_gettimeoffset(void)
+{
+       unsigned long now = 0 - omap_mpu_timer_read(0);
+       unsigned long elapsed = now - omap_mpu_timer_last;
+
+       return omap_mpu_timer_ticks_to_usecs(elapsed);
+}
+
+/*
+ * Elapsed time between interrupts is calculated using timer0.
+ * Latency during the interrupt is calculated using timer1.
+ * Both timer0 and timer1 are counting at 6MHz (P2 6.5MHz).
+ */
+static irqreturn_t omap_mpu_timer_interrupt(int irq, void *dev_id,
+                                       struct pt_regs *regs)
+{
+       unsigned long now, latency;
+
+       write_seqlock(&xtime_lock);
+       now = 0 - omap_mpu_timer_read(0);
+       latency = MPU_TICKS_PER_SEC / HZ - omap_mpu_timer_read(1);
+       omap_mpu_timer_last = now - latency;
+       timer_tick(regs);
+       write_sequnlock(&xtime_lock);
+
+       return IRQ_HANDLED;
+}
+
+static struct irqaction omap_mpu_timer_irq = {
+       .name           = "mpu timer",
+       .flags          = SA_INTERRUPT,
+       .handler        = omap_mpu_timer_interrupt
+};
+
+static unsigned long omap_mpu_timer1_overflows;
+static irqreturn_t omap_mpu_timer1_interrupt(int irq, void *dev_id,
+                                            struct pt_regs *regs)
+{
+       omap_mpu_timer1_overflows++;
+       return IRQ_HANDLED;
+}
+
+static struct irqaction omap_mpu_timer1_irq = {
+       .name           = "mpu timer1 overflow",
+       .flags          = SA_INTERRUPT,
+       .handler        = omap_mpu_timer1_interrupt
+};
+
+static __init void omap_init_mpu_timer(void)
+{
+       set_cyc2ns_scale(MPU_TICKS_PER_SEC / 1000);
+       omap_timer.offset = omap_mpu_timer_gettimeoffset;
+       setup_irq(INT_TIMER1, &omap_mpu_timer1_irq);
+       setup_irq(INT_TIMER2, &omap_mpu_timer_irq);
+       omap_mpu_timer_start(0, 0xffffffff);
+       omap_mpu_timer_start(1, MPU_TIMER_TICK_PERIOD);
+}
+
+/*
+ * Scheduler clock - returns current time in nanosec units.
+ */
+unsigned long long sched_clock(void)
+{
+       unsigned long ticks = 0 - omap_mpu_timer_read(0);
+       unsigned long long ticks64;
+
+       ticks64 = omap_mpu_timer1_overflows;
+       ticks64 <<= 32;
+       ticks64 |= ticks;
+
+       return cycles_2_ns(ticks64);
+}
+#endif /* CONFIG_OMAP_MPU_TIMER */
+
+#ifdef CONFIG_OMAP_32K_TIMER
+
+#ifdef CONFIG_ARCH_OMAP1510
+#error OMAP 32KHz timer does not currently work on 1510!
+#endif
+
+/*
+ * ---------------------------------------------------------------------------
+ * 32KHz OS timer
+ *
+ * This currently works only on 16xx, as 1510 does not have the continuous
+ * 32KHz synchronous timer. The 32KHz synchronous timer is used to keep track
+ * of time in addition to the 32KHz OS timer. Using only the 32KHz OS timer
+ * on 1510 would be possible, but the timer would not be as accurate as
+ * with the 32KHz synchronized timer.
+ * ---------------------------------------------------------------------------
+ */
+#define OMAP_32K_TIMER_BASE            0xfffb9000
+#define OMAP_32K_TIMER_CR              0x08
+#define OMAP_32K_TIMER_TVR             0x00
+#define OMAP_32K_TIMER_TCR             0x04
+
+#define OMAP_32K_TICKS_PER_HZ          (32768 / HZ)
+
+/*
+ * TRM says 1 / HZ = ( TVR + 1) / 32768, so TRV = (32768 / HZ) - 1
+ * so with HZ = 100, TVR = 327.68.
+ */
+#define OMAP_32K_TIMER_TICK_PERIOD     ((32768 / HZ) - 1)
+#define MAX_SKIP_JIFFIES               25
+#define TIMER_32K_SYNCHRONIZED         0xfffbc410
+
+#define JIFFIES_TO_HW_TICKS(nr_jiffies, clock_rate)                    \
+                               (((nr_jiffies) * (clock_rate)) / HZ)
+
+static inline void omap_32k_timer_write(int val, int reg)
+{
+       omap_writew(val, reg + OMAP_32K_TIMER_BASE);
+}
+
+static inline unsigned long omap_32k_timer_read(int reg)
+{
+       return omap_readl(reg + OMAP_32K_TIMER_BASE) & 0xffffff;
+}
+
+/*
+ * The 32KHz synchronized timer is an additional timer on 16xx.
+ * It is always running.
+ */
+static inline unsigned long omap_32k_sync_timer_read(void)
+{
+       return omap_readl(TIMER_32K_SYNCHRONIZED);
+}
+
+static inline void omap_32k_timer_start(unsigned long load_val)
+{
+       omap_32k_timer_write(load_val, OMAP_32K_TIMER_TVR);
+       omap_32k_timer_write(0x0f, OMAP_32K_TIMER_CR);
+}
+
+static inline void omap_32k_timer_stop(void)
+{
+       omap_32k_timer_write(0x0, OMAP_32K_TIMER_CR);
+}
+
+/*
+ * Rounds down to nearest usec
+ */
+static inline unsigned long omap_32k_ticks_to_usecs(unsigned long ticks_32k)
+{
+       return (ticks_32k * 5*5*5*5*5*5) >> 9;
+}
+
+static unsigned long omap_32k_last_tick = 0;
+
+/*
+ * Returns elapsed usecs since last 32k timer interrupt
+ */
+static unsigned long omap_32k_timer_gettimeoffset(void)
+{
+       unsigned long now = omap_32k_sync_timer_read();
+       return omap_32k_ticks_to_usecs(now - omap_32k_last_tick);
+}
+
+/*
+ * Timer interrupt for 32KHz timer. When dynamic tick is enabled, this
+ * function is also called from other interrupts to remove latency
+ * issues with dynamic tick. In the dynamic tick case, we need to lock
+ * with irqsave.
+ */
+static irqreturn_t omap_32k_timer_interrupt(int irq, void *dev_id,
+                                           struct pt_regs *regs)
+{
+       unsigned long flags;
+       unsigned long now;
+
+       write_seqlock_irqsave(&xtime_lock, flags);
+       now = omap_32k_sync_timer_read();
+
+       while (now - omap_32k_last_tick >= OMAP_32K_TICKS_PER_HZ) {
+               omap_32k_last_tick += OMAP_32K_TICKS_PER_HZ;
+               timer_tick(regs);
+       }
+
+       /* Restart timer so we don't drift off due to modulo or dynamic tick.
+        * By default we program the next timer to be continuous to avoid
+        * latencies during high system load. During dynamic tick operation the
+        * continuous timer can be overridden from pm_idle to be longer.
+        */
+       omap_32k_timer_start(omap_32k_last_tick + OMAP_32K_TICKS_PER_HZ - now);
+       write_sequnlock_irqrestore(&xtime_lock, flags);
+
+       return IRQ_HANDLED;
+}
+
+static struct irqaction omap_32k_timer_irq = {
+       .name           = "32KHz timer",
+       .flags          = SA_INTERRUPT,
+       .handler        = omap_32k_timer_interrupt
+};
+
+static __init void omap_init_32k_timer(void)
+{
+       setup_irq(INT_OS_TIMER, &omap_32k_timer_irq);
+       omap_timer.offset  = omap_32k_timer_gettimeoffset;
+       omap_32k_last_tick = omap_32k_sync_timer_read();
+       omap_32k_timer_start(OMAP_32K_TIMER_TICK_PERIOD);
+}
+#endif /* CONFIG_OMAP_32K_TIMER */
+
+/*
+ * ---------------------------------------------------------------------------
+ * Timer initialization
+ * ---------------------------------------------------------------------------
+ */
+void __init omap_timer_init(void)
+{
+#if defined(CONFIG_OMAP_MPU_TIMER)
+       omap_init_mpu_timer();
+#elif defined(CONFIG_OMAP_32K_TIMER)
+       omap_init_32k_timer();
+#else
+#error No system timer selected in Kconfig!
+#endif
+}
+
+struct sys_timer omap_timer = {
+       .init           = omap_timer_init,
+       .offset         = NULL,         /* Initialized later */
+};
diff --git a/drivers/i2c/chips/tps65010.c b/drivers/i2c/chips/tps65010.c
deleted file mode 100644 (file)
index ca6616b..0000000
+++ /dev/null
@@ -1,1072 +0,0 @@
-/*
- * tps65010 - driver for tps6501x power management chips
- *
- * Copyright (C) 2004 Texas Instruments
- * Copyright (C) 2004-2005 David Brownell
- *
- * This program is free software; you can redistribute it and/or modify
- * it under the terms of the GNU General Public License as published by
- * the Free Software Foundation; either version 2 of the License, or
- * (at your option) any later version.
- *
- * This program is distributed in the hope that it will be useful,
- * but WITHOUT ANY WARRANTY; without even the implied warranty of
- * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE.  See the
- * GNU General Public License for more details.
- *
- * You should have received a copy of the GNU General Public License
- * along with this program; if not, write to the Free Software
- * Foundation, Inc., 675 Mass Ave, Cambridge, MA 02139, USA.
- */
-#undef DEBUG
-
-#include <linux/config.h>
-#include <linux/kernel.h>
-#include <linux/module.h>
-#include <linux/init.h>
-#include <linux/slab.h>
-#include <linux/interrupt.h>
-#include <linux/device.h>
-#include <linux/i2c.h>
-#include <linux/delay.h>
-#include <linux/workqueue.h>
-#include <linux/suspend.h>
-#include <linux/debugfs.h>
-#include <linux/seq_file.h>
-
-#include <asm/irq.h>
-#include <asm/mach-types.h>
-
-#include <asm/arch/gpio.h>
-#include <asm/arch/mux.h>
-#include <asm/arch/tps65010.h>
-
-/*-------------------------------------------------------------------------*/
-
-#define        DRIVER_VERSION  "2 May 2005"
-#define        DRIVER_NAME     (tps65010_driver.name)
-
-MODULE_DESCRIPTION("TPS6501x Power Management Driver");
-MODULE_LICENSE("GPL");
-
-/* only two addresses possible */
-#define        TPS_BASE        0x48
-static unsigned short normal_i2c[] = {
-       TPS_BASE,
-       I2C_CLIENT_END };
-static unsigned short normal_i2c_range[] = { I2C_CLIENT_END };
-
-I2C_CLIENT_INSMOD;
-
-static struct i2c_driver tps65010_driver;
-
-/*-------------------------------------------------------------------------*/
-
-/* This driver handles a family of multipurpose chips, which incorporate
- * voltage regulators, lithium ion/polymer battery charging, GPIOs, LEDs,
- * and other features often needed in portable devices like cell phones
- * or digital cameras.
- *
- * The tps65011 and tps65013 have different voltage settings compared
- * to tps65010 and tps65012.  The tps65013 has a NO_CHG status/irq.
- * All except tps65010 have "wait" mode, possibly defaulted so that
- * battery-insert != device-on.
- *
- * We could distinguish between some models by checking VDCDC1.UVLO or
- * other registers, unless they've been changed already after powerup
- * as part of board setup by a bootloader.
- */
-enum tps_model {
-       TPS_UNKNOWN = 0,
-       TPS65010,
-       TPS65011,
-       TPS65012,
-       TPS65013,
-};
-
-struct tps65010 {
-       struct i2c_client       client;
-       struct semaphore        lock;
-       int                     irq;
-       struct work_struct      work;
-       struct dentry           *file;
-       unsigned                charging:1;
-       unsigned                por:1;
-       unsigned                model:8;
-       u16                     vbus;
-       unsigned long           flags;
-#define        FLAG_VBUS_CHANGED       0
-#define        FLAG_IRQ_ENABLE         1
-
-       /* copies of last register state */
-       u8                      chgstatus, regstatus, chgconf;
-       u8                      nmask1, nmask2;
-
-       /* plus four GPIOs, probably used to switch power */
-};
-
-#define        POWER_POLL_DELAY        msecs_to_jiffies(800)
-
-/*-------------------------------------------------------------------------*/
-
-#if    defined(DEBUG) || defined(CONFIG_DEBUG_FS)
-
-static void dbg_chgstat(char *buf, size_t len, u8 chgstatus)
-{
-       snprintf(buf, len, "%02x%s%s%s%s%s%s%s%s\n",
-               chgstatus,
-               (chgstatus & TPS_CHG_USB) ? " USB" : "",
-               (chgstatus & TPS_CHG_AC) ? " AC" : "",
-               (chgstatus & TPS_CHG_THERM) ? " therm" : "",
-               (chgstatus & TPS_CHG_TERM) ? " done" :
-                       ((chgstatus & (TPS_CHG_USB|TPS_CHG_AC))
-                               ? " (charging)" : ""),
-               (chgstatus & TPS_CHG_TAPER_TMO) ? " taper_tmo" : "",
-               (chgstatus & TPS_CHG_CHG_TMO) ? " charge_tmo" : "",
-               (chgstatus & TPS_CHG_PRECHG_TMO) ? " prechg_tmo" : "",
-               (chgstatus & TPS_CHG_TEMP_ERR) ? " temp_err" : "");
-}
-
-static void dbg_regstat(char *buf, size_t len, u8 regstatus)
-{
-       snprintf(buf, len, "%02x %s%s%s%s%s%s%s%s\n",
-               regstatus,
-               (regstatus & TPS_REG_ONOFF) ? "off" : "(on)",
-               (regstatus & TPS_REG_COVER) ? " uncover" : "",
-               (regstatus & TPS_REG_UVLO) ? " UVLO" : "",
-               (regstatus & TPS_REG_NO_CHG) ? " NO_CHG" : "",
-               (regstatus & TPS_REG_PG_LD02) ? " ld01_bad" : "",
-               (regstatus & TPS_REG_PG_LD01) ? " ld01_bad" : "",
-               (regstatus & TPS_REG_PG_MAIN) ? " main_bad" : "",
-               (regstatus & TPS_REG_PG_CORE) ? " core_bad" : "");
-}
-
-static void dbg_chgconf(int por, char *buf, size_t len, u8 chgconfig)
-{
-       char *hibit;
-
-       if (por)
-               hibit = (chgconfig & TPS_CHARGE_POR)
-                               ? "POR=69ms" : "POR=1sec";
-       else
-               hibit = (chgconfig & TPS65013_AUA) ? "AUA" : "";
-
-       snprintf(buf, len, "%02x %s%s%s AC=%d%% USB=%dmA %sCharge\n",
-               chgconfig, hibit,
-               (chgconfig & TPS_CHARGE_RESET) ? " reset" : "",
-               (chgconfig & TPS_CHARGE_FAST) ? " fast" : "",
-               ({int p; switch ((chgconfig >> 3) & 3) {
-               case 3:         p = 100; break;
-               case 2:         p = 75; break;
-               case 1:         p = 50; break;
-               default:        p = 25; break;
-               }; p; }),
-               (chgconfig & TPS_VBUS_CHARGING)
-                       ? ((chgconfig & TPS_VBUS_500MA) ? 500 : 100)
-                       : 0,
-               (chgconfig & TPS_CHARGE_ENABLE) ? "" : "No");
-}
-
-#endif
-
-#ifdef DEBUG
-
-static void show_chgstatus(const char *label, u8 chgstatus)
-{
-       char buf [100];
-
-       dbg_chgstat(buf, sizeof buf, chgstatus);
-       pr_debug("%s: %s %s", DRIVER_NAME, label, buf);
-}
-
-static void show_regstatus(const char *label, u8 regstatus)
-{
-       char buf [100];
-
-       dbg_regstat(buf, sizeof buf, regstatus);
-       pr_debug("%s: %s %s", DRIVER_NAME, label, buf);
-}
-
-static void show_chgconfig(int por, const char *label, u8 chgconfig)
-{
-       char buf [100];
-
-       dbg_chgconf(por, buf, sizeof buf, chgconfig);
-       pr_debug("%s: %s %s", DRIVER_NAME, label, buf);
-}
-
-#else
-
-static inline void show_chgstatus(const char *label, u8 chgstatus) { }
-static inline void show_regstatus(const char *label, u8 chgstatus) { }
-static inline void show_chgconfig(int por, const char *label, u8 chgconfig) { }
-
-#endif
-
-#ifdef CONFIG_DEBUG_FS
-
-static int dbg_show(struct seq_file *s, void *_)
-{
-       struct tps65010 *tps = s->private;
-       u8              value, v2;
-       unsigned        i;
-       char            buf[100];
-       const char      *chip;
-
-       switch (tps->model) {
-       case TPS65010:  chip = "tps65010"; break;
-       case TPS65011:  chip = "tps65011"; break;
-       case TPS65012:  chip = "tps65012"; break;
-       case TPS65013:  chip = "tps65013"; break;
-       default:        chip = NULL; break;
-       }
-       seq_printf(s, "driver  %s\nversion %s\nchip    %s\n\n",
-                       DRIVER_NAME, DRIVER_VERSION, chip);
-
-       down(&tps->lock);
-
-       /* FIXME how can we tell whether a battery is present?
-        * likely involves a charge gauging chip (like BQ26501).
-        */
-
-       seq_printf(s, "%scharging\n\n", tps->charging ? "" : "(not) ");
-
-
-       /* registers for monitoring battery charging and status; note
-        * that reading chgstat and regstat may ack IRQs...
-        */
-       value = i2c_smbus_read_byte_data(&tps->client, TPS_CHGCONFIG);
-       dbg_chgconf(tps->por, buf, sizeof buf, value);
-       seq_printf(s, "chgconfig %s", buf);
-
-       value = i2c_smbus_read_byte_data(&tps->client, TPS_CHGSTATUS);
-       dbg_chgstat(buf, sizeof buf, value);
-       seq_printf(s, "chgstat   %s", buf);
-       value = i2c_smbus_read_byte_data(&tps->client, TPS_MASK1);
-       dbg_chgstat(buf, sizeof buf, value);
-       seq_printf(s, "mask1     %s", buf);
-       /* ignore ackint1 */
-
-       value = i2c_smbus_read_byte_data(&tps->client, TPS_REGSTATUS);
-       dbg_regstat(buf, sizeof buf, value);
-       seq_printf(s, "regstat   %s", buf);
-       value = i2c_smbus_read_byte_data(&tps->client, TPS_MASK2);
-       dbg_regstat(buf, sizeof buf, value);
-       seq_printf(s, "mask2     %s\n", buf);
-       /* ignore ackint2 */
-
-       (void) schedule_delayed_work(&tps->work, POWER_POLL_DELAY);
-
-
-       /* VMAIN voltage, enable lowpower, etc */
-       value = i2c_smbus_read_byte_data(&tps->client, TPS_VDCDC1);
-       seq_printf(s, "vdcdc1    %02x\n", value);
-
-       /* VCORE voltage, vibrator on/off */
-       value = i2c_smbus_read_byte_data(&tps->client, TPS_VDCDC2);
-       seq_printf(s, "vdcdc2    %02x\n", value);
-
-       /* both LD0s, and their lowpower behavior */
-       value = i2c_smbus_read_byte_data(&tps->client, TPS_VREGS1);
-       seq_printf(s, "vregs1    %02x\n\n", value);
-
-
-       /* LEDs and GPIOs */
-       value = i2c_smbus_read_byte_data(&tps->client, TPS_LED1_ON);
-       v2 = i2c_smbus_read_byte_data(&tps->client, TPS_LED1_PER);
-       seq_printf(s, "led1 %s, on=%02x, per=%02x, %d/%d msec\n",
-               (value & 0x80)
-                       ? ((v2 & 0x80) ? "on" : "off")
-                       : ((v2 & 0x80) ? "blink" : "(nPG)"),
-               value, v2,
-               (value & 0x7f) * 10, (v2 & 0x7f) * 100);
-
-       value = i2c_smbus_read_byte_data(&tps->client, TPS_LED2_ON);
-       v2 = i2c_smbus_read_byte_data(&tps->client, TPS_LED2_PER);
-       seq_printf(s, "led2 %s, on=%02x, per=%02x, %d/%d msec\n",
-               (value & 0x80)
-                       ? ((v2 & 0x80) ? "on" : "off")
-                       : ((v2 & 0x80) ? "blink" : "off"),
-               value, v2,
-               (value & 0x7f) * 10, (v2 & 0x7f) * 100);
-
-       value = i2c_smbus_read_byte_data(&tps->client, TPS_DEFGPIO);
-       v2 = i2c_smbus_read_byte_data(&tps->client, TPS_MASK3);
-       seq_printf(s, "defgpio %02x mask3 %02x\n", value, v2);
-
-       for (i = 0; i < 4; i++) {
-               if (value & (1 << (4 +i)))
-                       seq_printf(s, "  gpio%d-out %s\n", i + 1,
-                               (value & (1 << i)) ? "low" : "hi ");
-               else
-                       seq_printf(s, "  gpio%d-in  %s %s %s\n", i + 1,
-                               (value & (1 << i)) ? "hi " : "low",
-                               (v2 & (1 << i)) ? "no-irq" : "irq",
-                               (v2 & (1 << (4 + i))) ? "rising" : "falling");
-       }
-
-       up(&tps->lock);
-       return 0;
-}
-
-static int dbg_tps_open(struct inode *inode, struct file *file)
-{
-       return single_open(file, dbg_show, inode->u.generic_ip);
-}
-
-static struct file_operations debug_fops = {
-       .open           = dbg_tps_open,
-       .read           = seq_read,
-       .llseek         = seq_lseek,
-       .release        = single_release,
-};
-
-#define        DEBUG_FOPS      &debug_fops
-
-#else
-#define        DEBUG_FOPS      NULL
-#endif
-
-/*-------------------------------------------------------------------------*/
-
-/* handle IRQS in a task context, so we can use I2C calls */
-static void tps65010_interrupt(struct tps65010 *tps)
-{
-       u8 tmp = 0, mask, poll;
-
-       /* IRQs won't trigger irqs for certain events, but we can get
-        * others by polling (normally, with external power applied).
-        */
-       poll = 0;
-
-       /* regstatus irqs */
-       if (tps->nmask2) {
-               tmp = i2c_smbus_read_byte_data(&tps->client, TPS_REGSTATUS);
-               mask = tmp ^ tps->regstatus;
-               tps->regstatus = tmp;
-               mask &= tps->nmask2;
-       } else
-               mask = 0;
-       if (mask) {
-               tps->regstatus =  tmp;
-               /* may need to shut something down ... */
-
-               /* "off" usually means deep sleep */
-               if (tmp & TPS_REG_ONOFF) {
-                       pr_info("%s: power off button\n", DRIVER_NAME);
-#if 0
-                       /* REVISIT:  this might need its own workqueue
-                        * plus tweaks including deadlock avoidance ...
-                        */
-                       software_suspend();
-#endif
-                       poll = 1;
-               }
-       }
-
-       /* chgstatus irqs */
-       if (tps->nmask1) {
-               tmp = i2c_smbus_read_byte_data(&tps->client, TPS_CHGSTATUS);
-               mask = tmp ^ tps->chgstatus;
-               tps->chgstatus = tmp;
-               mask &= tps->nmask1;
-       } else
-               mask = 0;
-       if (mask) {
-               unsigned        charging = 0;
-
-               show_chgstatus("chg/irq", tmp);
-               if (tmp & (TPS_CHG_USB|TPS_CHG_AC))
-                       show_chgconfig(tps->por, "conf", tps->chgconf);
-
-               /* Unless it was turned off or disabled, we charge any
-                * battery whenever there's power available for it
-                * and the charger hasn't been disabled.
-                */
-               if (!(tps->chgstatus & ~(TPS_CHG_USB|TPS_CHG_AC))
-                               && (tps->chgstatus & (TPS_CHG_USB|TPS_CHG_AC))
-                               && (tps->chgconf & TPS_CHARGE_ENABLE)
-                               ) {
-                       if (tps->chgstatus & TPS_CHG_USB) {
-                               /* VBUS options are readonly until reconnect */
-                               if (mask & TPS_CHG_USB)
-                                       set_bit(FLAG_VBUS_CHANGED, &tps->flags);
-                               charging = 1;
-                       } else if (tps->chgstatus & TPS_CHG_AC)
-                               charging = 1;
-               }
-               if (charging != tps->charging) {
-                       tps->charging = charging;
-                       pr_info("%s: battery %scharging\n",
-                               DRIVER_NAME, charging ? "" :
-                               ((tps->chgstatus & (TPS_CHG_USB|TPS_CHG_AC))
-                                       ? "NOT " : "dis"));
-               }
-       }
-
-       /* always poll to detect (a) power removal, without tps65013
-        * NO_CHG IRQ; or (b) restart of charging after stop.
-        */
-       if ((tps->model != TPS65013 || !tps->charging)
-                       && (tps->chgstatus & (TPS_CHG_USB|TPS_CHG_AC)))
-               poll = 1;
-       if (poll)
-               (void) schedule_delayed_work(&tps->work, POWER_POLL_DELAY);
-
-       /* also potentially gpio-in rise or fall */
-}
-
-/* handle IRQs and polling using keventd for now */
-static void tps65010_work(void *_tps)
-{
-       struct tps65010         *tps = _tps;
-
-       down(&tps->lock);
-
-       tps65010_interrupt(tps);
-
-       if (test_and_clear_bit(FLAG_VBUS_CHANGED, &tps->flags)) {
-               int     status;
-               u8      chgconfig, tmp;
-
-               chgconfig = i2c_smbus_read_byte_data(&tps->client,
-                                       TPS_CHGCONFIG);
-               chgconfig &= ~(TPS_VBUS_500MA | TPS_VBUS_CHARGING);
-               if (tps->vbus == 500)
-                       chgconfig |= TPS_VBUS_500MA | TPS_VBUS_CHARGING;
-               else if (tps->vbus >= 100)
-                       chgconfig |= TPS_VBUS_CHARGING;
-
-               status = i2c_smbus_write_byte_data(&tps->client,
-                               TPS_CHGCONFIG, chgconfig);
-
-               /* vbus update fails unless VBUS is connected! */
-               tmp = i2c_smbus_read_byte_data(&tps->client, TPS_CHGCONFIG);
-               tps->chgconf = tmp;
-               show_chgconfig(tps->por, "update vbus", tmp);
-       }
-
-       if (test_and_clear_bit(FLAG_IRQ_ENABLE, &tps->flags))
-               enable_irq(tps->irq);
-
-       up(&tps->lock);
-}
-
-static irqreturn_t tps65010_irq(int irq, void *_tps, struct pt_regs *regs)
-{
-       struct tps65010         *tps = _tps;
-
-       disable_irq_nosync(irq);
-       set_bit(FLAG_IRQ_ENABLE, &tps->flags);
-       (void) schedule_work(&tps->work);
-       return IRQ_HANDLED;
-}
-
-/*-------------------------------------------------------------------------*/
-
-static struct tps65010 *the_tps;
-
-static int __exit tps65010_detach_client(struct i2c_client *client)
-{
-       struct tps65010         *tps;
-
-       tps = container_of(client, struct tps65010, client);
-#ifdef CONFIG_ARM
-       if (machine_is_omap_h2())
-               omap_free_gpio(58);
-       if (machine_is_omap_osk())
-               omap_free_gpio(OMAP_MPUIO(1));
-#endif
-       free_irq(tps->irq, tps);
-       debugfs_remove(tps->file);
-       if (i2c_detach_client(client) == 0)
-               kfree(tps);
-       the_tps = 0;
-       return 0;
-}
-
-static int tps65010_noscan(struct i2c_adapter *bus)
-{
-       /* pure paranoia, in case someone adds another i2c bus
-        * after our init section's gone...
-        */
-       return -ENODEV;
-}
-
-/* no error returns, they'd just make bus scanning stop */
-static int __init
-tps65010_probe(struct i2c_adapter *bus, int address, int kind)
-{
-       struct tps65010         *tps;
-       int                     status;
-
-       if (the_tps) {
-               dev_dbg(&bus->dev, "only one %s for now\n", DRIVER_NAME);
-               return 0;
-       }
-
-       tps = kmalloc(sizeof *tps, GFP_KERNEL);
-       if (!tps)
-               return 0;
-
-       memset(tps, 0, sizeof *tps);
-       init_MUTEX(&tps->lock);
-       INIT_WORK(&tps->work, tps65010_work, tps);
-       tps->irq = -1;
-       tps->client.addr = address;
-       i2c_set_clientdata(&tps->client, tps);
-       tps->client.adapter = bus;
-       tps->client.driver = &tps65010_driver;
-       strlcpy(tps->client.name, DRIVER_NAME, I2C_NAME_SIZE);
-
-       status = i2c_attach_client(&tps->client);
-       if (status < 0) {
-               dev_dbg(&bus->dev, "can't attach %s to device %d, err %d\n",
-                               DRIVER_NAME, address, status);
-fail1:
-               kfree(tps);
-               return 0;
-       }
-
-#ifdef CONFIG_ARM
-       if (machine_is_omap_h2()) {
-               tps->model = TPS65010;
-               omap_cfg_reg(W4_GPIO58);
-               tps->irq = OMAP_GPIO_IRQ(58);
-               omap_request_gpio(58);
-               omap_set_gpio_direction(58, 1);
-               set_irq_type(tps->irq, IRQT_FALLING);
-       }
-       if (machine_is_omap_osk()) {
-               tps->model = TPS65010;
-               // omap_cfg_reg(U19_1610_MPUIO1);
-               tps->irq = OMAP_GPIO_IRQ(OMAP_MPUIO(1));
-               omap_request_gpio(OMAP_MPUIO(1));
-               omap_set_gpio_direction(OMAP_MPUIO(1), 1);
-               set_irq_type(tps->irq, IRQT_FALLING);
-       }
-       if (machine_is_omap_h3()) {
-               tps->model = TPS65013;
-
-               // FIXME set up this board's IRQ ...
-       }
-#else
-#define set_irq_type(num,trigger)      do{}while(0)
-#endif
-
-       if (tps->irq > 0) {
-               set_irq_type(tps->irq, IRQT_LOW);
-               status = request_irq(tps->irq, tps65010_irq,
-                       SA_SAMPLE_RANDOM, DRIVER_NAME, tps);
-               if (status < 0) {
-                       dev_dbg(&tps->client.dev, "can't get IRQ %d, err %d\n",
-                                       tps->irq, status);
-                       i2c_detach_client(&tps->client);
-                       goto fail1;
-               }
-#ifdef CONFIG_ARM
-               /* annoying race here, ideally we'd have an option
-                * to claim the irq now and enable it later.
-                */
-               disable_irq(tps->irq);
-               set_bit(FLAG_IRQ_ENABLE, &tps->flags);
-#endif
-       } else
-               printk(KERN_WARNING "%s: IRQ not configured!\n",
-                               DRIVER_NAME);
-
-
-       switch (tps->model) {
-       case TPS65010:
-       case TPS65012:
-               tps->por = 1;
-               break;
-       case TPS_UNKNOWN:
-               printk(KERN_WARNING "%s: unknown TPS chip\n", DRIVER_NAME);
-               break;
-       /* else CHGCONFIG.POR is replaced by AUA, enabling a WAIT mode */
-       }
-       tps->chgconf = i2c_smbus_read_byte_data(&tps->client, TPS_CHGCONFIG);
-       show_chgconfig(tps->por, "conf/init", tps->chgconf);
-
-       show_chgstatus("chg/init",
-               i2c_smbus_read_byte_data(&tps->client, TPS_CHGSTATUS));
-       show_regstatus("reg/init",
-               i2c_smbus_read_byte_data(&tps->client, TPS_REGSTATUS));
-
-       pr_debug("%s: vdcdc1 0x%02x, vdcdc2 %02x, vregs1 %02x\n", DRIVER_NAME,
-               i2c_smbus_read_byte_data(&tps->client, TPS_VDCDC1),
-               i2c_smbus_read_byte_data(&tps->client, TPS_VDCDC2),
-               i2c_smbus_read_byte_data(&tps->client, TPS_VREGS1));
-       pr_debug("%s: defgpio 0x%02x, mask3 0x%02x\n", DRIVER_NAME,
-               i2c_smbus_read_byte_data(&tps->client, TPS_DEFGPIO),
-               i2c_smbus_read_byte_data(&tps->client, TPS_MASK3));
-
-       tps65010_driver.attach_adapter = tps65010_noscan;
-       the_tps = tps;
-
-#if    defined(CONFIG_USB_GADGET) && !defined(CONFIG_USB_OTG)
-       /* USB hosts can't draw VBUS.  OTG devices could, later
-        * when OTG infrastructure enables it.  USB peripherals
-        * could be relying on VBUS while booting, though.
-        */
-       tps->vbus = 100;
-#endif
-
-       /* unmask the "interesting" irqs, then poll once to
-        * kickstart monitoring, initialize shadowed status
-        * registers, and maybe disable VBUS draw.
-        */
-       tps->nmask1 = ~0;
-       (void) i2c_smbus_write_byte_data(&tps->client, TPS_MASK1, ~tps->nmask1);
-
-       tps->nmask2 = TPS_REG_ONOFF;
-       if (tps->model == TPS65013)
-               tps->nmask2 |= TPS_REG_NO_CHG;
-       (void) i2c_smbus_write_byte_data(&tps->client, TPS_MASK2, ~tps->nmask2);
-
-       (void) i2c_smbus_write_byte_data(&tps->client, TPS_MASK3, 0x0f
-               | i2c_smbus_read_byte_data(&tps->client, TPS_MASK3));
-
-       tps65010_work(tps);
-
-       tps->file = debugfs_create_file(DRIVER_NAME, S_IRUGO, NULL,
-                               tps, DEBUG_FOPS);
-       return 0;
-}
-
-static int __init tps65010_scan_bus(struct i2c_adapter *bus)
-{
-       if (!i2c_check_functionality(bus, I2C_FUNC_SMBUS_BYTE_DATA))
-               return -EINVAL;
-       return i2c_probe(bus, &addr_data, tps65010_probe);
-}
-
-static struct i2c_driver tps65010_driver = {
-       .owner          = THIS_MODULE,
-       .name           = "tps65010",
-       .id             = 888,          /* FIXME assign "official" value */
-       .flags          = I2C_DF_NOTIFY,
-       .attach_adapter = tps65010_scan_bus,
-       .detach_client  = __exit_p(tps65010_detach_client),
-};
-
-/*-------------------------------------------------------------------------*/
-
-/* Draw from VBUS:
- *   0 mA -- DON'T DRAW (might supply power instead)
- * 100 mA -- usb unit load (slowest charge rate)
- * 500 mA -- usb high power (fast battery charge)
- */
-int tps65010_set_vbus_draw(unsigned mA)
-{
-       unsigned long   flags;
-
-       if (!the_tps)
-               return -ENODEV;
-
-       /* assumes non-SMP */
-       local_irq_save(flags);
-       if (mA >= 500)
-               mA = 500;
-       else if (mA >= 100)
-               mA = 100;
-       else
-               mA = 0;
-       the_tps->vbus = mA;
-       if ((the_tps->chgstatus & TPS_CHG_USB)
-                       && test_and_set_bit(
-                               FLAG_VBUS_CHANGED, &the_tps->flags)) {
-               /* gadget drivers call this in_irq() */
-               (void) schedule_work(&the_tps->work);
-       }
-       local_irq_restore(flags);
-
-       return 0;
-}
-EXPORT_SYMBOL(tps65010_set_vbus_draw);
-
-/*-------------------------------------------------------------------------*/
-/* tps65010_set_gpio_out_value parameter:
- * gpio:  GPIO1, GPIO2, GPIO3 or GPIO4
- * value: LOW or HIGH
- */
-int tps65010_set_gpio_out_value(unsigned gpio, unsigned value)
-{
-       int      status;
-       unsigned defgpio;
-
-       if (!the_tps)
-               return -ENODEV;
-       if ((gpio < GPIO1) || (gpio > GPIO4))
-               return -EINVAL;
-       
-       down(&the_tps->lock);
-
-       defgpio = i2c_smbus_read_byte_data(&the_tps->client, TPS_DEFGPIO);
-
-       /* Configure GPIO for output */
-       defgpio |= 1 << (gpio + 3);
-       
-       /* Writing 1 forces a logic 0 on that GPIO and vice versa */
-       switch (value) {
-       case LOW:
-               defgpio |= 1 << (gpio - 1);    /* set GPIO low by writing 1 */
-               break;
-       /* case HIGH: */
-       default:
-               defgpio &= ~(1 << (gpio - 1)); /* set GPIO high by writing 0 */
-               break;
-       }
-       
-       status = i2c_smbus_write_byte_data(&the_tps->client,
-               TPS_DEFGPIO, defgpio);
-
-       pr_debug("%s: gpio%dout = %s, defgpio 0x%02x\n", DRIVER_NAME,
-               gpio, value ? "high" : "low",
-               i2c_smbus_read_byte_data(&the_tps->client, TPS_DEFGPIO));
-       
-       up(&the_tps->lock);
-       return status;
-}
-EXPORT_SYMBOL(tps65010_set_gpio_out_value);
-
-/*-------------------------------------------------------------------------*/
-/* tps65010_set_led parameter:
- * led:  LED1 or LED2
- * mode: ON, OFF or BLINK
- */
-int tps65010_set_led(unsigned led, unsigned mode)
-{
-       int      status;
-       unsigned led_on, led_per, offs;
-
-       if (!the_tps)
-               return -ENODEV;
-
-       if(led == LED1)
-               offs = 0;
-       else {
-               offs = 2;
-               led = LED2;
-       }
-
-       down(&the_tps->lock);
-
-       dev_dbg (&the_tps->client.dev, "led%i_on   0x%02x\n", led,
-               i2c_smbus_read_byte_data(&the_tps->client, TPS_LED1_ON + offs));
-
-       dev_dbg (&the_tps->client.dev, "led%i_per  0x%02x\n", led,
-               i2c_smbus_read_byte_data(&the_tps->client, TPS_LED1_PER + offs));
-       
-       switch (mode) {
-       case OFF:
-               led_on  = 1 << 7;
-               led_per = 0 << 7;
-               break;
-       case ON:
-               led_on  = 1 << 7;
-               led_per = 1 << 7;
-               break;
-       case BLINK:
-               led_on  = 0x30 | (0 << 7);
-               led_per = 0x08 | (1 << 7);
-               break;
-       default:
-               printk(KERN_ERR "%s: Wrong mode parameter for tps65010_set_led()\n", 
-                      DRIVER_NAME);
-               up(&the_tps->lock);
-               return -EINVAL;
-       }
-
-       status = i2c_smbus_write_byte_data(&the_tps->client,
-                       TPS_LED1_ON + offs, led_on);
-
-       if (status != 0) {
-               printk(KERN_ERR "%s: Failed to write led%i_on register\n", 
-                      DRIVER_NAME, led);
-               up(&the_tps->lock);
-               return status;
-       } 
-
-       dev_dbg (&the_tps->client.dev, "led%i_on   0x%02x\n", led,
-               i2c_smbus_read_byte_data(&the_tps->client, TPS_LED1_ON + offs));
-
-       status = i2c_smbus_write_byte_data(&the_tps->client,
-                       TPS_LED1_PER + offs, led_per);
-
-       if (status != 0) {
-               printk(KERN_ERR "%s: Failed to write led%i_per register\n", 
-                      DRIVER_NAME, led);
-               up(&the_tps->lock);
-               return status;
-       }
-
-       dev_dbg (&the_tps->client.dev, "led%i_per  0x%02x\n", led,
-               i2c_smbus_read_byte_data(&the_tps->client, TPS_LED1_PER + offs));
-
-       up(&the_tps->lock);
-
-       return status;
-}
-EXPORT_SYMBOL(tps65010_set_led);
-
-/*-------------------------------------------------------------------------*/
-/* tps65010_set_vib parameter:
- * value: ON or OFF
- */
-int tps65010_set_vib(unsigned value)
-{
-       int      status;
-       unsigned vdcdc2;
-
-       if (!the_tps)
-               return -ENODEV;
-
-       down(&the_tps->lock);
-
-       vdcdc2 = i2c_smbus_read_byte_data(&the_tps->client, TPS_VDCDC2);
-       vdcdc2 &= ~(1 << 1);
-       if (value)
-               vdcdc2 |= (1 << 1);
-       status = i2c_smbus_write_byte_data(&the_tps->client,
-               TPS_VDCDC2, vdcdc2);
-
-       pr_debug("%s: vibrator %s\n", DRIVER_NAME, value ? "on" : "off");
-
-       up(&the_tps->lock);
-       return status;
-}
-EXPORT_SYMBOL(tps65010_set_vib);
-
-/*-------------------------------------------------------------------------*/
-/* tps65010_set_low_pwr parameter:
- * mode: ON or OFF
- */
-int tps65010_set_low_pwr(unsigned mode)
-{
-       int      status;
-       unsigned vdcdc1;
-
-       if (!the_tps)
-               return -ENODEV;
-
-       down(&the_tps->lock);
-
-       pr_debug("%s: %s low_pwr, vdcdc1 0x%02x\n", DRIVER_NAME,
-               mode ? "enable" : "disable",
-               i2c_smbus_read_byte_data(&the_tps->client, TPS_VDCDC1));
-
-       vdcdc1 = i2c_smbus_read_byte_data(&the_tps->client, TPS_VDCDC1);
-       
-       switch (mode) {
-       case OFF:
-               vdcdc1 &= ~TPS_ENABLE_LP; /* disable ENABLE_LP bit */
-               break;
-       /* case ON: */
-       default:
-               vdcdc1 |= TPS_ENABLE_LP;  /* enable ENABLE_LP bit */
-               break;
-       }
-
-       status = i2c_smbus_write_byte_data(&the_tps->client,
-                       TPS_VDCDC1, vdcdc1);
-
-       if (status != 0)
-               printk(KERN_ERR "%s: Failed to write vdcdc1 register\n", 
-                      DRIVER_NAME);
-       else
-               pr_debug("%s: vdcdc1 0x%02x\n", DRIVER_NAME,
-                       i2c_smbus_read_byte_data(&the_tps->client, TPS_VDCDC1));
-
-       up(&the_tps->lock);
-
-       return status;
-}
-EXPORT_SYMBOL(tps65010_set_low_pwr);
-
-/*-------------------------------------------------------------------------*/
-/* tps65010_config_vregs1 parameter:
- * value to be written to VREGS1 register
- * Note: The complete register is written, set all bits you need
- */
-int tps65010_config_vregs1(unsigned value)
-{
-       int      status;
-
-       if (!the_tps)
-               return -ENODEV;
-
-       down(&the_tps->lock);
-
-       pr_debug("%s: vregs1 0x%02x\n", DRIVER_NAME, 
-                       i2c_smbus_read_byte_data(&the_tps->client, TPS_VREGS1));
-
-       status = i2c_smbus_write_byte_data(&the_tps->client,
-                       TPS_VREGS1, value);
-
-       if (status != 0)
-               printk(KERN_ERR "%s: Failed to write vregs1 register\n", 
-                       DRIVER_NAME);
-       else
-               pr_debug("%s: vregs1 0x%02x\n", DRIVER_NAME,
-                       i2c_smbus_read_byte_data(&the_tps->client, TPS_VREGS1));
-
-       up(&the_tps->lock);
-
-       return status;
-}
-EXPORT_SYMBOL(tps65010_config_vregs1);
-
-/*-------------------------------------------------------------------------*/
-/* tps65013_set_low_pwr parameter:
- * mode: ON or OFF
- */
-
-/* FIXME: Assumes AC or USB power is present. Setting AUA bit is not
-       required if power supply is through a battery */
-
-int tps65013_set_low_pwr(unsigned mode)
-{
-       int      status;
-       unsigned vdcdc1, chgconfig;
-
-       if (!the_tps || the_tps->por)
-               return -ENODEV;
-
-       down(&the_tps->lock);
-
-       pr_debug("%s: %s low_pwr, chgconfig 0x%02x vdcdc1 0x%02x\n",
-               DRIVER_NAME,
-               mode ? "enable" : "disable",
-               i2c_smbus_read_byte_data(&the_tps->client, TPS_CHGCONFIG),
-               i2c_smbus_read_byte_data(&the_tps->client, TPS_VDCDC1));
-
-       chgconfig = i2c_smbus_read_byte_data(&the_tps->client, TPS_CHGCONFIG);
-       vdcdc1 = i2c_smbus_read_byte_data(&the_tps->client, TPS_VDCDC1);
-
-       switch (mode) {
-       case OFF:
-               chgconfig &= ~TPS65013_AUA; /* disable AUA bit */
-               vdcdc1 &= ~TPS_ENABLE_LP; /* disable ENABLE_LP bit */
-               break;
-       /* case ON: */
-       default:
-               chgconfig |= TPS65013_AUA;  /* enable AUA bit */
-               vdcdc1 |= TPS_ENABLE_LP;  /* enable ENABLE_LP bit */
-               break;
-       }
-
-       status = i2c_smbus_write_byte_data(&the_tps->client,
-                       TPS_CHGCONFIG, chgconfig);
-       if (status != 0) {
-               printk(KERN_ERR "%s: Failed to write chconfig register\n",
-        DRIVER_NAME);
-               up(&the_tps->lock);
-               return status;
-       }
-
-       chgconfig = i2c_smbus_read_byte_data(&the_tps->client, TPS_CHGCONFIG);
-       the_tps->chgconf = chgconfig;
-       show_chgconfig(0, "chgconf", chgconfig);
-
-       status = i2c_smbus_write_byte_data(&the_tps->client,
-                       TPS_VDCDC1, vdcdc1);
-
-       if (status != 0)
-               printk(KERN_ERR "%s: Failed to write vdcdc1 register\n",
-        DRIVER_NAME);
-       else
-               pr_debug("%s: vdcdc1 0x%02x\n", DRIVER_NAME,
-                       i2c_smbus_read_byte_data(&the_tps->client, TPS_VDCDC1));
-
-       up(&the_tps->lock);
-
-       return status;
-}
-EXPORT_SYMBOL(tps65013_set_low_pwr);
-
-/*-------------------------------------------------------------------------*/
-
-static int __init tps_init(void)
-{
-       u32     tries = 3;
-       int     status = -ENODEV;
-
-       printk(KERN_INFO "%s: version %s\n", DRIVER_NAME, DRIVER_VERSION);
-
-       /* some boards have startup glitches */
-       while (tries--) {
-               status = i2c_add_driver(&tps65010_driver);
-               if (the_tps)
-                       break;
-               i2c_del_driver(&tps65010_driver);
-               if (!tries) {
-                       printk(KERN_ERR "%s: no chip?\n", DRIVER_NAME);
-                       return -ENODEV;
-               }
-               pr_debug("%s: re-probe ...\n", DRIVER_NAME);
-               msleep(10);
-       }
-
-#if defined(CONFIG_ARM)
-       if (machine_is_omap_osk()) {
-
-               // FIXME: More should be placed in the initialization code
-               //        of the submodules (DSP, ethernet, power management,
-               //        board-osk.c). Careful: I2C is initialized "late".
-
-               /* Let LED1 (D9) blink */
-               tps65010_set_led(LED1, BLINK);
-
-               /* Disable LED 2 (D2) */
-               tps65010_set_led(LED2, OFF);
-
-               /* Set GPIO 1 HIGH to disable VBUS power supply;
-                * OHCI driver powers it up/down as needed.
-                */
-               tps65010_set_gpio_out_value(GPIO1, HIGH);
-
-               /* Set GPIO 2 low to turn on LED D3 */
-               tps65010_set_gpio_out_value(GPIO2, HIGH);
-
-               /* Set GPIO 3 low to take ethernet out of reset */
-               tps65010_set_gpio_out_value(GPIO3, LOW);
-
-               /* gpio4 for VDD_DSP */
-
-               /* Enable LOW_PWR */
-               tps65010_set_low_pwr(ON);
-
-               /* Switch VLDO2 to 3.0V for AIC23 */
-               tps65010_config_vregs1(TPS_LDO2_ENABLE | TPS_VLDO2_3_0V | TPS_LDO1_ENABLE);
-
-       } else if (machine_is_omap_h2()) {
-               /* gpio3 for SD, gpio4 for VDD_DSP */
-
-               /* Enable LOW_PWR */
-               tps65010_set_low_pwr(ON);
-       } else if (machine_is_omap_h3()) {
-               /* gpio4 for SD, gpio3 for VDD_DSP */
-#ifdef CONFIG_PM
-               /* FIXME: Enable LOW_PWR hangs H3 */
-               //tps65013_set_low_pwr(ON);
-#endif
-       }
-#endif
-
-       return status;
-}
-/* NOTE:  this MUST be initialized before the other parts of the system
- * that rely on it ... but after the i2c bus on which this relies.
- * That is, much earlier than on PC-type systems, which don't often use
- * I2C as a core system bus.
- */
-subsys_initcall(tps_init);
-
-static void __exit tps_exit(void)
-{
-       i2c_del_driver(&tps65010_driver);
-}
-module_exit(tps_exit);
-