Merge "dev: pmic: pm8x41 : Add api to get boot type"
diff --git a/app/aboot/aboot.c b/app/aboot/aboot.c
index 86cbadc..a006ab1 100644
--- a/app/aboot/aboot.c
+++ b/app/aboot/aboot.c
@@ -73,6 +73,7 @@
 extern void dsb();
 extern void isb();
 extern void platform_uninit(void);
+extern void target_uninit(void);
 
 void write_device_info_mmc(device_info *dev);
 void write_device_info_flash(device_info *dev);
@@ -491,6 +492,9 @@
 	generate_atags(tags, final_cmdline, ramdisk, ramdisk_size);
 #endif
 
+	/* Perform target specific cleanup */
+	target_uninit();
+
 	dprintf(INFO, "booting linux @ %p, ramdisk @ %p (%d), tags/device tree @ %p\n",
 		entry, ramdisk, ramdisk_size, tags_phys);
 
@@ -2053,7 +2057,14 @@
 	fastboot_publish("product", TARGET(BOARD));
 	fastboot_publish("kernel", "lk");
 	fastboot_publish("serialno", sn_buf);
-	publish_getvar_partition_info(part_info, ARRAY_SIZE(part_info));
+	/*
+	 * fastboot publish is supported only for emmc partitions
+	 * Calling this for NAND prints some error messages which
+	 * is harmless but misleading. Avoid calling this for NAND
+	 * devices.
+	 */
+	if (target_is_emmc_boot())
+		publish_getvar_partition_info(part_info, ARRAY_SIZE(part_info));
 	/* Max download size supported */
 	snprintf(max_download_size, MAX_RSP_SIZE, "\t0x%x", sz);
 	fastboot_publish("max-download-size", (const char *) max_download_size);
diff --git a/dev/gcdb/display/gcdb_autopll.c b/dev/gcdb/display/gcdb_autopll.c
new file mode 100755
index 0000000..5cbe292
--- /dev/null
+++ b/dev/gcdb/display/gcdb_autopll.c
@@ -0,0 +1,185 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+#include <debug.h>
+#include <err.h>
+#include <smem.h>
+#include <msm_panel.h>
+#include <mipi_dsi.h>
+
+#include "gcdb_autopll.h"
+
+static struct mdss_dsi_pll_config pll_data;
+
+static uint32_t calculate_bitclock(struct msm_panel_info *pinfo)
+{
+	uint32_t ret = NO_ERROR;
+	uint32_t h_period = 0, v_period = 0;
+
+	h_period = pinfo->xres + pinfo->lcdc.h_back_porch +
+		pinfo->lcdc.h_front_porch + pinfo->lcdc.h_pulse_width +
+		pinfo->lcdc.xres_pad;
+
+	v_period = pinfo->yres + pinfo->lcdc.v_back_porch +
+		pinfo->lcdc.v_front_porch + pinfo->lcdc.v_pulse_width +
+		pinfo->lcdc.yres_pad;
+
+	/* Pixel clock rate */
+	pll_data.pixel_clock = h_period * v_period * pinfo->mipi.frame_rate;
+
+	/* Store all bit clock form data */
+	if (pinfo->mipi.bitclock == 0)
+		pll_data.bit_clock = (pll_data.pixel_clock * pinfo->bpp) /
+					pinfo->mipi.num_of_lanes;
+	else
+		pll_data.bit_clock = pinfo->mipi.bitclock;
+
+	pll_data.byte_clock = pll_data.bit_clock >> 3;
+
+	pll_data.halfbit_clock = pll_data.bit_clock >> 1;
+
+	return ret;
+}
+
+static uint32_t calculate_div1()
+{
+	uint32_t ret = NO_ERROR;
+
+	/* div1 - there is divide by 2 logic present */
+	if (pll_data.halfbit_clock > HALFBIT_CLOCK1) {
+		pll_data.posdiv1    = 0x0; /*div 1 */
+		pll_data.vco_clock  = pll_data.halfbit_clock << 1;
+	} else if (pll_data.halfbit_clock > HALFBIT_CLOCK2) {
+		pll_data.posdiv1    = 0x1; /*div 2 */
+		pll_data.vco_clock  = pll_data.halfbit_clock << 2;
+	} else if (pll_data.halfbit_clock > HALFBIT_CLOCK3) {
+		pll_data.posdiv1    = 0x3; /*div 4 */
+		pll_data.vco_clock  = pll_data.halfbit_clock << 3;
+	} else if (pll_data.halfbit_clock > HALFBIT_CLOCK4) {
+		pll_data.posdiv1    = 0x4; /*div 5 */
+		pll_data.vco_clock  = pll_data.halfbit_clock * 10;
+	} else {
+		dprintf(CRITICAL, "Not able to calculate posdiv1\n");
+	}
+
+	return ret;
+}
+
+static uint32_t calculate_div3(uint8_t bpp, uint8_t num_of_lanes)
+{
+	uint32_t ret = NO_ERROR;
+	pll_data.pclk_m = 0x1; /* M = 1, N= 1 */
+	pll_data.pclk_n = 0xFF; /* ~ (N-M) = 0xff */
+	pll_data.pclk_d = 0xFF; /* ~N = 0xFF */
+
+	/* formula is ( vco_clock / pdiv_digital) / mnd = pixel_clock */
+
+	/* div3  */
+	switch (bpp) {
+	case BITS_18:
+		if (num_of_lanes == 3) {
+			pll_data.posdiv3 = pll_data.vco_clock /
+					 pll_data.pixel_clock;
+		} else {
+			pll_data.posdiv3 = (pll_data.pixel_clock * 2 / 9) /
+					 pll_data.vco_clock;
+			pll_data.pclk_m = 0x2; /* M = 2,N = 9 */
+			pll_data.pclk_n = 0xF8;
+			pll_data.pclk_d = 0xF6;
+		}
+		break;
+	case BITS_16:
+		if (num_of_lanes == 3) {
+			pll_data.posdiv3 = (pll_data.pixel_clock * 3 / 8) /
+					 pll_data.vco_clock;
+			pll_data.pclk_m = 0x3; /* M = 3, N = 9 */
+			pll_data.pclk_n = 0xFA;
+			pll_data.pclk_d = 0xF7;
+		} else {
+			pll_data.posdiv3 = pll_data.vco_clock /
+					 pll_data.pixel_clock;
+		}
+		break;
+	case BITS_24:
+	default:
+		pll_data.posdiv3 = pll_data.vco_clock /
+					 pll_data.pixel_clock;
+		break;
+	}
+
+	pll_data.posdiv3--;	/* Register needs one value less */
+}
+
+static uint32_t calculate_vco(uint8_t bpp, uint8_t num_of_lanes)
+{
+	uint32_t ret = NO_ERROR;
+	uint8_t  counter = 0;
+	uint32_t temprate = 0;
+
+	/* If half bitclock is more than VCO min value */
+	if (pll_data.halfbit_clock > VCO_MIN_CLOCK) {
+
+		/* Direct Mode */
+
+		/* support vco clock to max value only */
+		if (pll_data.halfbit_clock > VCO_MAX_CLOCK)
+			pll_data.vco_clock = VCO_MAX_CLOCK;
+		else
+			pll_data.vco_clock = pll_data.halfbit_clock;
+		pll_data.directpath = 0x0;
+		pll_data.posdiv1    = 0x0; /*DSI spec says 0 - div 1 */
+					    /*1 - div 2 */
+					    /*F - div 16 */
+	} else {
+		/* Indirect Mode */
+
+		pll_data.directpath = 0x02; /* set bit 1 to enable for
+						 indirect path */
+
+		calculate_div1();
+	}
+
+	/* calculate mnd and div3 for direct and indirect path */
+	calculate_div3(bpp, num_of_lanes);
+
+	return ret;
+}
+
+uint32_t calculate_clock_config(struct msm_panel_info *pinfo)
+{
+	uint32_t ret = NO_ERROR;
+
+	calculate_bitclock(pinfo);
+
+	calculate_vco(pinfo->bpp, pinfo->mipi.num_of_lanes);
+
+	pinfo->mipi.dsi_pll_config = &pll_data;
+
+	return ret;
+}
diff --git a/dev/gcdb/display/gcdb_autopll.h b/dev/gcdb/display/gcdb_autopll.h
new file mode 100755
index 0000000..259abd6
--- /dev/null
+++ b/dev/gcdb/display/gcdb_autopll.h
@@ -0,0 +1,56 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+#ifndef _GCDB_AUTOPLL_H_
+#define _GCDB_AUTOPLL_H_
+
+/*---------------------------------------------------------------------------*/
+/* HEADER files                                                              */
+/*---------------------------------------------------------------------------*/
+#include <debug.h>
+
+#define VCO_MIN_CLOCK 350000000
+#define VCO_MAX_CLOCK 750000000
+
+#define HALFBIT_CLOCK1 175000000 /* VCO min clock div by 2 */
+#define HALFBIT_CLOCK2 88000000  /* VCO min clock div by 4 */
+#define HALFBIT_CLOCK3 44000000  /* VCO min clock div by 8 */
+#define HALFBIT_CLOCK4 40000000  /* VCO min clock div by 9 */
+
+#define BITS_24 24
+#define BITS_18 18
+#define BITS_16 16
+
+/*---------------------------------------------------------------------------*/
+/* Structure definition                                                      */
+/*---------------------------------------------------------------------------*/
+
+uint32_t calculate_clock_config(struct msm_panel_info *pinfo);
+
+#endif /*_GCDB_AUTOPLL_H_ */
diff --git a/dev/gcdb/display/gcdb_display.c b/dev/gcdb/display/gcdb_display.c
new file mode 100755
index 0000000..e117ba2
--- /dev/null
+++ b/dev/gcdb/display/gcdb_display.c
@@ -0,0 +1,200 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+#include <debug.h>
+#include <err.h>
+#include <smem.h>
+#include <msm_panel.h>
+#include <board.h>
+#include <mdp5.h>
+#include <platform/gpio.h>
+#include <mipi_dsi.h>
+
+#include "include/display_resource.h"
+#include "include/panel.h"
+#include "panel_display.h"
+#include "gcdb_display.h"
+#include "target/display.h"
+#include "gcdb_autopll.h"
+
+/*---------------------------------------------------------------------------*/
+/* static                                                                    */
+/*---------------------------------------------------------------------------*/
+static struct msm_fb_panel_data panel;
+struct panel_struct panelstruct;
+static uint8_t display_enable;
+static struct mdss_dsi_phy_ctrl dsi_video_mode_phy_db;
+
+
+/*---------------------------------------------------------------------------*/
+/* Extern                                                                    */
+/*---------------------------------------------------------------------------*/
+extern int msm_display_init(struct msm_fb_panel_data *pdata);
+extern int msm_display_off();
+
+static uint32_t panel_backlight_ctrl(uint8_t enable)
+{
+	uint32_t ret = NO_ERROR;
+
+	ret = target_backlight_ctrl(enable);
+
+	return ret;
+}
+
+static uint32_t mdss_dsi_panel_reset(uint8_t enable)
+{
+	uint32_t ret = NO_ERROR;
+
+	ret = target_panel_reset(enable, &reset_gpio,
+			 &enable_gpio, &reset_sequence);
+
+	return ret;
+}
+
+static uint32_t mdss_dsi_panel_clock(uint8_t enable,
+				struct msm_panel_info *pinfo)
+{
+	uint32_t ret = NO_ERROR;
+
+	ret = calculate_clock_config(pinfo);
+	if (ret) {
+		dprintf(CRITICAL, "Clock calculation failed \n");
+		/* should it stop here ? check with display team */
+	}
+
+	ret = target_panel_clock(enable, pinfo);
+
+	return ret;
+}
+
+static int mdss_dsi_panel_power(uint8_t enable)
+{
+	int ret = NO_ERROR;
+
+	if (enable) {
+
+		/* Enable backlight */
+		ret = panel_backlight_ctrl(enable);
+		if (ret) {
+			dprintf(CRITICAL, "Backlight enable failed \n");
+			return ret;
+		}
+		ret = target_ldo_ctrl(enable, ldo_entry_array,
+						 TOTAL_LDO_DEFINED);
+		if (ret) {
+			dprintf(CRITICAL, "LDO control enable failed \n");
+			return ret;
+		}
+
+		/* Panel Reset */
+		ret = mdss_dsi_panel_reset(enable);
+		if (ret) {
+			dprintf(CRITICAL, "panel reset failed \n");
+			return ret;
+		}
+		dprintf(SPEW, "Panel power on done\n");
+	} else {
+		/* Disable panel, backlight and ldo */
+		ret = mdss_dsi_panel_reset(enable);
+		if (ret) {
+			dprintf(CRITICAL, "panel reset disable failed \n");
+			return ret;
+		}
+
+		ret = panel_backlight_ctrl(enable);
+		if (ret) {
+			dprintf(CRITICAL, "Backlight disable failed \n");
+			return ret;
+		}
+
+		ret = target_ldo_ctrl(enable, ldo_entry_array,
+						TOTAL_LDO_DEFINED);
+		if (ret) {
+			dprintf(CRITICAL, "ldo control disable failed \n");
+			return ret;
+		}
+		dprintf(SPEW, "Panel power off done\n");
+	}
+
+	return ret;
+}
+
+static void init_platform_data()
+{
+	memcpy(dsi_video_mode_phy_db.regulator, panel_regulator_settings,
+							REGULATOR_SIZE);
+	memcpy(dsi_video_mode_phy_db.ctrl, panel_physical_ctrl,
+							PHYSICAL_SIZE);
+	memcpy(dsi_video_mode_phy_db.strength, panel_strength_ctrl,
+							STRENGTH_SIZE);
+	memcpy(dsi_video_mode_phy_db.bistCtrl, panel_bist_ctrl, BIST_SIZE);
+	memcpy(dsi_video_mode_phy_db.laneCfg, panel_lane_config, LANE_SIZE);
+}
+
+void gcdb_display_init(uint32_t rev, void *base)
+{
+
+	if (!oem_panel_select(&panelstruct, &(panel.panel_info),
+				 &dsi_video_mode_phy_db)) {
+		dprintf(CRITICAL, "Target panel init not found!\n");
+		return;
+	}
+
+	init_platform_data();
+
+	if (dsi_panel_init(&(panel.panel_info), &panelstruct)) {
+		dprintf(CRITICAL, "DSI panel init failed!\n");
+		return;
+	}
+
+	panel.panel_info.mipi.mdss_dsi_phy_db = &dsi_video_mode_phy_db;
+
+	panel.pll_clk_func = mdss_dsi_panel_clock;
+	panel.power_func = mdss_dsi_panel_power;
+	panel.fb.base = base;
+	panel.fb.width =  panel.panel_info.xres;
+	panel.fb.height =  panel.panel_info.yres;
+	panel.fb.stride =  panel.panel_info.xres;
+	panel.fb.bpp =  panel.panel_info.bpp;
+	panel.fb.format = panel.panel_info.mipi.dst_format;
+	panel.mdp_rev = rev;
+
+	if (msm_display_init(&panel)) {
+		dprintf(CRITICAL, "Display init failed!\n");
+		return;
+	}
+
+	display_enable = 1;
+}
+
+void gcdb_display_shutdown(void)
+{
+	if (display_enable)
+		msm_display_off();
+}
diff --git a/dev/gcdb/display/gcdb_display.h b/dev/gcdb/display/gcdb_display.h
new file mode 100755
index 0000000..dd6a6a8
--- /dev/null
+++ b/dev/gcdb/display/gcdb_display.h
@@ -0,0 +1,62 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+#ifndef _GCDB_DISPLAY_H_
+#define _GCDB_DISPLAY_H_
+
+/*---------------------------------------------------------------------------*/
+/* HEADER files                                                              */
+/*---------------------------------------------------------------------------*/
+#include <debug.h>
+#include "include/display_resource.h"
+
+#define TIMING_SIZE 48
+#define REGULATOR_SIZE 28
+#define PHYSICAL_SIZE 16
+#define STRENGTH_SIZE 8
+#define BIST_SIZE 6
+#define LANE_SIZE 45
+
+/*---------------------------------------------------------------------------*/
+/* API                                                                       */
+/*---------------------------------------------------------------------------*/
+
+int target_backlight_ctrl(uint8_t enable);
+int target_panel_clock(uint8_t enable, struct msm_panel_info *pinfo);
+int target_panel_reset(uint8_t enable,
+				struct gpio_pin *resetgpio,
+				struct gpio_pin *enablegpio,
+				struct panel_reset_sequence *resetseq);
+int target_ldo_ctrl(uint8_t enable, struct ldo_entry ldo_entry_array[],
+				uint8_t totalldo);
+
+void gcdb_display_init(unsigned int rev, void *base);
+void gcdb_display_shutdown();
+
+#endif /*_GCDB_DISPLAY_H_ */
diff --git a/dev/gcdb/display/include/display_resource.h b/dev/gcdb/display/include/display_resource.h
new file mode 100755
index 0000000..24a375d
--- /dev/null
+++ b/dev/gcdb/display/include/display_resource.h
@@ -0,0 +1,80 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+#ifndef _DISPLAY_RESOURCE_H_
+#define _DISPLAY_RESOURCE_H_
+
+/*---------------------------------------------------------------------------*/
+/* HEADER files                                                              */
+/*---------------------------------------------------------------------------*/
+#include <debug.h>
+#include <smem.h>
+#include <board.h>
+
+#define TOTAL_RESET_GPIO_CTRL 5
+
+#define TOTAL_LDO_CTRL 5
+
+/*---------------------------------------------------------------------------*/
+/* Structure definition                                                      */
+/*---------------------------------------------------------------------------*/
+
+/*GPIO pin structure to define reset pin, enable pin, te pin, etc. */
+typedef struct gpio_pin{
+
+	char    *pin_source;
+	uint32_t pin_id;
+	uint32_t pin_strength;
+	uint32_t pin_direction;
+	uint32_t pin_pull;
+	uint32_t pin_state;
+};
+
+typedef struct panel_reset_sequence {
+
+	uint8_t  pin_state[TOTAL_RESET_GPIO_CTRL];
+	uint32_t sleep[TOTAL_RESET_GPIO_CTRL];
+	uint8_t  pin_direction;
+};
+
+/*LDO entry structure for different LDO entries. */
+typedef struct ldo_entry{
+	char    *ldo_name;
+	uint32_t ldo_id;
+	uint32_t ldo_type;
+	uint32_t ldo_voltage;
+	uint32_t ldo_enable_load;
+	uint32_t ldo_disable_load;
+	uint32_t ldo_preon_sleep;
+	uint32_t ldo_poston_sleep;
+	uint32_t ldo_preoff_sleep;
+	uint32_t ldo_postoff_sleep;
+};
+
+#endif /*_DISPLAY_RESOURCE_H_ */
diff --git a/dev/gcdb/display/include/panel.h b/dev/gcdb/display/include/panel.h
new file mode 100755
index 0000000..726af88
--- /dev/null
+++ b/dev/gcdb/display/include/panel.h
@@ -0,0 +1,155 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+#ifndef _PANEL_H_
+#define _PANEL_H_
+
+/*---------------------------------------------------------------------------*/
+/* HEADER files                                                              */
+/*---------------------------------------------------------------------------*/
+#include <debug.h>
+#include <smem.h>
+
+/*---------------------------------------------------------------------------*/
+/* Structure definition                                                      */
+/*---------------------------------------------------------------------------*/
+
+/*Panel Configuration */
+typedef struct panel_config{
+
+	char  *panel_name;
+	char  *panel_controller;
+	char  *panel_compatible;
+	uint16_t panel_interface;
+	uint16_t panel_type;
+	char   *panel_destination;
+	uint32_t panel_orientation;
+	uint32_t panel_clockrate;
+	uint16_t panel_framerate;
+	uint16_t panel_channelid;
+	uint16_t dsi_virtualchannel_id;
+	uint16_t panel_broadcast_mode;
+	uint16_t dsi_lp11_atinit;
+	uint16_t dsi_initmaster_time;
+	uint16_t dsi_stream;
+	uint8_t  interleave_mode;
+	uint32_t panel_bitclock_freq;
+	uint32_t panel_operating_mode;
+	uint32_t panel_with_enable_gpio;
+};
+
+typedef struct panel_resolution{
+
+	uint16_t panel_width;
+	uint16_t panel_height;
+	uint16_t hfront_porch;
+	uint16_t hback_porch;
+	uint16_t hpulse_width;
+	uint16_t hsync_skew;
+	uint16_t vfront_porch;
+	uint16_t vback_porch;
+	uint16_t vpulse_width;
+	uint16_t hleft_border;
+	uint16_t hright_border;
+	uint16_t vtop_border;
+	uint16_t vbottom_border;
+	uint16_t hactive_res;
+	uint16_t vactive_res;
+	uint16_t invert_data_polarity;
+	uint16_t invert_vsync_polarity;
+	uint16_t invert_hsync_polarity;
+};
+
+typedef struct color_info{
+	uint8_t  color_format;
+	uint8_t  color_order;
+	uint8_t  underflow_color;
+	uint8_t  border_color;
+	uint8_t  pixel_packing;
+	uint8_t  pixel_alignment;
+};
+
+typedef struct command_state {
+	uint8_t oncommand_state;
+	uint8_t offcommand_state;
+};
+
+typedef struct videopanel_info {
+	uint8_t hsync_pulse;
+	uint8_t hfp_power_mode;
+	uint8_t hbp_power_mode;
+	uint8_t hsa_power_mode;
+	uint8_t bllp_eof_power_mode;
+	uint8_t bllp_power_mode;
+	uint8_t traffic_mode;
+	uint8_t dma_delayafter_vsync;
+	uint32_t  bllp_eof_power;
+};
+
+typedef struct commandpanel_info {
+	uint8_t techeck_enable;
+	uint8_t tepin_select;
+	uint8_t teusing_tepin;
+	uint8_t autorefresh_enable;
+	uint32_t autorefresh_framenumdiv;
+	uint32_t tevsync_rdptr_irqline;
+	uint32_t tevsync_continue_lines;
+	uint32_t tevsync_startline_divisor;
+	uint32_t tepercent_variance;
+	uint8_t tedcs_command;
+	uint8_t disable_eotafter_hsxfer;
+	uint32_t cmdmode_idletime;
+};
+
+typedef struct lane_configuration {
+	uint8_t dsi_lanes;
+	uint8_t dsi_lanemap;
+	uint8_t lane0_state;
+	uint8_t lane1_state;
+	uint8_t lane2_state;
+	uint8_t lane3_state;
+};
+
+typedef struct panel_timing {
+	uint8_t dsi_mdp_trigger;
+	uint8_t dsi_dma_trigger;
+	uint8_t tclk_post;
+	uint8_t tclk_pre;
+};
+
+typedef struct backlight {
+	uint16_t bl_interface_type;
+	uint16_t bl_min_level;
+	uint16_t bl_max_level;
+	uint16_t bl_step;
+	uint16_t bl_pmic_controltype;
+	char     *bl_pmic_model;
+};
+
+#endif /*_PANEL_H_ */
diff --git a/dev/gcdb/display/include/panel_nt35590_720p_cmd.h b/dev/gcdb/display/include/panel_nt35590_720p_cmd.h
new file mode 100755
index 0000000..59fe531
--- /dev/null
+++ b/dev/gcdb/display/include/panel_nt35590_720p_cmd.h
@@ -0,0 +1,2935 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+/*---------------------------------------------------------------------------
+ * This file is autogenerated file using gcdb parser. Please do not edit it.
+ * Update input XML file to add a new entry or update variable in this file
+ * VERSION = "1.0"
+ *---------------------------------------------------------------------------*/
+
+#ifndef _PANEL_NT35590_720P_CMD_H_
+
+#define _PANEL_NT35590_720P_CMD_H_
+/*---------------------------------------------------------------------------*/
+/* HEADER files                                                              */
+/*---------------------------------------------------------------------------*/
+#include "panel.h"
+
+/*---------------------------------------------------------------------------*/
+/* Panel configuration                                                       */
+/*---------------------------------------------------------------------------*/
+
+static struct panel_config nt35590_720p_cmd_panel_data = {
+  "nt25590 720p command mode dsi panel", "mdss_dsi0", "qcom,mdss-dsi-panel",
+  10, 1, "DISPLAY_1", 0, 424000000, 60, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel resolution                                                          */
+/*---------------------------------------------------------------------------*/
+static struct panel_resolution nt35590_720p_cmd_panel_res = {
+  720, 1280, 140, 164, 8, 0, 6, 1, 1, 0, 0, 0, 0, 0, 0, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel Color Information                                                   */
+/*---------------------------------------------------------------------------*/
+static struct color_info nt35590_720p_cmd_color = {
+  24, 0, 0xff, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel Command information                                                 */
+/*---------------------------------------------------------------------------*/
+static char nt35590_720p_cmd_on_cmd0[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0xEE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd1[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x26, 0x08, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd2[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x26, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd3[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd4[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBA, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd5[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC2, 0x08, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd6[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd7[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd8[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x00, 0x4A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd9[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x01, 0x33, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd10[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x02, 0x53, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd11[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x03, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd12[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x04, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd13[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x05, 0x33, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd14[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x06, 0x22, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd15[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x08, 0x56, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd16[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x09, 0x8F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd17[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x36, 0x73, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd18[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0B, 0x9F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd19[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0C, 0x9F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd20[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0D, 0x2F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd21[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0E, 0x24, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd22[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x83, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd23[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x12, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd24[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x71, 0x2C, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd25[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd26[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0F, 0x0A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd27[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x05, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd28[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd29[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x01, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd30[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x02, 0x8B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd31[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x03, 0x82, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd32[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x04, 0x82, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd33[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x05, 0x30, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd34[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x06, 0x33, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd35[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x07, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd36[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x08, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd37[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x09, 0x46, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd38[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0A, 0x46, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd39[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0D, 0x0B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd40[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0E, 0x1D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd41[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0F, 0x08, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd42[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x10, 0x53, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd43[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd44[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x12, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd45[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x14, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd46[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x15, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd47[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x16, 0x05, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd48[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x17, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd49[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x19, 0x7F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd50[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1A, 0xFF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd51[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1B, 0x0F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd52[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1C, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd53[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd54[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1E, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd55[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1F, 0x07, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd56[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x20, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd57[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x21, 0x06, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd58[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x22, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd59[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x23, 0x4D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd60[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2D, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd61[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x28, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd62[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2F, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd63[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x83, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd64[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9E, 0x58, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd65[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9F, 0x6A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd66[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA0, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd67[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA2, 0x10, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd68[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBB, 0x0A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd69[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBC, 0x0A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd70[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x32, 0x08, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd71[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x33, 0xB8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd72[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x36, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd73[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x37, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd74[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x43, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd75[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4B, 0x21, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd76[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4C, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd77[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x50, 0x21, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd78[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x51, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd79[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x58, 0x21, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd80[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x59, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd81[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5D, 0x21, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd82[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5E, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd83[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6C, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd84[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd85[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd86[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd87[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd88[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x75, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd89[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x76, 0x7D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd90[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x77, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd91[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x78, 0x8A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd92[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x79, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd93[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7A, 0x9C, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd94[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7B, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd95[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7C, 0xB1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd96[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd97[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7E, 0xBF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd98[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7F, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd99[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x80, 0xCF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd100[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x81, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd101[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x82, 0xDD, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd102[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x83, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd103[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x84, 0xE8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd104[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x85, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd105[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x86, 0xF2, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd106[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x87, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd107[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x88, 0x1F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd108[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x89, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd109[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8A, 0x41, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd110[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8B, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd111[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8C, 0x78, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd112[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8D, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd113[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8E, 0xA5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd114[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8F, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd115[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x90, 0xEE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd116[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x91, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd117[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x92, 0x29, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd118[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x93, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd119[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x94, 0x2A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd120[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x95, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd121[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x96, 0x5D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd122[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x97, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd123[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x98, 0x93, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd124[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x99, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd125[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9A, 0xB8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd126[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9B, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd127[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9C, 0xE7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd128[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd129[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9E, 0x07, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd130[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd131[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA0, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd132[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA2, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd133[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA3, 0x46, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd134[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA4, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd135[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA5, 0x56, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd136[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA6, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd137[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA7, 0x66, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd138[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd139[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAA, 0x7A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd140[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd141[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAC, 0x93, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd142[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd143[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAE, 0xA3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd144[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAF, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd145[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB0, 0xB4, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd146[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB1, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd147[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB2, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd148[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB3, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd149[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB4, 0x7D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd150[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB5, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd151[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB6, 0x8A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd152[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB7, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd153[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB8, 0x9C, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd154[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB9, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd155[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBA, 0xB1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd156[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBB, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd157[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBC, 0xBF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd158[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBD, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd159[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBE, 0xCF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd160[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd161[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC0, 0xDD, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd162[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC1, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd163[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC2, 0xE8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd164[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC3, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd165[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC4, 0xF2, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd166[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC5, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd167[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC6, 0x1F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd168[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC7, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd169[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC8, 0x41, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd170[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC9, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd171[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCA, 0x78, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd172[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd173[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCC, 0xA5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd174[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCD, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd175[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCE, 0xEE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd176[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd177[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD0, 0x29, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd178[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD1, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd179[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD2, 0x2A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd180[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD3, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd181[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD4, 0x5D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd182[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD5, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd183[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD6, 0x93, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd184[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD7, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd185[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD8, 0xB8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd186[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD9, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd187[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDA, 0xE7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd188[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd189[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDC, 0x07, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd190[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd191[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDE, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd192[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDF, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd193[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE0, 0x46, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd194[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE1, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd195[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE2, 0x56, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd196[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE3, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd197[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE4, 0x66, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd198[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE5, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd199[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE6, 0x7A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd200[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE7, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd201[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE8, 0x93, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd202[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd203[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEA, 0xA3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd204[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd205[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEC, 0xB4, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd206[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xED, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd207[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEE, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd208[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd209[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF0, 0xED, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd210[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF1, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd211[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF2, 0xF3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd212[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF3, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd213[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF4, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd214[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF5, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd215[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF6, 0x09, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd216[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF7, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd217[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF8, 0x13, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd218[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF9, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd219[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFA, 0x1D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd220[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd221[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd222[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x00, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd223[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x01, 0x26, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd224[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x02, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd225[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x03, 0x2F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd226[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x04, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd227[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x05, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd228[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x06, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd229[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x07, 0x56, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd230[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x08, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd231[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x09, 0x70, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd232[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0A, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd233[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0B, 0x9D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd234[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0C, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd235[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0D, 0xC2, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd236[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0E, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd237[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0F, 0xFF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd238[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x10, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd239[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x31, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd240[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x12, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd241[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x13, 0x32, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd242[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x14, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd243[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x15, 0x60, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd244[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x16, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd245[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x17, 0x94, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd246[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x18, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd247[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x19, 0xB5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd248[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1A, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd249[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1B, 0xE3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd250[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1C, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd251[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd252[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1E, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd253[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1F, 0x2D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd254[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x20, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd255[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x21, 0x3A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd256[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x22, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd257[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x23, 0x48, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd258[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x24, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd259[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x25, 0x57, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd260[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x26, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd261[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x27, 0x68, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd262[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x28, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd263[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x29, 0x7B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd264[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2A, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd265[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2B, 0x90, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd266[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd267[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2F, 0xA0, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd268[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x30, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd269[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x31, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd270[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x32, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd271[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x33, 0xED, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd272[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x34, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd273[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x35, 0xF3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd274[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x36, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd275[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x37, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd276[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x38, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd277[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x39, 0x09, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd278[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3A, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd279[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3B, 0x13, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd280[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3D, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd281[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3F, 0x1D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd282[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x40, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd283[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x41, 0x26, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd284[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x42, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd285[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x43, 0x2F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd286[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x44, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd287[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x45, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd288[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x46, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd289[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x47, 0x56, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd290[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x48, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd291[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x49, 0x70, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd292[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4A, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd293[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4B, 0x9D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd294[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4C, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd295[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4D, 0xC2, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd296[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4E, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd297[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4F, 0xFF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd298[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x50, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd299[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x51, 0x31, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd300[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x52, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd301[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x53, 0x32, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd302[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x54, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd303[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x55, 0x60, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd304[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x56, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd305[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x58, 0x94, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd306[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x59, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd307[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5A, 0xB5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd308[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5B, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd309[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5C, 0xE3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd310[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd311[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5E, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd312[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd313[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x60, 0x2D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd314[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x61, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd315[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x62, 0x3A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd316[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x63, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd317[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x64, 0x48, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd318[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x65, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd319[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x66, 0x57, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd320[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x67, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd321[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x68, 0x68, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd322[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x69, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd323[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6A, 0x7B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd324[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6B, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd325[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6C, 0x90, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd326[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd327[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6E, 0xA0, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd328[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd329[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x70, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd330[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x71, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd331[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x72, 0x19, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd332[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x73, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd333[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x74, 0x36, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd334[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x75, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd335[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x76, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd336[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x77, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd337[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x78, 0x70, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd338[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x79, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd339[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7A, 0x83, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd340[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7B, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd341[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7C, 0x99, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd342[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd343[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7E, 0xA8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd344[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7F, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd345[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x80, 0xB7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd346[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x81, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd347[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x82, 0xC5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd348[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x83, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd349[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x84, 0xF7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd350[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x85, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd351[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x86, 0x1E, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd352[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x87, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd353[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x88, 0x60, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd354[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x89, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd355[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8A, 0x95, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd356[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8B, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd357[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8C, 0xE1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd358[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8D, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd359[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8E, 0x20, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd360[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8F, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd361[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x90, 0x23, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd362[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x91, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd363[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x92, 0x59, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd364[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x93, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd365[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x94, 0x94, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd366[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x95, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd367[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x96, 0xB4, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd368[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x97, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd369[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x98, 0xE1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd370[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x99, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd371[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9A, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd372[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9B, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd373[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9C, 0x28, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd374[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd375[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9E, 0x30, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd376[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd377[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA0, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd378[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA2, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd379[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA3, 0x3B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd380[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA4, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd381[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA5, 0x40, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd382[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA6, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd383[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA7, 0x50, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd384[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd385[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAA, 0x6D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd386[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd387[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAC, 0x80, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd388[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd389[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAE, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd390[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd391[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB0, 0x19, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd392[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB1, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd393[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB2, 0x36, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd394[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB3, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd395[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB4, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd396[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB5, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd397[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB6, 0x70, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd398[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB7, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd399[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB8, 0x83, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd400[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB9, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd401[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBA, 0x99, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd402[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBB, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd403[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBC, 0xA8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd404[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBD, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd405[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBE, 0xB7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd406[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd407[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC0, 0xC5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd408[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC1, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd409[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC2, 0xF7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd410[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC3, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd411[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC4, 0x1E, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd412[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC5, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd413[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC6, 0x60, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd414[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC7, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd415[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC8, 0x95, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd416[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC9, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd417[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCA, 0xE1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd418[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCB, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd419[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCC, 0x20, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd420[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCD, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd421[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCE, 0x23, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd422[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd423[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD0, 0x59, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd424[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD1, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd425[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD2, 0x94, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd426[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD3, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd427[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD4, 0xB4, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd428[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD5, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd429[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD6, 0xE1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd430[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD7, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd431[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD8, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd432[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd433[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDA, 0x28, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd434[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd435[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDC, 0x30, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd436[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd437[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDE, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd438[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDF, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd439[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE0, 0x3B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd440[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE1, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd441[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE2, 0x40, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd442[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE3, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd443[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE4, 0x50, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd444[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE5, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd445[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE6, 0x6D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd446[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE7, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd447[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE8, 0x80, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd448[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd449[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEA, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd450[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd451[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd452[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd453[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd454[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x04, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd455[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd456[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd457[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd458[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0xEE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd459[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x12, 0x50, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd460[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x13, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd461[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6A, 0x60, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd462[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_cmd_on_cmd463[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x29, 0x00, 0xFF, 0xFF,  };
+
+
+
+
+static struct mipi_dsi_cmd nt35590_720p_cmd_on_command[] = {
+{ 0x8 , nt35590_720p_cmd_on_cmd0},
+{ 0x8 , nt35590_720p_cmd_on_cmd1},
+{ 0x8 , nt35590_720p_cmd_on_cmd2},
+{ 0x8 , nt35590_720p_cmd_on_cmd3},
+{ 0x8 , nt35590_720p_cmd_on_cmd4},
+{ 0x8 , nt35590_720p_cmd_on_cmd5},
+{ 0x8 , nt35590_720p_cmd_on_cmd6},
+{ 0x8 , nt35590_720p_cmd_on_cmd7},
+{ 0x8 , nt35590_720p_cmd_on_cmd8},
+{ 0x8 , nt35590_720p_cmd_on_cmd9},
+{ 0x8 , nt35590_720p_cmd_on_cmd10},
+{ 0x8 , nt35590_720p_cmd_on_cmd11},
+{ 0x8 , nt35590_720p_cmd_on_cmd12},
+{ 0x8 , nt35590_720p_cmd_on_cmd13},
+{ 0x8 , nt35590_720p_cmd_on_cmd14},
+{ 0x8 , nt35590_720p_cmd_on_cmd15},
+{ 0x8 , nt35590_720p_cmd_on_cmd16},
+{ 0x8 , nt35590_720p_cmd_on_cmd17},
+{ 0x8 , nt35590_720p_cmd_on_cmd18},
+{ 0x8 , nt35590_720p_cmd_on_cmd19},
+{ 0x8 , nt35590_720p_cmd_on_cmd20},
+{ 0x8 , nt35590_720p_cmd_on_cmd21},
+{ 0x8 , nt35590_720p_cmd_on_cmd22},
+{ 0x8 , nt35590_720p_cmd_on_cmd23},
+{ 0x8 , nt35590_720p_cmd_on_cmd24},
+{ 0x8 , nt35590_720p_cmd_on_cmd25},
+{ 0x8 , nt35590_720p_cmd_on_cmd26},
+{ 0x8 , nt35590_720p_cmd_on_cmd27},
+{ 0x8 , nt35590_720p_cmd_on_cmd28},
+{ 0x8 , nt35590_720p_cmd_on_cmd29},
+{ 0x8 , nt35590_720p_cmd_on_cmd30},
+{ 0x8 , nt35590_720p_cmd_on_cmd31},
+{ 0x8 , nt35590_720p_cmd_on_cmd32},
+{ 0x8 , nt35590_720p_cmd_on_cmd33},
+{ 0x8 , nt35590_720p_cmd_on_cmd34},
+{ 0x8 , nt35590_720p_cmd_on_cmd35},
+{ 0x8 , nt35590_720p_cmd_on_cmd36},
+{ 0x8 , nt35590_720p_cmd_on_cmd37},
+{ 0x8 , nt35590_720p_cmd_on_cmd38},
+{ 0x8 , nt35590_720p_cmd_on_cmd39},
+{ 0x8 , nt35590_720p_cmd_on_cmd40},
+{ 0x8 , nt35590_720p_cmd_on_cmd41},
+{ 0x8 , nt35590_720p_cmd_on_cmd42},
+{ 0x8 , nt35590_720p_cmd_on_cmd43},
+{ 0x8 , nt35590_720p_cmd_on_cmd44},
+{ 0x8 , nt35590_720p_cmd_on_cmd45},
+{ 0x8 , nt35590_720p_cmd_on_cmd46},
+{ 0x8 , nt35590_720p_cmd_on_cmd47},
+{ 0x8 , nt35590_720p_cmd_on_cmd48},
+{ 0x8 , nt35590_720p_cmd_on_cmd49},
+{ 0x8 , nt35590_720p_cmd_on_cmd50},
+{ 0x8 , nt35590_720p_cmd_on_cmd51},
+{ 0x8 , nt35590_720p_cmd_on_cmd52},
+{ 0x8 , nt35590_720p_cmd_on_cmd53},
+{ 0x8 , nt35590_720p_cmd_on_cmd54},
+{ 0x8 , nt35590_720p_cmd_on_cmd55},
+{ 0x8 , nt35590_720p_cmd_on_cmd56},
+{ 0x8 , nt35590_720p_cmd_on_cmd57},
+{ 0x8 , nt35590_720p_cmd_on_cmd58},
+{ 0x8 , nt35590_720p_cmd_on_cmd59},
+{ 0x8 , nt35590_720p_cmd_on_cmd60},
+{ 0x8 , nt35590_720p_cmd_on_cmd61},
+{ 0x8 , nt35590_720p_cmd_on_cmd62},
+{ 0x8 , nt35590_720p_cmd_on_cmd63},
+{ 0x8 , nt35590_720p_cmd_on_cmd64},
+{ 0x8 , nt35590_720p_cmd_on_cmd65},
+{ 0x8 , nt35590_720p_cmd_on_cmd66},
+{ 0x8 , nt35590_720p_cmd_on_cmd67},
+{ 0x8 , nt35590_720p_cmd_on_cmd68},
+{ 0x8 , nt35590_720p_cmd_on_cmd69},
+{ 0x8 , nt35590_720p_cmd_on_cmd70},
+{ 0x8 , nt35590_720p_cmd_on_cmd71},
+{ 0x8 , nt35590_720p_cmd_on_cmd72},
+{ 0x8 , nt35590_720p_cmd_on_cmd73},
+{ 0x8 , nt35590_720p_cmd_on_cmd74},
+{ 0x8 , nt35590_720p_cmd_on_cmd75},
+{ 0x8 , nt35590_720p_cmd_on_cmd76},
+{ 0x8 , nt35590_720p_cmd_on_cmd77},
+{ 0x8 , nt35590_720p_cmd_on_cmd78},
+{ 0x8 , nt35590_720p_cmd_on_cmd79},
+{ 0x8 , nt35590_720p_cmd_on_cmd80},
+{ 0x8 , nt35590_720p_cmd_on_cmd81},
+{ 0x8 , nt35590_720p_cmd_on_cmd82},
+{ 0x8 , nt35590_720p_cmd_on_cmd83},
+{ 0x8 , nt35590_720p_cmd_on_cmd84},
+{ 0x8 , nt35590_720p_cmd_on_cmd85},
+{ 0x8 , nt35590_720p_cmd_on_cmd86},
+{ 0x8 , nt35590_720p_cmd_on_cmd87},
+{ 0x8 , nt35590_720p_cmd_on_cmd88},
+{ 0x8 , nt35590_720p_cmd_on_cmd89},
+{ 0x8 , nt35590_720p_cmd_on_cmd90},
+{ 0x8 , nt35590_720p_cmd_on_cmd91},
+{ 0x8 , nt35590_720p_cmd_on_cmd92},
+{ 0x8 , nt35590_720p_cmd_on_cmd93},
+{ 0x8 , nt35590_720p_cmd_on_cmd94},
+{ 0x8 , nt35590_720p_cmd_on_cmd95},
+{ 0x8 , nt35590_720p_cmd_on_cmd96},
+{ 0x8 , nt35590_720p_cmd_on_cmd97},
+{ 0x8 , nt35590_720p_cmd_on_cmd98},
+{ 0x8 , nt35590_720p_cmd_on_cmd99},
+{ 0x8 , nt35590_720p_cmd_on_cmd100},
+{ 0x8 , nt35590_720p_cmd_on_cmd101},
+{ 0x8 , nt35590_720p_cmd_on_cmd102},
+{ 0x8 , nt35590_720p_cmd_on_cmd103},
+{ 0x8 , nt35590_720p_cmd_on_cmd104},
+{ 0x8 , nt35590_720p_cmd_on_cmd105},
+{ 0x8 , nt35590_720p_cmd_on_cmd106},
+{ 0x8 , nt35590_720p_cmd_on_cmd107},
+{ 0x8 , nt35590_720p_cmd_on_cmd108},
+{ 0x8 , nt35590_720p_cmd_on_cmd109},
+{ 0x8 , nt35590_720p_cmd_on_cmd110},
+{ 0x8 , nt35590_720p_cmd_on_cmd111},
+{ 0x8 , nt35590_720p_cmd_on_cmd112},
+{ 0x8 , nt35590_720p_cmd_on_cmd113},
+{ 0x8 , nt35590_720p_cmd_on_cmd114},
+{ 0x8 , nt35590_720p_cmd_on_cmd115},
+{ 0x8 , nt35590_720p_cmd_on_cmd116},
+{ 0x8 , nt35590_720p_cmd_on_cmd117},
+{ 0x8 , nt35590_720p_cmd_on_cmd118},
+{ 0x8 , nt35590_720p_cmd_on_cmd119},
+{ 0x8 , nt35590_720p_cmd_on_cmd120},
+{ 0x8 , nt35590_720p_cmd_on_cmd121},
+{ 0x8 , nt35590_720p_cmd_on_cmd122},
+{ 0x8 , nt35590_720p_cmd_on_cmd123},
+{ 0x8 , nt35590_720p_cmd_on_cmd124},
+{ 0x8 , nt35590_720p_cmd_on_cmd125},
+{ 0x8 , nt35590_720p_cmd_on_cmd126},
+{ 0x8 , nt35590_720p_cmd_on_cmd127},
+{ 0x8 , nt35590_720p_cmd_on_cmd128},
+{ 0x8 , nt35590_720p_cmd_on_cmd129},
+{ 0x8 , nt35590_720p_cmd_on_cmd130},
+{ 0x8 , nt35590_720p_cmd_on_cmd131},
+{ 0x8 , nt35590_720p_cmd_on_cmd132},
+{ 0x8 , nt35590_720p_cmd_on_cmd133},
+{ 0x8 , nt35590_720p_cmd_on_cmd134},
+{ 0x8 , nt35590_720p_cmd_on_cmd135},
+{ 0x8 , nt35590_720p_cmd_on_cmd136},
+{ 0x8 , nt35590_720p_cmd_on_cmd137},
+{ 0x8 , nt35590_720p_cmd_on_cmd138},
+{ 0x8 , nt35590_720p_cmd_on_cmd139},
+{ 0x8 , nt35590_720p_cmd_on_cmd140},
+{ 0x8 , nt35590_720p_cmd_on_cmd141},
+{ 0x8 , nt35590_720p_cmd_on_cmd142},
+{ 0x8 , nt35590_720p_cmd_on_cmd143},
+{ 0x8 , nt35590_720p_cmd_on_cmd144},
+{ 0x8 , nt35590_720p_cmd_on_cmd145},
+{ 0x8 , nt35590_720p_cmd_on_cmd146},
+{ 0x8 , nt35590_720p_cmd_on_cmd147},
+{ 0x8 , nt35590_720p_cmd_on_cmd148},
+{ 0x8 , nt35590_720p_cmd_on_cmd149},
+{ 0x8 , nt35590_720p_cmd_on_cmd150},
+{ 0x8 , nt35590_720p_cmd_on_cmd151},
+{ 0x8 , nt35590_720p_cmd_on_cmd152},
+{ 0x8 , nt35590_720p_cmd_on_cmd153},
+{ 0x8 , nt35590_720p_cmd_on_cmd154},
+{ 0x8 , nt35590_720p_cmd_on_cmd155},
+{ 0x8 , nt35590_720p_cmd_on_cmd156},
+{ 0x8 , nt35590_720p_cmd_on_cmd157},
+{ 0x8 , nt35590_720p_cmd_on_cmd158},
+{ 0x8 , nt35590_720p_cmd_on_cmd159},
+{ 0x8 , nt35590_720p_cmd_on_cmd160},
+{ 0x8 , nt35590_720p_cmd_on_cmd161},
+{ 0x8 , nt35590_720p_cmd_on_cmd162},
+{ 0x8 , nt35590_720p_cmd_on_cmd163},
+{ 0x8 , nt35590_720p_cmd_on_cmd164},
+{ 0x8 , nt35590_720p_cmd_on_cmd165},
+{ 0x8 , nt35590_720p_cmd_on_cmd166},
+{ 0x8 , nt35590_720p_cmd_on_cmd167},
+{ 0x8 , nt35590_720p_cmd_on_cmd168},
+{ 0x8 , nt35590_720p_cmd_on_cmd169},
+{ 0x8 , nt35590_720p_cmd_on_cmd170},
+{ 0x8 , nt35590_720p_cmd_on_cmd171},
+{ 0x8 , nt35590_720p_cmd_on_cmd172},
+{ 0x8 , nt35590_720p_cmd_on_cmd173},
+{ 0x8 , nt35590_720p_cmd_on_cmd174},
+{ 0x8 , nt35590_720p_cmd_on_cmd175},
+{ 0x8 , nt35590_720p_cmd_on_cmd176},
+{ 0x8 , nt35590_720p_cmd_on_cmd177},
+{ 0x8 , nt35590_720p_cmd_on_cmd178},
+{ 0x8 , nt35590_720p_cmd_on_cmd179},
+{ 0x8 , nt35590_720p_cmd_on_cmd180},
+{ 0x8 , nt35590_720p_cmd_on_cmd181},
+{ 0x8 , nt35590_720p_cmd_on_cmd182},
+{ 0x8 , nt35590_720p_cmd_on_cmd183},
+{ 0x8 , nt35590_720p_cmd_on_cmd184},
+{ 0x8 , nt35590_720p_cmd_on_cmd185},
+{ 0x8 , nt35590_720p_cmd_on_cmd186},
+{ 0x8 , nt35590_720p_cmd_on_cmd187},
+{ 0x8 , nt35590_720p_cmd_on_cmd188},
+{ 0x8 , nt35590_720p_cmd_on_cmd189},
+{ 0x8 , nt35590_720p_cmd_on_cmd190},
+{ 0x8 , nt35590_720p_cmd_on_cmd191},
+{ 0x8 , nt35590_720p_cmd_on_cmd192},
+{ 0x8 , nt35590_720p_cmd_on_cmd193},
+{ 0x8 , nt35590_720p_cmd_on_cmd194},
+{ 0x8 , nt35590_720p_cmd_on_cmd195},
+{ 0x8 , nt35590_720p_cmd_on_cmd196},
+{ 0x8 , nt35590_720p_cmd_on_cmd197},
+{ 0x8 , nt35590_720p_cmd_on_cmd198},
+{ 0x8 , nt35590_720p_cmd_on_cmd199},
+{ 0x8 , nt35590_720p_cmd_on_cmd200},
+{ 0x8 , nt35590_720p_cmd_on_cmd201},
+{ 0x8 , nt35590_720p_cmd_on_cmd202},
+{ 0x8 , nt35590_720p_cmd_on_cmd203},
+{ 0x8 , nt35590_720p_cmd_on_cmd204},
+{ 0x8 , nt35590_720p_cmd_on_cmd205},
+{ 0x8 , nt35590_720p_cmd_on_cmd206},
+{ 0x8 , nt35590_720p_cmd_on_cmd207},
+{ 0x8 , nt35590_720p_cmd_on_cmd208},
+{ 0x8 , nt35590_720p_cmd_on_cmd209},
+{ 0x8 , nt35590_720p_cmd_on_cmd210},
+{ 0x8 , nt35590_720p_cmd_on_cmd211},
+{ 0x8 , nt35590_720p_cmd_on_cmd212},
+{ 0x8 , nt35590_720p_cmd_on_cmd213},
+{ 0x8 , nt35590_720p_cmd_on_cmd214},
+{ 0x8 , nt35590_720p_cmd_on_cmd215},
+{ 0x8 , nt35590_720p_cmd_on_cmd216},
+{ 0x8 , nt35590_720p_cmd_on_cmd217},
+{ 0x8 , nt35590_720p_cmd_on_cmd218},
+{ 0x8 , nt35590_720p_cmd_on_cmd219},
+{ 0x8 , nt35590_720p_cmd_on_cmd220},
+{ 0x8 , nt35590_720p_cmd_on_cmd221},
+{ 0x8 , nt35590_720p_cmd_on_cmd222},
+{ 0x8 , nt35590_720p_cmd_on_cmd223},
+{ 0x8 , nt35590_720p_cmd_on_cmd224},
+{ 0x8 , nt35590_720p_cmd_on_cmd225},
+{ 0x8 , nt35590_720p_cmd_on_cmd226},
+{ 0x8 , nt35590_720p_cmd_on_cmd227},
+{ 0x8 , nt35590_720p_cmd_on_cmd228},
+{ 0x8 , nt35590_720p_cmd_on_cmd229},
+{ 0x8 , nt35590_720p_cmd_on_cmd230},
+{ 0x8 , nt35590_720p_cmd_on_cmd231},
+{ 0x8 , nt35590_720p_cmd_on_cmd232},
+{ 0x8 , nt35590_720p_cmd_on_cmd233},
+{ 0x8 , nt35590_720p_cmd_on_cmd234},
+{ 0x8 , nt35590_720p_cmd_on_cmd235},
+{ 0x8 , nt35590_720p_cmd_on_cmd236},
+{ 0x8 , nt35590_720p_cmd_on_cmd237},
+{ 0x8 , nt35590_720p_cmd_on_cmd238},
+{ 0x8 , nt35590_720p_cmd_on_cmd239},
+{ 0x8 , nt35590_720p_cmd_on_cmd240},
+{ 0x8 , nt35590_720p_cmd_on_cmd241},
+{ 0x8 , nt35590_720p_cmd_on_cmd242},
+{ 0x8 , nt35590_720p_cmd_on_cmd243},
+{ 0x8 , nt35590_720p_cmd_on_cmd244},
+{ 0x8 , nt35590_720p_cmd_on_cmd245},
+{ 0x8 , nt35590_720p_cmd_on_cmd246},
+{ 0x8 , nt35590_720p_cmd_on_cmd247},
+{ 0x8 , nt35590_720p_cmd_on_cmd248},
+{ 0x8 , nt35590_720p_cmd_on_cmd249},
+{ 0x8 , nt35590_720p_cmd_on_cmd250},
+{ 0x8 , nt35590_720p_cmd_on_cmd251},
+{ 0x8 , nt35590_720p_cmd_on_cmd252},
+{ 0x8 , nt35590_720p_cmd_on_cmd253},
+{ 0x8 , nt35590_720p_cmd_on_cmd254},
+{ 0x8 , nt35590_720p_cmd_on_cmd255},
+{ 0x8 , nt35590_720p_cmd_on_cmd256},
+{ 0x8 , nt35590_720p_cmd_on_cmd257},
+{ 0x8 , nt35590_720p_cmd_on_cmd258},
+{ 0x8 , nt35590_720p_cmd_on_cmd259},
+{ 0x8 , nt35590_720p_cmd_on_cmd260},
+{ 0x8 , nt35590_720p_cmd_on_cmd261},
+{ 0x8 , nt35590_720p_cmd_on_cmd262},
+{ 0x8 , nt35590_720p_cmd_on_cmd263},
+{ 0x8 , nt35590_720p_cmd_on_cmd264},
+{ 0x8 , nt35590_720p_cmd_on_cmd265},
+{ 0x8 , nt35590_720p_cmd_on_cmd266},
+{ 0x8 , nt35590_720p_cmd_on_cmd267},
+{ 0x8 , nt35590_720p_cmd_on_cmd268},
+{ 0x8 , nt35590_720p_cmd_on_cmd269},
+{ 0x8 , nt35590_720p_cmd_on_cmd270},
+{ 0x8 , nt35590_720p_cmd_on_cmd271},
+{ 0x8 , nt35590_720p_cmd_on_cmd272},
+{ 0x8 , nt35590_720p_cmd_on_cmd273},
+{ 0x8 , nt35590_720p_cmd_on_cmd274},
+{ 0x8 , nt35590_720p_cmd_on_cmd275},
+{ 0x8 , nt35590_720p_cmd_on_cmd276},
+{ 0x8 , nt35590_720p_cmd_on_cmd277},
+{ 0x8 , nt35590_720p_cmd_on_cmd278},
+{ 0x8 , nt35590_720p_cmd_on_cmd279},
+{ 0x8 , nt35590_720p_cmd_on_cmd280},
+{ 0x8 , nt35590_720p_cmd_on_cmd281},
+{ 0x8 , nt35590_720p_cmd_on_cmd282},
+{ 0x8 , nt35590_720p_cmd_on_cmd283},
+{ 0x8 , nt35590_720p_cmd_on_cmd284},
+{ 0x8 , nt35590_720p_cmd_on_cmd285},
+{ 0x8 , nt35590_720p_cmd_on_cmd286},
+{ 0x8 , nt35590_720p_cmd_on_cmd287},
+{ 0x8 , nt35590_720p_cmd_on_cmd288},
+{ 0x8 , nt35590_720p_cmd_on_cmd289},
+{ 0x8 , nt35590_720p_cmd_on_cmd290},
+{ 0x8 , nt35590_720p_cmd_on_cmd291},
+{ 0x8 , nt35590_720p_cmd_on_cmd292},
+{ 0x8 , nt35590_720p_cmd_on_cmd293},
+{ 0x8 , nt35590_720p_cmd_on_cmd294},
+{ 0x8 , nt35590_720p_cmd_on_cmd295},
+{ 0x8 , nt35590_720p_cmd_on_cmd296},
+{ 0x8 , nt35590_720p_cmd_on_cmd297},
+{ 0x8 , nt35590_720p_cmd_on_cmd298},
+{ 0x8 , nt35590_720p_cmd_on_cmd299},
+{ 0x8 , nt35590_720p_cmd_on_cmd300},
+{ 0x8 , nt35590_720p_cmd_on_cmd301},
+{ 0x8 , nt35590_720p_cmd_on_cmd302},
+{ 0x8 , nt35590_720p_cmd_on_cmd303},
+{ 0x8 , nt35590_720p_cmd_on_cmd304},
+{ 0x8 , nt35590_720p_cmd_on_cmd305},
+{ 0x8 , nt35590_720p_cmd_on_cmd306},
+{ 0x8 , nt35590_720p_cmd_on_cmd307},
+{ 0x8 , nt35590_720p_cmd_on_cmd308},
+{ 0x8 , nt35590_720p_cmd_on_cmd309},
+{ 0x8 , nt35590_720p_cmd_on_cmd310},
+{ 0x8 , nt35590_720p_cmd_on_cmd311},
+{ 0x8 , nt35590_720p_cmd_on_cmd312},
+{ 0x8 , nt35590_720p_cmd_on_cmd313},
+{ 0x8 , nt35590_720p_cmd_on_cmd314},
+{ 0x8 , nt35590_720p_cmd_on_cmd315},
+{ 0x8 , nt35590_720p_cmd_on_cmd316},
+{ 0x8 , nt35590_720p_cmd_on_cmd317},
+{ 0x8 , nt35590_720p_cmd_on_cmd318},
+{ 0x8 , nt35590_720p_cmd_on_cmd319},
+{ 0x8 , nt35590_720p_cmd_on_cmd320},
+{ 0x8 , nt35590_720p_cmd_on_cmd321},
+{ 0x8 , nt35590_720p_cmd_on_cmd322},
+{ 0x8 , nt35590_720p_cmd_on_cmd323},
+{ 0x8 , nt35590_720p_cmd_on_cmd324},
+{ 0x8 , nt35590_720p_cmd_on_cmd325},
+{ 0x8 , nt35590_720p_cmd_on_cmd326},
+{ 0x8 , nt35590_720p_cmd_on_cmd327},
+{ 0x8 , nt35590_720p_cmd_on_cmd328},
+{ 0x8 , nt35590_720p_cmd_on_cmd329},
+{ 0x8 , nt35590_720p_cmd_on_cmd330},
+{ 0x8 , nt35590_720p_cmd_on_cmd331},
+{ 0x8 , nt35590_720p_cmd_on_cmd332},
+{ 0x8 , nt35590_720p_cmd_on_cmd333},
+{ 0x8 , nt35590_720p_cmd_on_cmd334},
+{ 0x8 , nt35590_720p_cmd_on_cmd335},
+{ 0x8 , nt35590_720p_cmd_on_cmd336},
+{ 0x8 , nt35590_720p_cmd_on_cmd337},
+{ 0x8 , nt35590_720p_cmd_on_cmd338},
+{ 0x8 , nt35590_720p_cmd_on_cmd339},
+{ 0x8 , nt35590_720p_cmd_on_cmd340},
+{ 0x8 , nt35590_720p_cmd_on_cmd341},
+{ 0x8 , nt35590_720p_cmd_on_cmd342},
+{ 0x8 , nt35590_720p_cmd_on_cmd343},
+{ 0x8 , nt35590_720p_cmd_on_cmd344},
+{ 0x8 , nt35590_720p_cmd_on_cmd345},
+{ 0x8 , nt35590_720p_cmd_on_cmd346},
+{ 0x8 , nt35590_720p_cmd_on_cmd347},
+{ 0x8 , nt35590_720p_cmd_on_cmd348},
+{ 0x8 , nt35590_720p_cmd_on_cmd349},
+{ 0x8 , nt35590_720p_cmd_on_cmd350},
+{ 0x8 , nt35590_720p_cmd_on_cmd351},
+{ 0x8 , nt35590_720p_cmd_on_cmd352},
+{ 0x8 , nt35590_720p_cmd_on_cmd353},
+{ 0x8 , nt35590_720p_cmd_on_cmd354},
+{ 0x8 , nt35590_720p_cmd_on_cmd355},
+{ 0x8 , nt35590_720p_cmd_on_cmd356},
+{ 0x8 , nt35590_720p_cmd_on_cmd357},
+{ 0x8 , nt35590_720p_cmd_on_cmd358},
+{ 0x8 , nt35590_720p_cmd_on_cmd359},
+{ 0x8 , nt35590_720p_cmd_on_cmd360},
+{ 0x8 , nt35590_720p_cmd_on_cmd361},
+{ 0x8 , nt35590_720p_cmd_on_cmd362},
+{ 0x8 , nt35590_720p_cmd_on_cmd363},
+{ 0x8 , nt35590_720p_cmd_on_cmd364},
+{ 0x8 , nt35590_720p_cmd_on_cmd365},
+{ 0x8 , nt35590_720p_cmd_on_cmd366},
+{ 0x8 , nt35590_720p_cmd_on_cmd367},
+{ 0x8 , nt35590_720p_cmd_on_cmd368},
+{ 0x8 , nt35590_720p_cmd_on_cmd369},
+{ 0x8 , nt35590_720p_cmd_on_cmd370},
+{ 0x8 , nt35590_720p_cmd_on_cmd371},
+{ 0x8 , nt35590_720p_cmd_on_cmd372},
+{ 0x8 , nt35590_720p_cmd_on_cmd373},
+{ 0x8 , nt35590_720p_cmd_on_cmd374},
+{ 0x8 , nt35590_720p_cmd_on_cmd375},
+{ 0x8 , nt35590_720p_cmd_on_cmd376},
+{ 0x8 , nt35590_720p_cmd_on_cmd377},
+{ 0x8 , nt35590_720p_cmd_on_cmd378},
+{ 0x8 , nt35590_720p_cmd_on_cmd379},
+{ 0x8 , nt35590_720p_cmd_on_cmd380},
+{ 0x8 , nt35590_720p_cmd_on_cmd381},
+{ 0x8 , nt35590_720p_cmd_on_cmd382},
+{ 0x8 , nt35590_720p_cmd_on_cmd383},
+{ 0x8 , nt35590_720p_cmd_on_cmd384},
+{ 0x8 , nt35590_720p_cmd_on_cmd385},
+{ 0x8 , nt35590_720p_cmd_on_cmd386},
+{ 0x8 , nt35590_720p_cmd_on_cmd387},
+{ 0x8 , nt35590_720p_cmd_on_cmd388},
+{ 0x8 , nt35590_720p_cmd_on_cmd389},
+{ 0x8 , nt35590_720p_cmd_on_cmd390},
+{ 0x8 , nt35590_720p_cmd_on_cmd391},
+{ 0x8 , nt35590_720p_cmd_on_cmd392},
+{ 0x8 , nt35590_720p_cmd_on_cmd393},
+{ 0x8 , nt35590_720p_cmd_on_cmd394},
+{ 0x8 , nt35590_720p_cmd_on_cmd395},
+{ 0x8 , nt35590_720p_cmd_on_cmd396},
+{ 0x8 , nt35590_720p_cmd_on_cmd397},
+{ 0x8 , nt35590_720p_cmd_on_cmd398},
+{ 0x8 , nt35590_720p_cmd_on_cmd399},
+{ 0x8 , nt35590_720p_cmd_on_cmd400},
+{ 0x8 , nt35590_720p_cmd_on_cmd401},
+{ 0x8 , nt35590_720p_cmd_on_cmd402},
+{ 0x8 , nt35590_720p_cmd_on_cmd403},
+{ 0x8 , nt35590_720p_cmd_on_cmd404},
+{ 0x8 , nt35590_720p_cmd_on_cmd405},
+{ 0x8 , nt35590_720p_cmd_on_cmd406},
+{ 0x8 , nt35590_720p_cmd_on_cmd407},
+{ 0x8 , nt35590_720p_cmd_on_cmd408},
+{ 0x8 , nt35590_720p_cmd_on_cmd409},
+{ 0x8 , nt35590_720p_cmd_on_cmd410},
+{ 0x8 , nt35590_720p_cmd_on_cmd411},
+{ 0x8 , nt35590_720p_cmd_on_cmd412},
+{ 0x8 , nt35590_720p_cmd_on_cmd413},
+{ 0x8 , nt35590_720p_cmd_on_cmd414},
+{ 0x8 , nt35590_720p_cmd_on_cmd415},
+{ 0x8 , nt35590_720p_cmd_on_cmd416},
+{ 0x8 , nt35590_720p_cmd_on_cmd417},
+{ 0x8 , nt35590_720p_cmd_on_cmd418},
+{ 0x8 , nt35590_720p_cmd_on_cmd419},
+{ 0x8 , nt35590_720p_cmd_on_cmd420},
+{ 0x8 , nt35590_720p_cmd_on_cmd421},
+{ 0x8 , nt35590_720p_cmd_on_cmd422},
+{ 0x8 , nt35590_720p_cmd_on_cmd423},
+{ 0x8 , nt35590_720p_cmd_on_cmd424},
+{ 0x8 , nt35590_720p_cmd_on_cmd425},
+{ 0x8 , nt35590_720p_cmd_on_cmd426},
+{ 0x8 , nt35590_720p_cmd_on_cmd427},
+{ 0x8 , nt35590_720p_cmd_on_cmd428},
+{ 0x8 , nt35590_720p_cmd_on_cmd429},
+{ 0x8 , nt35590_720p_cmd_on_cmd430},
+{ 0x8 , nt35590_720p_cmd_on_cmd431},
+{ 0x8 , nt35590_720p_cmd_on_cmd432},
+{ 0x8 , nt35590_720p_cmd_on_cmd433},
+{ 0x8 , nt35590_720p_cmd_on_cmd434},
+{ 0x8 , nt35590_720p_cmd_on_cmd435},
+{ 0x8 , nt35590_720p_cmd_on_cmd436},
+{ 0x8 , nt35590_720p_cmd_on_cmd437},
+{ 0x8 , nt35590_720p_cmd_on_cmd438},
+{ 0x8 , nt35590_720p_cmd_on_cmd439},
+{ 0x8 , nt35590_720p_cmd_on_cmd440},
+{ 0x8 , nt35590_720p_cmd_on_cmd441},
+{ 0x8 , nt35590_720p_cmd_on_cmd442},
+{ 0x8 , nt35590_720p_cmd_on_cmd443},
+{ 0x8 , nt35590_720p_cmd_on_cmd444},
+{ 0x8 , nt35590_720p_cmd_on_cmd445},
+{ 0x8 , nt35590_720p_cmd_on_cmd446},
+{ 0x8 , nt35590_720p_cmd_on_cmd447},
+{ 0x8 , nt35590_720p_cmd_on_cmd448},
+{ 0x8 , nt35590_720p_cmd_on_cmd449},
+{ 0x8 , nt35590_720p_cmd_on_cmd450},
+{ 0x8 , nt35590_720p_cmd_on_cmd451},
+{ 0x8 , nt35590_720p_cmd_on_cmd452},
+{ 0x8 , nt35590_720p_cmd_on_cmd453},
+{ 0x8 , nt35590_720p_cmd_on_cmd454},
+{ 0x8 , nt35590_720p_cmd_on_cmd455},
+{ 0x8 , nt35590_720p_cmd_on_cmd456},
+{ 0x8 , nt35590_720p_cmd_on_cmd457},
+{ 0x8 , nt35590_720p_cmd_on_cmd458},
+{ 0x8 , nt35590_720p_cmd_on_cmd459},
+{ 0x8 , nt35590_720p_cmd_on_cmd460},
+{ 0x8 , nt35590_720p_cmd_on_cmd461},
+{ 0x8 , nt35590_720p_cmd_on_cmd462},
+{ 0x8 , nt35590_720p_cmd_on_cmd463}
+};
+#define NT35590_720P_CMD_ON_COMMAND 464
+
+
+static char nt35590_720p_cmdoff_cmd0[] = {
+0x28, 0x00, 0x05, 0x80 };
+
+
+static char nt35590_720p_cmdoff_cmd1[] = {
+0x10, 0x00, 0x05, 0x80 };
+
+
+
+
+static struct mipi_dsi_cmd nt35590_720p_cmd_off_command[] = {
+{ 0x4 , nt35590_720p_cmdoff_cmd0},
+{ 0x4 , nt35590_720p_cmdoff_cmd1}
+};
+#define NT35590_720P_CMD_OFF_COMMAND 2
+
+
+static struct command_state nt35590_720p_cmd_state = {
+  0, 1
+};
+
+/*---------------------------------------------------------------------------*/
+/* Command mode panel information                                            */
+/*---------------------------------------------------------------------------*/
+
+static struct commandpanel_info nt35590_720p_cmd_command_panel = {
+  1, 1, 1, 0, 0, 0x2c, 0, 0, 0, 1, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Video mode panel information                                              */
+/*---------------------------------------------------------------------------*/
+
+static struct videopanel_info nt35590_720p_cmd_video_panel = {
+  1, 0, 0, 0, 1, 1, 2, 0, 0x9
+};
+
+/*---------------------------------------------------------------------------*/
+/* Lane Configuration                                                        */
+/*---------------------------------------------------------------------------*/
+
+static struct lane_configuration nt35590_720p_cmd_lane_config = {
+  4, 0, 1, 1, 1, 1
+};
+
+
+/*---------------------------------------------------------------------------*/
+/* Panel Timing                                                              */
+/*---------------------------------------------------------------------------*/
+const uint32_t nt35590_720p_cmd_timings[] = {
+  0x7d, 0x25, 0x1d, 0x00, 0x37, 0x33, 0x22, 0x27, 0x1e, 0x03, 0x04, 0x00
+};
+
+
+
+static struct mipi_dsi_cmd nt35590_720p_cmd_rotation[] = {
+
+};
+#define NT35590_720P_CMD_ROTATION 0
+
+
+static struct panel_timing nt35590_720p_cmd_timing_info = {
+  0, 4, 0x20, 0x2c
+};
+
+/*---------------------------------------------------------------------------*/
+/* Backlight Settings                                                        */
+/*---------------------------------------------------------------------------*/
+
+static struct backlight nt35590_720p_cmd_backlight = {
+  1, 1, 4095, 100, 1, "PMIC_8941"
+};
+
+
+#endif /*_PANEL_NT35590_720P_CMD_H_*/
diff --git a/dev/gcdb/display/include/panel_nt35590_720p_video.h b/dev/gcdb/display/include/panel_nt35590_720p_video.h
new file mode 100755
index 0000000..c144f14
--- /dev/null
+++ b/dev/gcdb/display/include/panel_nt35590_720p_video.h
@@ -0,0 +1,2935 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+/*---------------------------------------------------------------------------
+ * This file is autogenerated file using gcdb parser. Please do not edit it.
+ * Update input XML file to add a new entry or update variable in this file
+ * VERSION = "1.0"
+ *---------------------------------------------------------------------------*/
+
+#ifndef _PANEL_NT35590_720P_VIDEO_H_
+
+#define _PANEL_NT35590_720P_VIDEO_H_
+/*---------------------------------------------------------------------------*/
+/* HEADER files                                                              */
+/*---------------------------------------------------------------------------*/
+#include "panel.h"
+
+/*---------------------------------------------------------------------------*/
+/* Panel configuration                                                       */
+/*---------------------------------------------------------------------------*/
+
+static struct panel_config nt35590_720p_video_panel_data = {
+  "nt25590 720p video mode dsi panel", "mdss_dsi0", "qcom,mdss-dsi-panel",
+  10, 0, "DISPLAY_1", 0, 424000000, 60, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel resolution                                                          */
+/*---------------------------------------------------------------------------*/
+static struct panel_resolution nt35590_720p_video_panel_res = {
+  720, 1280, 140, 164, 8, 0, 6, 1, 1, 0, 0, 0, 0, 0, 0, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel Color Information                                                   */
+/*---------------------------------------------------------------------------*/
+static struct color_info nt35590_720p_video_color = {
+  24, 0, 0xff, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel Command information                                                 */
+/*---------------------------------------------------------------------------*/
+static char nt35590_720p_video_on_cmd0[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0xEE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd1[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x26, 0x08, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd2[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x26, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd3[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd4[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBA, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd5[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC2, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd6[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd7[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd8[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x00, 0x4A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd9[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x01, 0x33, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd10[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x02, 0x53, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd11[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x03, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd12[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x04, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd13[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x05, 0x33, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd14[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x06, 0x22, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd15[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x08, 0x56, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd16[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x09, 0x8F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd17[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x36, 0x73, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd18[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0B, 0x9F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd19[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0C, 0x9F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd20[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0D, 0x2F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd21[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0E, 0x24, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd22[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x83, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd23[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x12, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd24[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x71, 0x2C, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd25[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd26[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0F, 0x0A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd27[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x05, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd28[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd29[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x01, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd30[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x02, 0x8B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd31[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x03, 0x82, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd32[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x04, 0x82, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd33[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x05, 0x30, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd34[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x06, 0x33, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd35[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x07, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd36[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x08, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd37[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x09, 0x46, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd38[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0A, 0x46, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd39[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0D, 0x0B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd40[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0E, 0x1D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd41[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0F, 0x08, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd42[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x10, 0x53, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd43[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd44[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x12, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd45[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x14, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd46[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x15, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd47[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x16, 0x05, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd48[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x17, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd49[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x19, 0x7F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd50[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1A, 0xFF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd51[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1B, 0x0F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd52[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1C, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd53[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd54[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1E, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd55[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1F, 0x07, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd56[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x20, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd57[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x21, 0x06, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd58[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x22, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd59[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x23, 0x4D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd60[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2D, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd61[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x28, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd62[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2F, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd63[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x83, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd64[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9E, 0x58, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd65[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9F, 0x6A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd66[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA0, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd67[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA2, 0x10, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd68[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBB, 0x0A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd69[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBC, 0x0A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd70[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x32, 0x08, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd71[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x33, 0xB8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd72[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x36, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd73[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x37, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd74[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x43, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd75[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4B, 0x21, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd76[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4C, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd77[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x50, 0x21, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd78[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x51, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd79[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x58, 0x21, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd80[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x59, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd81[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5D, 0x21, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd82[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5E, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd83[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6C, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd84[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd85[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd86[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd87[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd88[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x75, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd89[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x76, 0x7D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd90[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x77, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd91[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x78, 0x8A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd92[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x79, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd93[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7A, 0x9C, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd94[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7B, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd95[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7C, 0xB1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd96[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd97[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7E, 0xBF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd98[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7F, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd99[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x80, 0xCF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd100[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x81, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd101[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x82, 0xDD, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd102[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x83, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd103[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x84, 0xE8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd104[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x85, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd105[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x86, 0xF2, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd106[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x87, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd107[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x88, 0x1F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd108[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x89, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd109[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8A, 0x41, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd110[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8B, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd111[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8C, 0x78, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd112[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8D, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd113[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8E, 0xA5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd114[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8F, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd115[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x90, 0xEE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd116[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x91, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd117[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x92, 0x29, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd118[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x93, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd119[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x94, 0x2A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd120[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x95, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd121[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x96, 0x5D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd122[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x97, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd123[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x98, 0x93, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd124[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x99, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd125[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9A, 0xB8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd126[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9B, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd127[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9C, 0xE7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd128[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd129[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9E, 0x07, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd130[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd131[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA0, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd132[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA2, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd133[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA3, 0x46, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd134[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA4, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd135[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA5, 0x56, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd136[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA6, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd137[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA7, 0x66, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd138[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd139[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAA, 0x7A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd140[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd141[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAC, 0x93, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd142[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd143[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAE, 0xA3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd144[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAF, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd145[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB0, 0xB4, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd146[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB1, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd147[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB2, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd148[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB3, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd149[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB4, 0x7D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd150[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB5, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd151[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB6, 0x8A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd152[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB7, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd153[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB8, 0x9C, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd154[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB9, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd155[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBA, 0xB1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd156[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBB, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd157[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBC, 0xBF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd158[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBD, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd159[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBE, 0xCF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd160[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd161[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC0, 0xDD, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd162[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC1, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd163[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC2, 0xE8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd164[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC3, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd165[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC4, 0xF2, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd166[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC5, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd167[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC6, 0x1F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd168[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC7, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd169[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC8, 0x41, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd170[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC9, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd171[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCA, 0x78, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd172[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd173[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCC, 0xA5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd174[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCD, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd175[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCE, 0xEE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd176[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd177[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD0, 0x29, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd178[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD1, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd179[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD2, 0x2A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd180[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD3, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd181[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD4, 0x5D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd182[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD5, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd183[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD6, 0x93, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd184[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD7, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd185[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD8, 0xB8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd186[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD9, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd187[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDA, 0xE7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd188[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd189[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDC, 0x07, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd190[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd191[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDE, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd192[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDF, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd193[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE0, 0x46, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd194[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE1, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd195[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE2, 0x56, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd196[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE3, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd197[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE4, 0x66, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd198[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE5, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd199[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE6, 0x7A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd200[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE7, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd201[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE8, 0x93, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd202[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd203[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEA, 0xA3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd204[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd205[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEC, 0xB4, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd206[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xED, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd207[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEE, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd208[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd209[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF0, 0xED, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd210[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF1, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd211[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF2, 0xF3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd212[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF3, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd213[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF4, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd214[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF5, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd215[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF6, 0x09, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd216[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF7, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd217[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF8, 0x13, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd218[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF9, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd219[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFA, 0x1D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd220[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd221[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd222[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x00, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd223[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x01, 0x26, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd224[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x02, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd225[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x03, 0x2F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd226[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x04, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd227[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x05, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd228[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x06, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd229[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x07, 0x56, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd230[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x08, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd231[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x09, 0x70, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd232[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0A, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd233[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0B, 0x9D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd234[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0C, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd235[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0D, 0xC2, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd236[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0E, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd237[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0F, 0xFF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd238[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x10, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd239[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x31, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd240[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x12, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd241[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x13, 0x32, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd242[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x14, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd243[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x15, 0x60, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd244[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x16, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd245[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x17, 0x94, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd246[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x18, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd247[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x19, 0xB5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd248[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1A, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd249[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1B, 0xE3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd250[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1C, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd251[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd252[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1E, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd253[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1F, 0x2D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd254[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x20, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd255[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x21, 0x3A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd256[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x22, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd257[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x23, 0x48, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd258[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x24, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd259[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x25, 0x57, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd260[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x26, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd261[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x27, 0x68, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd262[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x28, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd263[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x29, 0x7B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd264[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2A, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd265[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2B, 0x90, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd266[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd267[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2F, 0xA0, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd268[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x30, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd269[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x31, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd270[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x32, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd271[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x33, 0xED, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd272[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x34, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd273[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x35, 0xF3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd274[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x36, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd275[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x37, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd276[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x38, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd277[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x39, 0x09, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd278[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3A, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd279[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3B, 0x13, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd280[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3D, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd281[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3F, 0x1D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd282[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x40, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd283[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x41, 0x26, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd284[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x42, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd285[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x43, 0x2F, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd286[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x44, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd287[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x45, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd288[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x46, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd289[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x47, 0x56, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd290[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x48, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd291[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x49, 0x70, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd292[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4A, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd293[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4B, 0x9D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd294[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4C, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd295[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4D, 0xC2, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd296[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4E, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd297[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4F, 0xFF, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd298[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x50, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd299[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x51, 0x31, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd300[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x52, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd301[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x53, 0x32, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd302[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x54, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd303[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x55, 0x60, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd304[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x56, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd305[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x58, 0x94, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd306[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x59, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd307[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5A, 0xB5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd308[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5B, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd309[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5C, 0xE3, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd310[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd311[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5E, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd312[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd313[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x60, 0x2D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd314[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x61, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd315[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x62, 0x3A, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd316[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x63, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd317[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x64, 0x48, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd318[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x65, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd319[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x66, 0x57, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd320[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x67, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd321[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x68, 0x68, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd322[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x69, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd323[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6A, 0x7B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd324[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6B, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd325[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6C, 0x90, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd326[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd327[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6E, 0xA0, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd328[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd329[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x70, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd330[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x71, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd331[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x72, 0x19, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd332[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x73, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd333[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x74, 0x36, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd334[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x75, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd335[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x76, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd336[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x77, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd337[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x78, 0x70, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd338[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x79, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd339[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7A, 0x83, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd340[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7B, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd341[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7C, 0x99, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd342[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd343[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7E, 0xA8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd344[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7F, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd345[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x80, 0xB7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd346[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x81, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd347[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x82, 0xC5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd348[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x83, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd349[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x84, 0xF7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd350[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x85, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd351[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x86, 0x1E, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd352[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x87, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd353[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x88, 0x60, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd354[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x89, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd355[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8A, 0x95, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd356[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8B, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd357[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8C, 0xE1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd358[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8D, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd359[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8E, 0x20, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd360[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8F, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd361[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x90, 0x23, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd362[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x91, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd363[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x92, 0x59, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd364[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x93, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd365[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x94, 0x94, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd366[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x95, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd367[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x96, 0xB4, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd368[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x97, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd369[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x98, 0xE1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd370[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x99, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd371[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9A, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd372[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9B, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd373[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9C, 0x28, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd374[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd375[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9E, 0x30, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd376[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd377[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA0, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd378[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA2, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd379[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA3, 0x3B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd380[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA4, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd381[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA5, 0x40, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd382[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA6, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd383[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA7, 0x50, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd384[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd385[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAA, 0x6D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd386[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd387[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAC, 0x80, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd388[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd389[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAE, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd390[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd391[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB0, 0x19, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd392[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB1, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd393[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB2, 0x36, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd394[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB3, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd395[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB4, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd396[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB5, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd397[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB6, 0x70, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd398[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB7, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd399[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB8, 0x83, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd400[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB9, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd401[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBA, 0x99, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd402[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBB, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd403[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBC, 0xA8, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd404[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBD, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd405[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBE, 0xB7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd406[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd407[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC0, 0xC5, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd408[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC1, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd409[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC2, 0xF7, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd410[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC3, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd411[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC4, 0x1E, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd412[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC5, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd413[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC6, 0x60, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd414[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC7, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd415[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC8, 0x95, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd416[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC9, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd417[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCA, 0xE1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd418[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCB, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd419[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCC, 0x20, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd420[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCD, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd421[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCE, 0x23, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd422[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd423[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD0, 0x59, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd424[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD1, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd425[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD2, 0x94, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd426[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD3, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd427[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD4, 0xB4, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd428[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD5, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd429[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD6, 0xE1, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd430[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD7, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd431[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD8, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd432[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd433[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDA, 0x28, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd434[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd435[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDC, 0x30, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd436[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd437[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDE, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd438[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDF, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd439[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE0, 0x3B, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd440[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE1, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd441[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE2, 0x40, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd442[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE3, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd443[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE4, 0x50, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd444[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE5, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd445[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE6, 0x6D, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd446[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE7, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd447[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE8, 0x80, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd448[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd449[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEA, 0xCB, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd450[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd451[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd452[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd453[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd454[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x04, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd455[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd456[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd457[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd458[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0xEE, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd459[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x12, 0x50, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd460[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x13, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd461[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6A, 0x60, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd462[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35590_720p_video_on_cmd463[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x29, 0x00, 0xFF, 0xFF,  };
+
+
+
+
+static struct mipi_dsi_cmd nt35590_720p_video_on_command[] = {
+{ 0x8 , nt35590_720p_video_on_cmd0},
+{ 0x8 , nt35590_720p_video_on_cmd1},
+{ 0x8 , nt35590_720p_video_on_cmd2},
+{ 0x8 , nt35590_720p_video_on_cmd3},
+{ 0x8 , nt35590_720p_video_on_cmd4},
+{ 0x8 , nt35590_720p_video_on_cmd5},
+{ 0x8 , nt35590_720p_video_on_cmd6},
+{ 0x8 , nt35590_720p_video_on_cmd7},
+{ 0x8 , nt35590_720p_video_on_cmd8},
+{ 0x8 , nt35590_720p_video_on_cmd9},
+{ 0x8 , nt35590_720p_video_on_cmd10},
+{ 0x8 , nt35590_720p_video_on_cmd11},
+{ 0x8 , nt35590_720p_video_on_cmd12},
+{ 0x8 , nt35590_720p_video_on_cmd13},
+{ 0x8 , nt35590_720p_video_on_cmd14},
+{ 0x8 , nt35590_720p_video_on_cmd15},
+{ 0x8 , nt35590_720p_video_on_cmd16},
+{ 0x8 , nt35590_720p_video_on_cmd17},
+{ 0x8 , nt35590_720p_video_on_cmd18},
+{ 0x8 , nt35590_720p_video_on_cmd19},
+{ 0x8 , nt35590_720p_video_on_cmd20},
+{ 0x8 , nt35590_720p_video_on_cmd21},
+{ 0x8 , nt35590_720p_video_on_cmd22},
+{ 0x8 , nt35590_720p_video_on_cmd23},
+{ 0x8 , nt35590_720p_video_on_cmd24},
+{ 0x8 , nt35590_720p_video_on_cmd25},
+{ 0x8 , nt35590_720p_video_on_cmd26},
+{ 0x8 , nt35590_720p_video_on_cmd27},
+{ 0x8 , nt35590_720p_video_on_cmd28},
+{ 0x8 , nt35590_720p_video_on_cmd29},
+{ 0x8 , nt35590_720p_video_on_cmd30},
+{ 0x8 , nt35590_720p_video_on_cmd31},
+{ 0x8 , nt35590_720p_video_on_cmd32},
+{ 0x8 , nt35590_720p_video_on_cmd33},
+{ 0x8 , nt35590_720p_video_on_cmd34},
+{ 0x8 , nt35590_720p_video_on_cmd35},
+{ 0x8 , nt35590_720p_video_on_cmd36},
+{ 0x8 , nt35590_720p_video_on_cmd37},
+{ 0x8 , nt35590_720p_video_on_cmd38},
+{ 0x8 , nt35590_720p_video_on_cmd39},
+{ 0x8 , nt35590_720p_video_on_cmd40},
+{ 0x8 , nt35590_720p_video_on_cmd41},
+{ 0x8 , nt35590_720p_video_on_cmd42},
+{ 0x8 , nt35590_720p_video_on_cmd43},
+{ 0x8 , nt35590_720p_video_on_cmd44},
+{ 0x8 , nt35590_720p_video_on_cmd45},
+{ 0x8 , nt35590_720p_video_on_cmd46},
+{ 0x8 , nt35590_720p_video_on_cmd47},
+{ 0x8 , nt35590_720p_video_on_cmd48},
+{ 0x8 , nt35590_720p_video_on_cmd49},
+{ 0x8 , nt35590_720p_video_on_cmd50},
+{ 0x8 , nt35590_720p_video_on_cmd51},
+{ 0x8 , nt35590_720p_video_on_cmd52},
+{ 0x8 , nt35590_720p_video_on_cmd53},
+{ 0x8 , nt35590_720p_video_on_cmd54},
+{ 0x8 , nt35590_720p_video_on_cmd55},
+{ 0x8 , nt35590_720p_video_on_cmd56},
+{ 0x8 , nt35590_720p_video_on_cmd57},
+{ 0x8 , nt35590_720p_video_on_cmd58},
+{ 0x8 , nt35590_720p_video_on_cmd59},
+{ 0x8 , nt35590_720p_video_on_cmd60},
+{ 0x8 , nt35590_720p_video_on_cmd61},
+{ 0x8 , nt35590_720p_video_on_cmd62},
+{ 0x8 , nt35590_720p_video_on_cmd63},
+{ 0x8 , nt35590_720p_video_on_cmd64},
+{ 0x8 , nt35590_720p_video_on_cmd65},
+{ 0x8 , nt35590_720p_video_on_cmd66},
+{ 0x8 , nt35590_720p_video_on_cmd67},
+{ 0x8 , nt35590_720p_video_on_cmd68},
+{ 0x8 , nt35590_720p_video_on_cmd69},
+{ 0x8 , nt35590_720p_video_on_cmd70},
+{ 0x8 , nt35590_720p_video_on_cmd71},
+{ 0x8 , nt35590_720p_video_on_cmd72},
+{ 0x8 , nt35590_720p_video_on_cmd73},
+{ 0x8 , nt35590_720p_video_on_cmd74},
+{ 0x8 , nt35590_720p_video_on_cmd75},
+{ 0x8 , nt35590_720p_video_on_cmd76},
+{ 0x8 , nt35590_720p_video_on_cmd77},
+{ 0x8 , nt35590_720p_video_on_cmd78},
+{ 0x8 , nt35590_720p_video_on_cmd79},
+{ 0x8 , nt35590_720p_video_on_cmd80},
+{ 0x8 , nt35590_720p_video_on_cmd81},
+{ 0x8 , nt35590_720p_video_on_cmd82},
+{ 0x8 , nt35590_720p_video_on_cmd83},
+{ 0x8 , nt35590_720p_video_on_cmd84},
+{ 0x8 , nt35590_720p_video_on_cmd85},
+{ 0x8 , nt35590_720p_video_on_cmd86},
+{ 0x8 , nt35590_720p_video_on_cmd87},
+{ 0x8 , nt35590_720p_video_on_cmd88},
+{ 0x8 , nt35590_720p_video_on_cmd89},
+{ 0x8 , nt35590_720p_video_on_cmd90},
+{ 0x8 , nt35590_720p_video_on_cmd91},
+{ 0x8 , nt35590_720p_video_on_cmd92},
+{ 0x8 , nt35590_720p_video_on_cmd93},
+{ 0x8 , nt35590_720p_video_on_cmd94},
+{ 0x8 , nt35590_720p_video_on_cmd95},
+{ 0x8 , nt35590_720p_video_on_cmd96},
+{ 0x8 , nt35590_720p_video_on_cmd97},
+{ 0x8 , nt35590_720p_video_on_cmd98},
+{ 0x8 , nt35590_720p_video_on_cmd99},
+{ 0x8 , nt35590_720p_video_on_cmd100},
+{ 0x8 , nt35590_720p_video_on_cmd101},
+{ 0x8 , nt35590_720p_video_on_cmd102},
+{ 0x8 , nt35590_720p_video_on_cmd103},
+{ 0x8 , nt35590_720p_video_on_cmd104},
+{ 0x8 , nt35590_720p_video_on_cmd105},
+{ 0x8 , nt35590_720p_video_on_cmd106},
+{ 0x8 , nt35590_720p_video_on_cmd107},
+{ 0x8 , nt35590_720p_video_on_cmd108},
+{ 0x8 , nt35590_720p_video_on_cmd109},
+{ 0x8 , nt35590_720p_video_on_cmd110},
+{ 0x8 , nt35590_720p_video_on_cmd111},
+{ 0x8 , nt35590_720p_video_on_cmd112},
+{ 0x8 , nt35590_720p_video_on_cmd113},
+{ 0x8 , nt35590_720p_video_on_cmd114},
+{ 0x8 , nt35590_720p_video_on_cmd115},
+{ 0x8 , nt35590_720p_video_on_cmd116},
+{ 0x8 , nt35590_720p_video_on_cmd117},
+{ 0x8 , nt35590_720p_video_on_cmd118},
+{ 0x8 , nt35590_720p_video_on_cmd119},
+{ 0x8 , nt35590_720p_video_on_cmd120},
+{ 0x8 , nt35590_720p_video_on_cmd121},
+{ 0x8 , nt35590_720p_video_on_cmd122},
+{ 0x8 , nt35590_720p_video_on_cmd123},
+{ 0x8 , nt35590_720p_video_on_cmd124},
+{ 0x8 , nt35590_720p_video_on_cmd125},
+{ 0x8 , nt35590_720p_video_on_cmd126},
+{ 0x8 , nt35590_720p_video_on_cmd127},
+{ 0x8 , nt35590_720p_video_on_cmd128},
+{ 0x8 , nt35590_720p_video_on_cmd129},
+{ 0x8 , nt35590_720p_video_on_cmd130},
+{ 0x8 , nt35590_720p_video_on_cmd131},
+{ 0x8 , nt35590_720p_video_on_cmd132},
+{ 0x8 , nt35590_720p_video_on_cmd133},
+{ 0x8 , nt35590_720p_video_on_cmd134},
+{ 0x8 , nt35590_720p_video_on_cmd135},
+{ 0x8 , nt35590_720p_video_on_cmd136},
+{ 0x8 , nt35590_720p_video_on_cmd137},
+{ 0x8 , nt35590_720p_video_on_cmd138},
+{ 0x8 , nt35590_720p_video_on_cmd139},
+{ 0x8 , nt35590_720p_video_on_cmd140},
+{ 0x8 , nt35590_720p_video_on_cmd141},
+{ 0x8 , nt35590_720p_video_on_cmd142},
+{ 0x8 , nt35590_720p_video_on_cmd143},
+{ 0x8 , nt35590_720p_video_on_cmd144},
+{ 0x8 , nt35590_720p_video_on_cmd145},
+{ 0x8 , nt35590_720p_video_on_cmd146},
+{ 0x8 , nt35590_720p_video_on_cmd147},
+{ 0x8 , nt35590_720p_video_on_cmd148},
+{ 0x8 , nt35590_720p_video_on_cmd149},
+{ 0x8 , nt35590_720p_video_on_cmd150},
+{ 0x8 , nt35590_720p_video_on_cmd151},
+{ 0x8 , nt35590_720p_video_on_cmd152},
+{ 0x8 , nt35590_720p_video_on_cmd153},
+{ 0x8 , nt35590_720p_video_on_cmd154},
+{ 0x8 , nt35590_720p_video_on_cmd155},
+{ 0x8 , nt35590_720p_video_on_cmd156},
+{ 0x8 , nt35590_720p_video_on_cmd157},
+{ 0x8 , nt35590_720p_video_on_cmd158},
+{ 0x8 , nt35590_720p_video_on_cmd159},
+{ 0x8 , nt35590_720p_video_on_cmd160},
+{ 0x8 , nt35590_720p_video_on_cmd161},
+{ 0x8 , nt35590_720p_video_on_cmd162},
+{ 0x8 , nt35590_720p_video_on_cmd163},
+{ 0x8 , nt35590_720p_video_on_cmd164},
+{ 0x8 , nt35590_720p_video_on_cmd165},
+{ 0x8 , nt35590_720p_video_on_cmd166},
+{ 0x8 , nt35590_720p_video_on_cmd167},
+{ 0x8 , nt35590_720p_video_on_cmd168},
+{ 0x8 , nt35590_720p_video_on_cmd169},
+{ 0x8 , nt35590_720p_video_on_cmd170},
+{ 0x8 , nt35590_720p_video_on_cmd171},
+{ 0x8 , nt35590_720p_video_on_cmd172},
+{ 0x8 , nt35590_720p_video_on_cmd173},
+{ 0x8 , nt35590_720p_video_on_cmd174},
+{ 0x8 , nt35590_720p_video_on_cmd175},
+{ 0x8 , nt35590_720p_video_on_cmd176},
+{ 0x8 , nt35590_720p_video_on_cmd177},
+{ 0x8 , nt35590_720p_video_on_cmd178},
+{ 0x8 , nt35590_720p_video_on_cmd179},
+{ 0x8 , nt35590_720p_video_on_cmd180},
+{ 0x8 , nt35590_720p_video_on_cmd181},
+{ 0x8 , nt35590_720p_video_on_cmd182},
+{ 0x8 , nt35590_720p_video_on_cmd183},
+{ 0x8 , nt35590_720p_video_on_cmd184},
+{ 0x8 , nt35590_720p_video_on_cmd185},
+{ 0x8 , nt35590_720p_video_on_cmd186},
+{ 0x8 , nt35590_720p_video_on_cmd187},
+{ 0x8 , nt35590_720p_video_on_cmd188},
+{ 0x8 , nt35590_720p_video_on_cmd189},
+{ 0x8 , nt35590_720p_video_on_cmd190},
+{ 0x8 , nt35590_720p_video_on_cmd191},
+{ 0x8 , nt35590_720p_video_on_cmd192},
+{ 0x8 , nt35590_720p_video_on_cmd193},
+{ 0x8 , nt35590_720p_video_on_cmd194},
+{ 0x8 , nt35590_720p_video_on_cmd195},
+{ 0x8 , nt35590_720p_video_on_cmd196},
+{ 0x8 , nt35590_720p_video_on_cmd197},
+{ 0x8 , nt35590_720p_video_on_cmd198},
+{ 0x8 , nt35590_720p_video_on_cmd199},
+{ 0x8 , nt35590_720p_video_on_cmd200},
+{ 0x8 , nt35590_720p_video_on_cmd201},
+{ 0x8 , nt35590_720p_video_on_cmd202},
+{ 0x8 , nt35590_720p_video_on_cmd203},
+{ 0x8 , nt35590_720p_video_on_cmd204},
+{ 0x8 , nt35590_720p_video_on_cmd205},
+{ 0x8 , nt35590_720p_video_on_cmd206},
+{ 0x8 , nt35590_720p_video_on_cmd207},
+{ 0x8 , nt35590_720p_video_on_cmd208},
+{ 0x8 , nt35590_720p_video_on_cmd209},
+{ 0x8 , nt35590_720p_video_on_cmd210},
+{ 0x8 , nt35590_720p_video_on_cmd211},
+{ 0x8 , nt35590_720p_video_on_cmd212},
+{ 0x8 , nt35590_720p_video_on_cmd213},
+{ 0x8 , nt35590_720p_video_on_cmd214},
+{ 0x8 , nt35590_720p_video_on_cmd215},
+{ 0x8 , nt35590_720p_video_on_cmd216},
+{ 0x8 , nt35590_720p_video_on_cmd217},
+{ 0x8 , nt35590_720p_video_on_cmd218},
+{ 0x8 , nt35590_720p_video_on_cmd219},
+{ 0x8 , nt35590_720p_video_on_cmd220},
+{ 0x8 , nt35590_720p_video_on_cmd221},
+{ 0x8 , nt35590_720p_video_on_cmd222},
+{ 0x8 , nt35590_720p_video_on_cmd223},
+{ 0x8 , nt35590_720p_video_on_cmd224},
+{ 0x8 , nt35590_720p_video_on_cmd225},
+{ 0x8 , nt35590_720p_video_on_cmd226},
+{ 0x8 , nt35590_720p_video_on_cmd227},
+{ 0x8 , nt35590_720p_video_on_cmd228},
+{ 0x8 , nt35590_720p_video_on_cmd229},
+{ 0x8 , nt35590_720p_video_on_cmd230},
+{ 0x8 , nt35590_720p_video_on_cmd231},
+{ 0x8 , nt35590_720p_video_on_cmd232},
+{ 0x8 , nt35590_720p_video_on_cmd233},
+{ 0x8 , nt35590_720p_video_on_cmd234},
+{ 0x8 , nt35590_720p_video_on_cmd235},
+{ 0x8 , nt35590_720p_video_on_cmd236},
+{ 0x8 , nt35590_720p_video_on_cmd237},
+{ 0x8 , nt35590_720p_video_on_cmd238},
+{ 0x8 , nt35590_720p_video_on_cmd239},
+{ 0x8 , nt35590_720p_video_on_cmd240},
+{ 0x8 , nt35590_720p_video_on_cmd241},
+{ 0x8 , nt35590_720p_video_on_cmd242},
+{ 0x8 , nt35590_720p_video_on_cmd243},
+{ 0x8 , nt35590_720p_video_on_cmd244},
+{ 0x8 , nt35590_720p_video_on_cmd245},
+{ 0x8 , nt35590_720p_video_on_cmd246},
+{ 0x8 , nt35590_720p_video_on_cmd247},
+{ 0x8 , nt35590_720p_video_on_cmd248},
+{ 0x8 , nt35590_720p_video_on_cmd249},
+{ 0x8 , nt35590_720p_video_on_cmd250},
+{ 0x8 , nt35590_720p_video_on_cmd251},
+{ 0x8 , nt35590_720p_video_on_cmd252},
+{ 0x8 , nt35590_720p_video_on_cmd253},
+{ 0x8 , nt35590_720p_video_on_cmd254},
+{ 0x8 , nt35590_720p_video_on_cmd255},
+{ 0x8 , nt35590_720p_video_on_cmd256},
+{ 0x8 , nt35590_720p_video_on_cmd257},
+{ 0x8 , nt35590_720p_video_on_cmd258},
+{ 0x8 , nt35590_720p_video_on_cmd259},
+{ 0x8 , nt35590_720p_video_on_cmd260},
+{ 0x8 , nt35590_720p_video_on_cmd261},
+{ 0x8 , nt35590_720p_video_on_cmd262},
+{ 0x8 , nt35590_720p_video_on_cmd263},
+{ 0x8 , nt35590_720p_video_on_cmd264},
+{ 0x8 , nt35590_720p_video_on_cmd265},
+{ 0x8 , nt35590_720p_video_on_cmd266},
+{ 0x8 , nt35590_720p_video_on_cmd267},
+{ 0x8 , nt35590_720p_video_on_cmd268},
+{ 0x8 , nt35590_720p_video_on_cmd269},
+{ 0x8 , nt35590_720p_video_on_cmd270},
+{ 0x8 , nt35590_720p_video_on_cmd271},
+{ 0x8 , nt35590_720p_video_on_cmd272},
+{ 0x8 , nt35590_720p_video_on_cmd273},
+{ 0x8 , nt35590_720p_video_on_cmd274},
+{ 0x8 , nt35590_720p_video_on_cmd275},
+{ 0x8 , nt35590_720p_video_on_cmd276},
+{ 0x8 , nt35590_720p_video_on_cmd277},
+{ 0x8 , nt35590_720p_video_on_cmd278},
+{ 0x8 , nt35590_720p_video_on_cmd279},
+{ 0x8 , nt35590_720p_video_on_cmd280},
+{ 0x8 , nt35590_720p_video_on_cmd281},
+{ 0x8 , nt35590_720p_video_on_cmd282},
+{ 0x8 , nt35590_720p_video_on_cmd283},
+{ 0x8 , nt35590_720p_video_on_cmd284},
+{ 0x8 , nt35590_720p_video_on_cmd285},
+{ 0x8 , nt35590_720p_video_on_cmd286},
+{ 0x8 , nt35590_720p_video_on_cmd287},
+{ 0x8 , nt35590_720p_video_on_cmd288},
+{ 0x8 , nt35590_720p_video_on_cmd289},
+{ 0x8 , nt35590_720p_video_on_cmd290},
+{ 0x8 , nt35590_720p_video_on_cmd291},
+{ 0x8 , nt35590_720p_video_on_cmd292},
+{ 0x8 , nt35590_720p_video_on_cmd293},
+{ 0x8 , nt35590_720p_video_on_cmd294},
+{ 0x8 , nt35590_720p_video_on_cmd295},
+{ 0x8 , nt35590_720p_video_on_cmd296},
+{ 0x8 , nt35590_720p_video_on_cmd297},
+{ 0x8 , nt35590_720p_video_on_cmd298},
+{ 0x8 , nt35590_720p_video_on_cmd299},
+{ 0x8 , nt35590_720p_video_on_cmd300},
+{ 0x8 , nt35590_720p_video_on_cmd301},
+{ 0x8 , nt35590_720p_video_on_cmd302},
+{ 0x8 , nt35590_720p_video_on_cmd303},
+{ 0x8 , nt35590_720p_video_on_cmd304},
+{ 0x8 , nt35590_720p_video_on_cmd305},
+{ 0x8 , nt35590_720p_video_on_cmd306},
+{ 0x8 , nt35590_720p_video_on_cmd307},
+{ 0x8 , nt35590_720p_video_on_cmd308},
+{ 0x8 , nt35590_720p_video_on_cmd309},
+{ 0x8 , nt35590_720p_video_on_cmd310},
+{ 0x8 , nt35590_720p_video_on_cmd311},
+{ 0x8 , nt35590_720p_video_on_cmd312},
+{ 0x8 , nt35590_720p_video_on_cmd313},
+{ 0x8 , nt35590_720p_video_on_cmd314},
+{ 0x8 , nt35590_720p_video_on_cmd315},
+{ 0x8 , nt35590_720p_video_on_cmd316},
+{ 0x8 , nt35590_720p_video_on_cmd317},
+{ 0x8 , nt35590_720p_video_on_cmd318},
+{ 0x8 , nt35590_720p_video_on_cmd319},
+{ 0x8 , nt35590_720p_video_on_cmd320},
+{ 0x8 , nt35590_720p_video_on_cmd321},
+{ 0x8 , nt35590_720p_video_on_cmd322},
+{ 0x8 , nt35590_720p_video_on_cmd323},
+{ 0x8 , nt35590_720p_video_on_cmd324},
+{ 0x8 , nt35590_720p_video_on_cmd325},
+{ 0x8 , nt35590_720p_video_on_cmd326},
+{ 0x8 , nt35590_720p_video_on_cmd327},
+{ 0x8 , nt35590_720p_video_on_cmd328},
+{ 0x8 , nt35590_720p_video_on_cmd329},
+{ 0x8 , nt35590_720p_video_on_cmd330},
+{ 0x8 , nt35590_720p_video_on_cmd331},
+{ 0x8 , nt35590_720p_video_on_cmd332},
+{ 0x8 , nt35590_720p_video_on_cmd333},
+{ 0x8 , nt35590_720p_video_on_cmd334},
+{ 0x8 , nt35590_720p_video_on_cmd335},
+{ 0x8 , nt35590_720p_video_on_cmd336},
+{ 0x8 , nt35590_720p_video_on_cmd337},
+{ 0x8 , nt35590_720p_video_on_cmd338},
+{ 0x8 , nt35590_720p_video_on_cmd339},
+{ 0x8 , nt35590_720p_video_on_cmd340},
+{ 0x8 , nt35590_720p_video_on_cmd341},
+{ 0x8 , nt35590_720p_video_on_cmd342},
+{ 0x8 , nt35590_720p_video_on_cmd343},
+{ 0x8 , nt35590_720p_video_on_cmd344},
+{ 0x8 , nt35590_720p_video_on_cmd345},
+{ 0x8 , nt35590_720p_video_on_cmd346},
+{ 0x8 , nt35590_720p_video_on_cmd347},
+{ 0x8 , nt35590_720p_video_on_cmd348},
+{ 0x8 , nt35590_720p_video_on_cmd349},
+{ 0x8 , nt35590_720p_video_on_cmd350},
+{ 0x8 , nt35590_720p_video_on_cmd351},
+{ 0x8 , nt35590_720p_video_on_cmd352},
+{ 0x8 , nt35590_720p_video_on_cmd353},
+{ 0x8 , nt35590_720p_video_on_cmd354},
+{ 0x8 , nt35590_720p_video_on_cmd355},
+{ 0x8 , nt35590_720p_video_on_cmd356},
+{ 0x8 , nt35590_720p_video_on_cmd357},
+{ 0x8 , nt35590_720p_video_on_cmd358},
+{ 0x8 , nt35590_720p_video_on_cmd359},
+{ 0x8 , nt35590_720p_video_on_cmd360},
+{ 0x8 , nt35590_720p_video_on_cmd361},
+{ 0x8 , nt35590_720p_video_on_cmd362},
+{ 0x8 , nt35590_720p_video_on_cmd363},
+{ 0x8 , nt35590_720p_video_on_cmd364},
+{ 0x8 , nt35590_720p_video_on_cmd365},
+{ 0x8 , nt35590_720p_video_on_cmd366},
+{ 0x8 , nt35590_720p_video_on_cmd367},
+{ 0x8 , nt35590_720p_video_on_cmd368},
+{ 0x8 , nt35590_720p_video_on_cmd369},
+{ 0x8 , nt35590_720p_video_on_cmd370},
+{ 0x8 , nt35590_720p_video_on_cmd371},
+{ 0x8 , nt35590_720p_video_on_cmd372},
+{ 0x8 , nt35590_720p_video_on_cmd373},
+{ 0x8 , nt35590_720p_video_on_cmd374},
+{ 0x8 , nt35590_720p_video_on_cmd375},
+{ 0x8 , nt35590_720p_video_on_cmd376},
+{ 0x8 , nt35590_720p_video_on_cmd377},
+{ 0x8 , nt35590_720p_video_on_cmd378},
+{ 0x8 , nt35590_720p_video_on_cmd379},
+{ 0x8 , nt35590_720p_video_on_cmd380},
+{ 0x8 , nt35590_720p_video_on_cmd381},
+{ 0x8 , nt35590_720p_video_on_cmd382},
+{ 0x8 , nt35590_720p_video_on_cmd383},
+{ 0x8 , nt35590_720p_video_on_cmd384},
+{ 0x8 , nt35590_720p_video_on_cmd385},
+{ 0x8 , nt35590_720p_video_on_cmd386},
+{ 0x8 , nt35590_720p_video_on_cmd387},
+{ 0x8 , nt35590_720p_video_on_cmd388},
+{ 0x8 , nt35590_720p_video_on_cmd389},
+{ 0x8 , nt35590_720p_video_on_cmd390},
+{ 0x8 , nt35590_720p_video_on_cmd391},
+{ 0x8 , nt35590_720p_video_on_cmd392},
+{ 0x8 , nt35590_720p_video_on_cmd393},
+{ 0x8 , nt35590_720p_video_on_cmd394},
+{ 0x8 , nt35590_720p_video_on_cmd395},
+{ 0x8 , nt35590_720p_video_on_cmd396},
+{ 0x8 , nt35590_720p_video_on_cmd397},
+{ 0x8 , nt35590_720p_video_on_cmd398},
+{ 0x8 , nt35590_720p_video_on_cmd399},
+{ 0x8 , nt35590_720p_video_on_cmd400},
+{ 0x8 , nt35590_720p_video_on_cmd401},
+{ 0x8 , nt35590_720p_video_on_cmd402},
+{ 0x8 , nt35590_720p_video_on_cmd403},
+{ 0x8 , nt35590_720p_video_on_cmd404},
+{ 0x8 , nt35590_720p_video_on_cmd405},
+{ 0x8 , nt35590_720p_video_on_cmd406},
+{ 0x8 , nt35590_720p_video_on_cmd407},
+{ 0x8 , nt35590_720p_video_on_cmd408},
+{ 0x8 , nt35590_720p_video_on_cmd409},
+{ 0x8 , nt35590_720p_video_on_cmd410},
+{ 0x8 , nt35590_720p_video_on_cmd411},
+{ 0x8 , nt35590_720p_video_on_cmd412},
+{ 0x8 , nt35590_720p_video_on_cmd413},
+{ 0x8 , nt35590_720p_video_on_cmd414},
+{ 0x8 , nt35590_720p_video_on_cmd415},
+{ 0x8 , nt35590_720p_video_on_cmd416},
+{ 0x8 , nt35590_720p_video_on_cmd417},
+{ 0x8 , nt35590_720p_video_on_cmd418},
+{ 0x8 , nt35590_720p_video_on_cmd419},
+{ 0x8 , nt35590_720p_video_on_cmd420},
+{ 0x8 , nt35590_720p_video_on_cmd421},
+{ 0x8 , nt35590_720p_video_on_cmd422},
+{ 0x8 , nt35590_720p_video_on_cmd423},
+{ 0x8 , nt35590_720p_video_on_cmd424},
+{ 0x8 , nt35590_720p_video_on_cmd425},
+{ 0x8 , nt35590_720p_video_on_cmd426},
+{ 0x8 , nt35590_720p_video_on_cmd427},
+{ 0x8 , nt35590_720p_video_on_cmd428},
+{ 0x8 , nt35590_720p_video_on_cmd429},
+{ 0x8 , nt35590_720p_video_on_cmd430},
+{ 0x8 , nt35590_720p_video_on_cmd431},
+{ 0x8 , nt35590_720p_video_on_cmd432},
+{ 0x8 , nt35590_720p_video_on_cmd433},
+{ 0x8 , nt35590_720p_video_on_cmd434},
+{ 0x8 , nt35590_720p_video_on_cmd435},
+{ 0x8 , nt35590_720p_video_on_cmd436},
+{ 0x8 , nt35590_720p_video_on_cmd437},
+{ 0x8 , nt35590_720p_video_on_cmd438},
+{ 0x8 , nt35590_720p_video_on_cmd439},
+{ 0x8 , nt35590_720p_video_on_cmd440},
+{ 0x8 , nt35590_720p_video_on_cmd441},
+{ 0x8 , nt35590_720p_video_on_cmd442},
+{ 0x8 , nt35590_720p_video_on_cmd443},
+{ 0x8 , nt35590_720p_video_on_cmd444},
+{ 0x8 , nt35590_720p_video_on_cmd445},
+{ 0x8 , nt35590_720p_video_on_cmd446},
+{ 0x8 , nt35590_720p_video_on_cmd447},
+{ 0x8 , nt35590_720p_video_on_cmd448},
+{ 0x8 , nt35590_720p_video_on_cmd449},
+{ 0x8 , nt35590_720p_video_on_cmd450},
+{ 0x8 , nt35590_720p_video_on_cmd451},
+{ 0x8 , nt35590_720p_video_on_cmd452},
+{ 0x8 , nt35590_720p_video_on_cmd453},
+{ 0x8 , nt35590_720p_video_on_cmd454},
+{ 0x8 , nt35590_720p_video_on_cmd455},
+{ 0x8 , nt35590_720p_video_on_cmd456},
+{ 0x8 , nt35590_720p_video_on_cmd457},
+{ 0x8 , nt35590_720p_video_on_cmd458},
+{ 0x8 , nt35590_720p_video_on_cmd459},
+{ 0x8 , nt35590_720p_video_on_cmd460},
+{ 0x8 , nt35590_720p_video_on_cmd461},
+{ 0x8 , nt35590_720p_video_on_cmd462},
+{ 0x8 , nt35590_720p_video_on_cmd463}
+};
+#define NT35590_720P_VIDEO_ON_COMMAND 464
+
+
+static char nt35590_720p_videooff_cmd0[] = {
+0x28, 0x00, 0x05, 0x80 };
+
+
+static char nt35590_720p_videooff_cmd1[] = {
+0x10, 0x00, 0x05, 0x80 };
+
+
+
+
+static struct mipi_dsi_cmd nt35590_720p_video_off_command[] = {
+{ 0x4 , nt35590_720p_videooff_cmd0},
+{ 0x4 , nt35590_720p_videooff_cmd1}
+};
+#define NT35590_720P_VIDEO_OFF_COMMAND 2
+
+
+static struct command_state nt35590_720p_video_state = {
+  0, 1
+};
+
+/*---------------------------------------------------------------------------*/
+/* Command mode panel information                                            */
+/*---------------------------------------------------------------------------*/
+
+static struct commandpanel_info nt35590_720p_video_command_panel = {
+  0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Video mode panel information                                              */
+/*---------------------------------------------------------------------------*/
+
+static struct videopanel_info nt35590_720p_video_video_panel = {
+  1, 0, 0, 0, 1, 1, 2, 0, 0x9
+};
+
+/*---------------------------------------------------------------------------*/
+/* Lane Configuration                                                        */
+/*---------------------------------------------------------------------------*/
+
+static struct lane_configuration nt35590_720p_video_lane_config = {
+  4, 0, 1, 1, 1, 1
+};
+
+
+/*---------------------------------------------------------------------------*/
+/* Panel Timing                                                              */
+/*---------------------------------------------------------------------------*/
+const uint32_t nt35590_720p_video_timings[] = {
+  0x7d, 0x25, 0x1d, 0x00, 0x37, 0x33, 0x22, 0x27, 0x1e, 0x03, 0x04, 0x00
+};
+
+
+
+static struct mipi_dsi_cmd nt35590_720p_video_rotation[] = {
+
+};
+#define NT35590_720P_VIDEO_ROTATION 0
+
+
+static struct panel_timing nt35590_720p_video_timing_info = {
+  0, 4, 0x20, 0x2c
+};
+
+/*---------------------------------------------------------------------------*/
+/* Backlight Settings                                                        */
+/*---------------------------------------------------------------------------*/
+
+static struct backlight nt35590_720p_video_backlight = {
+  1, 1, 4095, 100, 1, "PMIC_8941"
+};
+
+
+#endif /*_PANEL_NT35590_720P_VIDEO_H_*/
diff --git a/dev/gcdb/display/include/panel_nt35596_1080p_video.h b/dev/gcdb/display/include/panel_nt35596_1080p_video.h
new file mode 100644
index 0000000..d90dff9
--- /dev/null
+++ b/dev/gcdb/display/include/panel_nt35596_1080p_video.h
@@ -0,0 +1,3263 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+/*---------------------------------------------------------------------------
+ * This file is autogenerated file using gcdb parser. Please do not edit it.
+ * Update input XML file to add a new entry or update variable in this file
+ * VERSION = "1.0"
+ *---------------------------------------------------------------------------*/
+
+#ifndef _PANEL_NT35596_1080P_VIDEO_H_
+
+#define _PANEL_NT35596_1080P_VIDEO_H_
+/*---------------------------------------------------------------------------*/
+/* HEADER files                                                              */
+/*---------------------------------------------------------------------------*/
+#include "panel.h"
+
+/*---------------------------------------------------------------------------*/
+/* Panel configuration                                                       */
+/*---------------------------------------------------------------------------*/
+
+static struct panel_config nt35596_1080p_video_panel_data = {
+  "nt35596 1080p video mode dsi panel", "mdss_dsi0", "qcom,mdss-dsi-panel",
+  10, 0, "DISPLAY_1", 0, 0, 60, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel resolution                                                          */
+/*---------------------------------------------------------------------------*/
+static struct panel_resolution nt35596_1080p_video_panel_res = {
+  1080, 1920, 32, 32, 8, 0, 2, 18, 2, 0, 0, 0, 0, 0, 0, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel Color Information                                                   */
+/*---------------------------------------------------------------------------*/
+static struct color_info nt35596_1080p_video_color = {
+  24, 0, 0xff, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel Command information                                                 */
+/*---------------------------------------------------------------------------*/
+static char nt35596_1080p_video_on_cmd0[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0xEE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd1[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd2[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1F, 0x45, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd3[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x24, 0x4F, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd4[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x38, 0xC8, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd5[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x39, 0x2C, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd6[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1E, 0xBB, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd7[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1D, 0x0F, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd8[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7E, 0xB1, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd9[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd10[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd11[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x35, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd12[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBA, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd13[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd14[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd15[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x00, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd16[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x01, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd17[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x02, 0x40, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd18[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x05, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd19[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x06, 0x1B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd20[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x07, 0x24, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd21[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x08, 0x0C, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd22[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0B, 0x87, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd23[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0C, 0x87, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd24[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0E, 0xB0, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd25[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0F, 0xB3, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd26[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x10, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd27[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x12, 0x10, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd28[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x13, 0x05, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd29[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x14, 0x4A, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd30[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x15, 0x18, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd31[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x16, 0x18, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd32[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x18, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd33[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x19, 0x77, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd34[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1A, 0x55, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd35[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1B, 0x13, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd36[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1C, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd37[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd38[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1E, 0x13, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd39[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1F, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd40[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x23, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd41[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x24, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd42[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x25, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd43[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x26, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd44[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x27, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd45[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x28, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd46[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x35, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd47[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x66, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd48[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x58, 0x82, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd49[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x59, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd50[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5A, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd51[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5B, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd52[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5C, 0x82, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd53[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5D, 0x82, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd54[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5E, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd55[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5F, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd56[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x72, 0x31, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd57[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x05, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd58[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd59[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x00, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd60[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x01, 0x0B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd61[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x02, 0x0C, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd62[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x03, 0x09, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd63[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x04, 0x0A, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd64[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x05, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd65[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x06, 0x0F, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd66[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x07, 0x10, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd67[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x08, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd68[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x09, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd69[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0A, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd70[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0B, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd71[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0C, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd72[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0D, 0x13, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd73[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0E, 0x15, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd74[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0F, 0x17, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd75[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x10, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd76[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x0B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd77[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x12, 0x0C, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd78[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x13, 0x09, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd79[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x14, 0x0A, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd80[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x15, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd81[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x16, 0x0F, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd82[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x17, 0x10, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd83[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x18, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd84[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x19, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd85[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1A, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd86[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1B, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd87[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1C, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd88[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1D, 0x13, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd89[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1E, 0x15, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd90[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1F, 0x17, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd91[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x20, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd92[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x21, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd93[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x22, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd94[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x23, 0x40, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd95[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x24, 0x40, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd96[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x25, 0xED, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd97[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x29, 0x58, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd98[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2A, 0x12, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd99[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2B, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd100[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4B, 0x06, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd101[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4C, 0x11, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd102[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4D, 0x20, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd103[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4E, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd104[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4F, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd105[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x50, 0x20, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd106[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x51, 0x61, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd107[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x52, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd108[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x53, 0x63, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd109[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x54, 0x77, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd110[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x55, 0xED, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd111[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5B, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd112[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5C, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd113[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd114[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5E, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd115[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5F, 0x15, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd116[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x60, 0x75, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd117[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x61, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd118[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x62, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd119[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x63, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd120[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x64, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd121[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x65, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd122[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x66, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd123[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x67, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd124[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x68, 0x04, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd125[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x69, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd126[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6A, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd127[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6C, 0x40, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd128[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x75, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd129[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x76, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd130[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7A, 0x80, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd131[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7B, 0xC5, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd132[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7C, 0xD8, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd133[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7D, 0x60, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd134[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7F, 0x10, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd135[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x80, 0x81, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd136[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x83, 0x05, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd137[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x93, 0x08, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd138[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x94, 0x10, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd139[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8A, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd140[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9B, 0x0F, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd141[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEA, 0xFF, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd142[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEC, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd143[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd144[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd145[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x75, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd146[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x76, 0x8E, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd147[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x77, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd148[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x78, 0x90, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd149[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x79, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd150[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7A, 0xB2, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd151[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7B, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd152[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7C, 0xC7, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd153[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd154[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7E, 0xD7, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd155[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7F, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd156[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x80, 0xE9, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd157[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x81, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd158[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x82, 0xF9, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd159[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x83, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd160[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x84, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd161[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x85, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd162[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x86, 0x0B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd163[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x87, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd164[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x88, 0x3A, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd165[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x89, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd166[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8A, 0x5D, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd167[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8B, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd168[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8C, 0x94, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd169[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8D, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd170[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8E, 0xBC, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd171[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8F, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd172[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x90, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd173[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x91, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd174[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x92, 0x39, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd175[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x93, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd176[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x94, 0x3A, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd177[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x95, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd178[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x96, 0x6B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd179[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x97, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd180[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x98, 0xA2, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd181[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x99, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd182[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9A, 0xC7, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd183[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9B, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd184[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9C, 0xFB, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd185[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd186[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9E, 0x20, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd187[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd188[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA0, 0x54, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd189[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA2, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd190[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA3, 0x6D, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd191[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA4, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd192[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA5, 0x80, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd193[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA6, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd194[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA7, 0x81, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd195[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd196[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAA, 0xC7, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd197[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd198[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAC, 0xF0, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd199[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd200[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAE, 0xF8, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd201[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAF, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd202[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB0, 0xFD, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd203[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB1, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd204[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB2, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd205[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB3, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd206[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB4, 0x8E, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd207[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB5, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd208[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB6, 0x90, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd209[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB7, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd210[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB8, 0xB2, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd211[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB9, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd212[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBA, 0xC7, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd213[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBB, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd214[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBC, 0xD7, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd215[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBD, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd216[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBE, 0xE9, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd217[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd218[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC0, 0xF9, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd219[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC1, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd220[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC2, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd221[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC3, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd222[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC4, 0x0B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd223[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC5, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd224[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC6, 0x3A, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd225[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC7, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd226[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC8, 0x5D, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd227[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC9, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd228[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCA, 0x94, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd229[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd230[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCC, 0xBC, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd231[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCD, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd232[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCE, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd233[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd234[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD0, 0x39, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd235[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD1, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd236[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD2, 0x3A, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd237[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD3, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd238[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD4, 0x6B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd239[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD5, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd240[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD6, 0xA2, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd241[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD7, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd242[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD8, 0xC7, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd243[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD9, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd244[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDA, 0xFB, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd245[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd246[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDC, 0x20, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd247[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd248[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDE, 0x54, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd249[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDF, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd250[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE0, 0x6D, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd251[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE1, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd252[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE2, 0x80, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd253[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE3, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd254[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE4, 0x81, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd255[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE5, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd256[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE6, 0xC7, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd257[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE7, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd258[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE8, 0xF0, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd259[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd260[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEA, 0xF8, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd261[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd262[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEC, 0xFD, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd263[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xED, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd264[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEE, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd265[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd266[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF0, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd267[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF1, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd268[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF2, 0x0B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd269[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF3, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd270[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF4, 0x0D, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd271[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF5, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd272[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF6, 0x4A, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd273[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF7, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd274[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF8, 0x71, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd275[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xF9, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd276[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFA, 0x8C, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd277[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd278[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd279[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x00, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd280[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x01, 0xA1, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd281[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x02, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd282[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x03, 0xB6, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd283[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x04, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd284[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x05, 0xC9, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd285[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x06, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd286[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x07, 0xFD, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd287[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x08, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd288[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x09, 0x29, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd289[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0A, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd290[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0B, 0x6B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd291[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0C, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd292[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0D, 0x9E, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd293[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0E, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd294[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x0F, 0xEB, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd295[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x10, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd296[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x25, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd297[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x12, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd298[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x13, 0x27, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd299[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x14, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd300[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x15, 0x5C, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd301[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x16, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd302[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x17, 0x95, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd303[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x18, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd304[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x19, 0xBA, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd305[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1A, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd306[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1B, 0xEC, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd307[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1C, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd308[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1D, 0x0C, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd309[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1E, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd310[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x1F, 0x34, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd311[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x20, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd312[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x21, 0x3F, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd313[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x22, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd314[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x23, 0x48, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd315[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x24, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd316[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x25, 0x49, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd317[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x26, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd318[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x27, 0x6B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd319[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x28, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd320[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x29, 0x7E, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd321[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2A, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd322[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2B, 0x8F, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd323[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd324[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x2F, 0x9E, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd325[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x30, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd326[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x31, 0xA0, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd327[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x32, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd328[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x33, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd329[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x34, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd330[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x35, 0x0B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd331[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x36, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd332[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x37, 0x0D, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd333[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x38, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd334[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x39, 0x4A, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd335[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3A, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd336[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3B, 0x71, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd337[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3D, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd338[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x3F, 0x8C, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd339[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x40, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd340[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x41, 0xA1, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd341[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x42, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd342[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x43, 0xB6, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd343[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x44, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd344[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x45, 0xC9, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd345[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x46, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd346[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x47, 0xFD, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd347[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x48, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd348[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x49, 0x29, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd349[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4A, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd350[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4B, 0x6B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd351[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4C, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd352[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4D, 0x9E, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd353[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4E, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd354[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x4F, 0xEB, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd355[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x50, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd356[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x51, 0x25, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd357[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x52, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd358[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x53, 0x27, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd359[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x54, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd360[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x55, 0x5C, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd361[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x56, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd362[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x58, 0x95, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd363[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x59, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd364[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5A, 0xBA, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd365[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5B, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd366[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5C, 0xEC, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd367[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd368[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5E, 0x0C, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd369[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x5F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd370[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x60, 0x34, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd371[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x61, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd372[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x62, 0x3F, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd373[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x63, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd374[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x64, 0x48, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd375[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x65, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd376[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x66, 0x49, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd377[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x67, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd378[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x68, 0x6B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd379[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x69, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd380[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6A, 0x7E, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd381[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6B, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd382[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6C, 0x8F, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd383[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd384[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6E, 0x9E, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd385[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x6F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd386[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x70, 0xA0, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd387[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x71, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd388[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x72, 0xFB, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd389[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x73, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd390[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x74, 0xFD, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd391[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x75, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd392[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x76, 0x05, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd393[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x77, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd394[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x78, 0x0D, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd395[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x79, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd396[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7A, 0x17, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd397[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7B, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd398[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7C, 0x1F, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd399[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7D, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd400[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7E, 0x28, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd401[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x7F, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd402[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x80, 0x32, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd403[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x81, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd404[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x82, 0x38, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd405[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x83, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd406[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x84, 0x53, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd407[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x85, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd408[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x86, 0x72, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd409[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x87, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd410[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x88, 0x9B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd411[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x89, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd412[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8A, 0xC3, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd413[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8B, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd414[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8C, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd415[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8D, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd416[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8E, 0x36, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd417[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x8F, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd418[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x90, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd419[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x91, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd420[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x92, 0x69, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd421[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x93, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd422[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x94, 0xA1, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd423[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x95, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd424[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x96, 0xC8, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd425[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x97, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd426[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x98, 0xFF, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd427[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x99, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd428[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9A, 0x26, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd429[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9B, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd430[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9C, 0x69, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd431[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9D, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd432[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9E, 0x88, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd433[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x9F, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd434[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA0, 0xF8, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd435[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA2, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd436[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA3, 0xF9, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd437[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA4, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd438[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA5, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd439[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA6, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd440[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA7, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd441[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xA9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd442[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAA, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd443[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd444[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAC, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd445[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd446[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAE, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd447[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xAF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd448[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB0, 0xFB, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd449[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB1, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd450[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB2, 0xFD, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd451[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB3, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd452[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB4, 0x05, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd453[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB5, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd454[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB6, 0x0D, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd455[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB7, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd456[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB8, 0x17, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd457[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xB9, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd458[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBA, 0x1F, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd459[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd460[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBC, 0x28, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd461[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBD, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd462[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBE, 0x32, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd463[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xBF, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd464[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC0, 0x38, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd465[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC1, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd466[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC2, 0x53, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd467[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC3, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd468[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC4, 0x72, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd469[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC5, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd470[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC6, 0x9B, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd471[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC7, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd472[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC8, 0xC3, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd473[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xC9, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd474[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCA, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd475[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCB, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd476[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCC, 0x36, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd477[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCD, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd478[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCE, 0x37, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd479[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xCF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd480[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD0, 0x69, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd481[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD1, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd482[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD2, 0xA1, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd483[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD3, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd484[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD4, 0xC8, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd485[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD5, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd486[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD6, 0xFF, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd487[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD7, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd488[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD8, 0x26, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd489[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd490[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDA, 0x69, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd491[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDB, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd492[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDC, 0x88, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd493[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDD, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd494[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDE, 0xF8, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd495[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xDF, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd496[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE0, 0xF9, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd497[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE1, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd498[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE2, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd499[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE3, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd500[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE4, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd501[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE5, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd502[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE6, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd503[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE7, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd504[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE8, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd505[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xE9, 0x03, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd506[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xEA, 0xFE, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd507[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd508[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd509[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x02, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd510[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd511[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x04, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd512[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFB, 0x01, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd513[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd514[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD3, 0x14, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd515[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xD4, 0x14, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd516[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x11, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd517[] = {
+0x02, 0x00, 0x29, 0xC0,
+0xFF, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd518[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x35, 0x00, 0xFF, 0xFF,  };
+
+
+static char nt35596_1080p_video_on_cmd519[] = {
+0x02, 0x00, 0x29, 0xC0,
+0x29, 0x00, 0xFF, 0xFF,  };
+
+
+
+
+static struct mipi_dsi_cmd nt35596_1080p_video_on_command[] = {
+{ 0x8 , nt35596_1080p_video_on_cmd0},
+{ 0x8 , nt35596_1080p_video_on_cmd1},
+{ 0x8 , nt35596_1080p_video_on_cmd2},
+{ 0x8 , nt35596_1080p_video_on_cmd3},
+{ 0x8 , nt35596_1080p_video_on_cmd4},
+{ 0x8 , nt35596_1080p_video_on_cmd5},
+{ 0x8 , nt35596_1080p_video_on_cmd6},
+{ 0x8 , nt35596_1080p_video_on_cmd7},
+{ 0x8 , nt35596_1080p_video_on_cmd8},
+{ 0x8 , nt35596_1080p_video_on_cmd9},
+{ 0x8 , nt35596_1080p_video_on_cmd10},
+{ 0x8 , nt35596_1080p_video_on_cmd11},
+{ 0x8 , nt35596_1080p_video_on_cmd12},
+{ 0x8 , nt35596_1080p_video_on_cmd13},
+{ 0x8 , nt35596_1080p_video_on_cmd14},
+{ 0x8 , nt35596_1080p_video_on_cmd15},
+{ 0x8 , nt35596_1080p_video_on_cmd16},
+{ 0x8 , nt35596_1080p_video_on_cmd17},
+{ 0x8 , nt35596_1080p_video_on_cmd18},
+{ 0x8 , nt35596_1080p_video_on_cmd19},
+{ 0x8 , nt35596_1080p_video_on_cmd20},
+{ 0x8 , nt35596_1080p_video_on_cmd21},
+{ 0x8 , nt35596_1080p_video_on_cmd22},
+{ 0x8 , nt35596_1080p_video_on_cmd23},
+{ 0x8 , nt35596_1080p_video_on_cmd24},
+{ 0x8 , nt35596_1080p_video_on_cmd25},
+{ 0x8 , nt35596_1080p_video_on_cmd26},
+{ 0x8 , nt35596_1080p_video_on_cmd27},
+{ 0x8 , nt35596_1080p_video_on_cmd28},
+{ 0x8 , nt35596_1080p_video_on_cmd29},
+{ 0x8 , nt35596_1080p_video_on_cmd30},
+{ 0x8 , nt35596_1080p_video_on_cmd31},
+{ 0x8 , nt35596_1080p_video_on_cmd32},
+{ 0x8 , nt35596_1080p_video_on_cmd33},
+{ 0x8 , nt35596_1080p_video_on_cmd34},
+{ 0x8 , nt35596_1080p_video_on_cmd35},
+{ 0x8 , nt35596_1080p_video_on_cmd36},
+{ 0x8 , nt35596_1080p_video_on_cmd37},
+{ 0x8 , nt35596_1080p_video_on_cmd38},
+{ 0x8 , nt35596_1080p_video_on_cmd39},
+{ 0x8 , nt35596_1080p_video_on_cmd40},
+{ 0x8 , nt35596_1080p_video_on_cmd41},
+{ 0x8 , nt35596_1080p_video_on_cmd42},
+{ 0x8 , nt35596_1080p_video_on_cmd43},
+{ 0x8 , nt35596_1080p_video_on_cmd44},
+{ 0x8 , nt35596_1080p_video_on_cmd45},
+{ 0x8 , nt35596_1080p_video_on_cmd46},
+{ 0x8 , nt35596_1080p_video_on_cmd47},
+{ 0x8 , nt35596_1080p_video_on_cmd48},
+{ 0x8 , nt35596_1080p_video_on_cmd49},
+{ 0x8 , nt35596_1080p_video_on_cmd50},
+{ 0x8 , nt35596_1080p_video_on_cmd51},
+{ 0x8 , nt35596_1080p_video_on_cmd52},
+{ 0x8 , nt35596_1080p_video_on_cmd53},
+{ 0x8 , nt35596_1080p_video_on_cmd54},
+{ 0x8 , nt35596_1080p_video_on_cmd55},
+{ 0x8 , nt35596_1080p_video_on_cmd56},
+{ 0x8 , nt35596_1080p_video_on_cmd57},
+{ 0x8 , nt35596_1080p_video_on_cmd58},
+{ 0x8 , nt35596_1080p_video_on_cmd59},
+{ 0x8 , nt35596_1080p_video_on_cmd60},
+{ 0x8 , nt35596_1080p_video_on_cmd61},
+{ 0x8 , nt35596_1080p_video_on_cmd62},
+{ 0x8 , nt35596_1080p_video_on_cmd63},
+{ 0x8 , nt35596_1080p_video_on_cmd64},
+{ 0x8 , nt35596_1080p_video_on_cmd65},
+{ 0x8 , nt35596_1080p_video_on_cmd66},
+{ 0x8 , nt35596_1080p_video_on_cmd67},
+{ 0x8 , nt35596_1080p_video_on_cmd68},
+{ 0x8 , nt35596_1080p_video_on_cmd69},
+{ 0x8 , nt35596_1080p_video_on_cmd70},
+{ 0x8 , nt35596_1080p_video_on_cmd71},
+{ 0x8 , nt35596_1080p_video_on_cmd72},
+{ 0x8 , nt35596_1080p_video_on_cmd73},
+{ 0x8 , nt35596_1080p_video_on_cmd74},
+{ 0x8 , nt35596_1080p_video_on_cmd75},
+{ 0x8 , nt35596_1080p_video_on_cmd76},
+{ 0x8 , nt35596_1080p_video_on_cmd77},
+{ 0x8 , nt35596_1080p_video_on_cmd78},
+{ 0x8 , nt35596_1080p_video_on_cmd79},
+{ 0x8 , nt35596_1080p_video_on_cmd80},
+{ 0x8 , nt35596_1080p_video_on_cmd81},
+{ 0x8 , nt35596_1080p_video_on_cmd82},
+{ 0x8 , nt35596_1080p_video_on_cmd83},
+{ 0x8 , nt35596_1080p_video_on_cmd84},
+{ 0x8 , nt35596_1080p_video_on_cmd85},
+{ 0x8 , nt35596_1080p_video_on_cmd86},
+{ 0x8 , nt35596_1080p_video_on_cmd87},
+{ 0x8 , nt35596_1080p_video_on_cmd88},
+{ 0x8 , nt35596_1080p_video_on_cmd89},
+{ 0x8 , nt35596_1080p_video_on_cmd90},
+{ 0x8 , nt35596_1080p_video_on_cmd91},
+{ 0x8 , nt35596_1080p_video_on_cmd92},
+{ 0x8 , nt35596_1080p_video_on_cmd93},
+{ 0x8 , nt35596_1080p_video_on_cmd94},
+{ 0x8 , nt35596_1080p_video_on_cmd95},
+{ 0x8 , nt35596_1080p_video_on_cmd96},
+{ 0x8 , nt35596_1080p_video_on_cmd97},
+{ 0x8 , nt35596_1080p_video_on_cmd98},
+{ 0x8 , nt35596_1080p_video_on_cmd99},
+{ 0x8 , nt35596_1080p_video_on_cmd100},
+{ 0x8 , nt35596_1080p_video_on_cmd101},
+{ 0x8 , nt35596_1080p_video_on_cmd102},
+{ 0x8 , nt35596_1080p_video_on_cmd103},
+{ 0x8 , nt35596_1080p_video_on_cmd104},
+{ 0x8 , nt35596_1080p_video_on_cmd105},
+{ 0x8 , nt35596_1080p_video_on_cmd106},
+{ 0x8 , nt35596_1080p_video_on_cmd107},
+{ 0x8 , nt35596_1080p_video_on_cmd108},
+{ 0x8 , nt35596_1080p_video_on_cmd109},
+{ 0x8 , nt35596_1080p_video_on_cmd110},
+{ 0x8 , nt35596_1080p_video_on_cmd111},
+{ 0x8 , nt35596_1080p_video_on_cmd112},
+{ 0x8 , nt35596_1080p_video_on_cmd113},
+{ 0x8 , nt35596_1080p_video_on_cmd114},
+{ 0x8 , nt35596_1080p_video_on_cmd115},
+{ 0x8 , nt35596_1080p_video_on_cmd116},
+{ 0x8 , nt35596_1080p_video_on_cmd117},
+{ 0x8 , nt35596_1080p_video_on_cmd118},
+{ 0x8 , nt35596_1080p_video_on_cmd119},
+{ 0x8 , nt35596_1080p_video_on_cmd120},
+{ 0x8 , nt35596_1080p_video_on_cmd121},
+{ 0x8 , nt35596_1080p_video_on_cmd122},
+{ 0x8 , nt35596_1080p_video_on_cmd123},
+{ 0x8 , nt35596_1080p_video_on_cmd124},
+{ 0x8 , nt35596_1080p_video_on_cmd125},
+{ 0x8 , nt35596_1080p_video_on_cmd126},
+{ 0x8 , nt35596_1080p_video_on_cmd127},
+{ 0x8 , nt35596_1080p_video_on_cmd128},
+{ 0x8 , nt35596_1080p_video_on_cmd129},
+{ 0x8 , nt35596_1080p_video_on_cmd130},
+{ 0x8 , nt35596_1080p_video_on_cmd131},
+{ 0x8 , nt35596_1080p_video_on_cmd132},
+{ 0x8 , nt35596_1080p_video_on_cmd133},
+{ 0x8 , nt35596_1080p_video_on_cmd134},
+{ 0x8 , nt35596_1080p_video_on_cmd135},
+{ 0x8 , nt35596_1080p_video_on_cmd136},
+{ 0x8 , nt35596_1080p_video_on_cmd137},
+{ 0x8 , nt35596_1080p_video_on_cmd138},
+{ 0x8 , nt35596_1080p_video_on_cmd139},
+{ 0x8 , nt35596_1080p_video_on_cmd140},
+{ 0x8 , nt35596_1080p_video_on_cmd141},
+{ 0x8 , nt35596_1080p_video_on_cmd142},
+{ 0x8 , nt35596_1080p_video_on_cmd143},
+{ 0x8 , nt35596_1080p_video_on_cmd144},
+{ 0x8 , nt35596_1080p_video_on_cmd145},
+{ 0x8 , nt35596_1080p_video_on_cmd146},
+{ 0x8 , nt35596_1080p_video_on_cmd147},
+{ 0x8 , nt35596_1080p_video_on_cmd148},
+{ 0x8 , nt35596_1080p_video_on_cmd149},
+{ 0x8 , nt35596_1080p_video_on_cmd150},
+{ 0x8 , nt35596_1080p_video_on_cmd151},
+{ 0x8 , nt35596_1080p_video_on_cmd152},
+{ 0x8 , nt35596_1080p_video_on_cmd153},
+{ 0x8 , nt35596_1080p_video_on_cmd154},
+{ 0x8 , nt35596_1080p_video_on_cmd155},
+{ 0x8 , nt35596_1080p_video_on_cmd156},
+{ 0x8 , nt35596_1080p_video_on_cmd157},
+{ 0x8 , nt35596_1080p_video_on_cmd158},
+{ 0x8 , nt35596_1080p_video_on_cmd159},
+{ 0x8 , nt35596_1080p_video_on_cmd160},
+{ 0x8 , nt35596_1080p_video_on_cmd161},
+{ 0x8 , nt35596_1080p_video_on_cmd162},
+{ 0x8 , nt35596_1080p_video_on_cmd163},
+{ 0x8 , nt35596_1080p_video_on_cmd164},
+{ 0x8 , nt35596_1080p_video_on_cmd165},
+{ 0x8 , nt35596_1080p_video_on_cmd166},
+{ 0x8 , nt35596_1080p_video_on_cmd167},
+{ 0x8 , nt35596_1080p_video_on_cmd168},
+{ 0x8 , nt35596_1080p_video_on_cmd169},
+{ 0x8 , nt35596_1080p_video_on_cmd170},
+{ 0x8 , nt35596_1080p_video_on_cmd171},
+{ 0x8 , nt35596_1080p_video_on_cmd172},
+{ 0x8 , nt35596_1080p_video_on_cmd173},
+{ 0x8 , nt35596_1080p_video_on_cmd174},
+{ 0x8 , nt35596_1080p_video_on_cmd175},
+{ 0x8 , nt35596_1080p_video_on_cmd176},
+{ 0x8 , nt35596_1080p_video_on_cmd177},
+{ 0x8 , nt35596_1080p_video_on_cmd178},
+{ 0x8 , nt35596_1080p_video_on_cmd179},
+{ 0x8 , nt35596_1080p_video_on_cmd180},
+{ 0x8 , nt35596_1080p_video_on_cmd181},
+{ 0x8 , nt35596_1080p_video_on_cmd182},
+{ 0x8 , nt35596_1080p_video_on_cmd183},
+{ 0x8 , nt35596_1080p_video_on_cmd184},
+{ 0x8 , nt35596_1080p_video_on_cmd185},
+{ 0x8 , nt35596_1080p_video_on_cmd186},
+{ 0x8 , nt35596_1080p_video_on_cmd187},
+{ 0x8 , nt35596_1080p_video_on_cmd188},
+{ 0x8 , nt35596_1080p_video_on_cmd189},
+{ 0x8 , nt35596_1080p_video_on_cmd190},
+{ 0x8 , nt35596_1080p_video_on_cmd191},
+{ 0x8 , nt35596_1080p_video_on_cmd192},
+{ 0x8 , nt35596_1080p_video_on_cmd193},
+{ 0x8 , nt35596_1080p_video_on_cmd194},
+{ 0x8 , nt35596_1080p_video_on_cmd195},
+{ 0x8 , nt35596_1080p_video_on_cmd196},
+{ 0x8 , nt35596_1080p_video_on_cmd197},
+{ 0x8 , nt35596_1080p_video_on_cmd198},
+{ 0x8 , nt35596_1080p_video_on_cmd199},
+{ 0x8 , nt35596_1080p_video_on_cmd200},
+{ 0x8 , nt35596_1080p_video_on_cmd201},
+{ 0x8 , nt35596_1080p_video_on_cmd202},
+{ 0x8 , nt35596_1080p_video_on_cmd203},
+{ 0x8 , nt35596_1080p_video_on_cmd204},
+{ 0x8 , nt35596_1080p_video_on_cmd205},
+{ 0x8 , nt35596_1080p_video_on_cmd206},
+{ 0x8 , nt35596_1080p_video_on_cmd207},
+{ 0x8 , nt35596_1080p_video_on_cmd208},
+{ 0x8 , nt35596_1080p_video_on_cmd209},
+{ 0x8 , nt35596_1080p_video_on_cmd210},
+{ 0x8 , nt35596_1080p_video_on_cmd211},
+{ 0x8 , nt35596_1080p_video_on_cmd212},
+{ 0x8 , nt35596_1080p_video_on_cmd213},
+{ 0x8 , nt35596_1080p_video_on_cmd214},
+{ 0x8 , nt35596_1080p_video_on_cmd215},
+{ 0x8 , nt35596_1080p_video_on_cmd216},
+{ 0x8 , nt35596_1080p_video_on_cmd217},
+{ 0x8 , nt35596_1080p_video_on_cmd218},
+{ 0x8 , nt35596_1080p_video_on_cmd219},
+{ 0x8 , nt35596_1080p_video_on_cmd220},
+{ 0x8 , nt35596_1080p_video_on_cmd221},
+{ 0x8 , nt35596_1080p_video_on_cmd222},
+{ 0x8 , nt35596_1080p_video_on_cmd223},
+{ 0x8 , nt35596_1080p_video_on_cmd224},
+{ 0x8 , nt35596_1080p_video_on_cmd225},
+{ 0x8 , nt35596_1080p_video_on_cmd226},
+{ 0x8 , nt35596_1080p_video_on_cmd227},
+{ 0x8 , nt35596_1080p_video_on_cmd228},
+{ 0x8 , nt35596_1080p_video_on_cmd229},
+{ 0x8 , nt35596_1080p_video_on_cmd230},
+{ 0x8 , nt35596_1080p_video_on_cmd231},
+{ 0x8 , nt35596_1080p_video_on_cmd232},
+{ 0x8 , nt35596_1080p_video_on_cmd233},
+{ 0x8 , nt35596_1080p_video_on_cmd234},
+{ 0x8 , nt35596_1080p_video_on_cmd235},
+{ 0x8 , nt35596_1080p_video_on_cmd236},
+{ 0x8 , nt35596_1080p_video_on_cmd237},
+{ 0x8 , nt35596_1080p_video_on_cmd238},
+{ 0x8 , nt35596_1080p_video_on_cmd239},
+{ 0x8 , nt35596_1080p_video_on_cmd240},
+{ 0x8 , nt35596_1080p_video_on_cmd241},
+{ 0x8 , nt35596_1080p_video_on_cmd242},
+{ 0x8 , nt35596_1080p_video_on_cmd243},
+{ 0x8 , nt35596_1080p_video_on_cmd244},
+{ 0x8 , nt35596_1080p_video_on_cmd245},
+{ 0x8 , nt35596_1080p_video_on_cmd246},
+{ 0x8 , nt35596_1080p_video_on_cmd247},
+{ 0x8 , nt35596_1080p_video_on_cmd248},
+{ 0x8 , nt35596_1080p_video_on_cmd249},
+{ 0x8 , nt35596_1080p_video_on_cmd250},
+{ 0x8 , nt35596_1080p_video_on_cmd251},
+{ 0x8 , nt35596_1080p_video_on_cmd252},
+{ 0x8 , nt35596_1080p_video_on_cmd253},
+{ 0x8 , nt35596_1080p_video_on_cmd254},
+{ 0x8 , nt35596_1080p_video_on_cmd255},
+{ 0x8 , nt35596_1080p_video_on_cmd256},
+{ 0x8 , nt35596_1080p_video_on_cmd257},
+{ 0x8 , nt35596_1080p_video_on_cmd258},
+{ 0x8 , nt35596_1080p_video_on_cmd259},
+{ 0x8 , nt35596_1080p_video_on_cmd260},
+{ 0x8 , nt35596_1080p_video_on_cmd261},
+{ 0x8 , nt35596_1080p_video_on_cmd262},
+{ 0x8 , nt35596_1080p_video_on_cmd263},
+{ 0x8 , nt35596_1080p_video_on_cmd264},
+{ 0x8 , nt35596_1080p_video_on_cmd265},
+{ 0x8 , nt35596_1080p_video_on_cmd266},
+{ 0x8 , nt35596_1080p_video_on_cmd267},
+{ 0x8 , nt35596_1080p_video_on_cmd268},
+{ 0x8 , nt35596_1080p_video_on_cmd269},
+{ 0x8 , nt35596_1080p_video_on_cmd270},
+{ 0x8 , nt35596_1080p_video_on_cmd271},
+{ 0x8 , nt35596_1080p_video_on_cmd272},
+{ 0x8 , nt35596_1080p_video_on_cmd273},
+{ 0x8 , nt35596_1080p_video_on_cmd274},
+{ 0x8 , nt35596_1080p_video_on_cmd275},
+{ 0x8 , nt35596_1080p_video_on_cmd276},
+{ 0x8 , nt35596_1080p_video_on_cmd277},
+{ 0x8 , nt35596_1080p_video_on_cmd278},
+{ 0x8 , nt35596_1080p_video_on_cmd279},
+{ 0x8 , nt35596_1080p_video_on_cmd280},
+{ 0x8 , nt35596_1080p_video_on_cmd281},
+{ 0x8 , nt35596_1080p_video_on_cmd282},
+{ 0x8 , nt35596_1080p_video_on_cmd283},
+{ 0x8 , nt35596_1080p_video_on_cmd284},
+{ 0x8 , nt35596_1080p_video_on_cmd285},
+{ 0x8 , nt35596_1080p_video_on_cmd286},
+{ 0x8 , nt35596_1080p_video_on_cmd287},
+{ 0x8 , nt35596_1080p_video_on_cmd288},
+{ 0x8 , nt35596_1080p_video_on_cmd289},
+{ 0x8 , nt35596_1080p_video_on_cmd290},
+{ 0x8 , nt35596_1080p_video_on_cmd291},
+{ 0x8 , nt35596_1080p_video_on_cmd292},
+{ 0x8 , nt35596_1080p_video_on_cmd293},
+{ 0x8 , nt35596_1080p_video_on_cmd294},
+{ 0x8 , nt35596_1080p_video_on_cmd295},
+{ 0x8 , nt35596_1080p_video_on_cmd296},
+{ 0x8 , nt35596_1080p_video_on_cmd297},
+{ 0x8 , nt35596_1080p_video_on_cmd298},
+{ 0x8 , nt35596_1080p_video_on_cmd299},
+{ 0x8 , nt35596_1080p_video_on_cmd300},
+{ 0x8 , nt35596_1080p_video_on_cmd301},
+{ 0x8 , nt35596_1080p_video_on_cmd302},
+{ 0x8 , nt35596_1080p_video_on_cmd303},
+{ 0x8 , nt35596_1080p_video_on_cmd304},
+{ 0x8 , nt35596_1080p_video_on_cmd305},
+{ 0x8 , nt35596_1080p_video_on_cmd306},
+{ 0x8 , nt35596_1080p_video_on_cmd307},
+{ 0x8 , nt35596_1080p_video_on_cmd308},
+{ 0x8 , nt35596_1080p_video_on_cmd309},
+{ 0x8 , nt35596_1080p_video_on_cmd310},
+{ 0x8 , nt35596_1080p_video_on_cmd311},
+{ 0x8 , nt35596_1080p_video_on_cmd312},
+{ 0x8 , nt35596_1080p_video_on_cmd313},
+{ 0x8 , nt35596_1080p_video_on_cmd314},
+{ 0x8 , nt35596_1080p_video_on_cmd315},
+{ 0x8 , nt35596_1080p_video_on_cmd316},
+{ 0x8 , nt35596_1080p_video_on_cmd317},
+{ 0x8 , nt35596_1080p_video_on_cmd318},
+{ 0x8 , nt35596_1080p_video_on_cmd319},
+{ 0x8 , nt35596_1080p_video_on_cmd320},
+{ 0x8 , nt35596_1080p_video_on_cmd321},
+{ 0x8 , nt35596_1080p_video_on_cmd322},
+{ 0x8 , nt35596_1080p_video_on_cmd323},
+{ 0x8 , nt35596_1080p_video_on_cmd324},
+{ 0x8 , nt35596_1080p_video_on_cmd325},
+{ 0x8 , nt35596_1080p_video_on_cmd326},
+{ 0x8 , nt35596_1080p_video_on_cmd327},
+{ 0x8 , nt35596_1080p_video_on_cmd328},
+{ 0x8 , nt35596_1080p_video_on_cmd329},
+{ 0x8 , nt35596_1080p_video_on_cmd330},
+{ 0x8 , nt35596_1080p_video_on_cmd331},
+{ 0x8 , nt35596_1080p_video_on_cmd332},
+{ 0x8 , nt35596_1080p_video_on_cmd333},
+{ 0x8 , nt35596_1080p_video_on_cmd334},
+{ 0x8 , nt35596_1080p_video_on_cmd335},
+{ 0x8 , nt35596_1080p_video_on_cmd336},
+{ 0x8 , nt35596_1080p_video_on_cmd337},
+{ 0x8 , nt35596_1080p_video_on_cmd338},
+{ 0x8 , nt35596_1080p_video_on_cmd339},
+{ 0x8 , nt35596_1080p_video_on_cmd340},
+{ 0x8 , nt35596_1080p_video_on_cmd341},
+{ 0x8 , nt35596_1080p_video_on_cmd342},
+{ 0x8 , nt35596_1080p_video_on_cmd343},
+{ 0x8 , nt35596_1080p_video_on_cmd344},
+{ 0x8 , nt35596_1080p_video_on_cmd345},
+{ 0x8 , nt35596_1080p_video_on_cmd346},
+{ 0x8 , nt35596_1080p_video_on_cmd347},
+{ 0x8 , nt35596_1080p_video_on_cmd348},
+{ 0x8 , nt35596_1080p_video_on_cmd349},
+{ 0x8 , nt35596_1080p_video_on_cmd350},
+{ 0x8 , nt35596_1080p_video_on_cmd351},
+{ 0x8 , nt35596_1080p_video_on_cmd352},
+{ 0x8 , nt35596_1080p_video_on_cmd353},
+{ 0x8 , nt35596_1080p_video_on_cmd354},
+{ 0x8 , nt35596_1080p_video_on_cmd355},
+{ 0x8 , nt35596_1080p_video_on_cmd356},
+{ 0x8 , nt35596_1080p_video_on_cmd357},
+{ 0x8 , nt35596_1080p_video_on_cmd358},
+{ 0x8 , nt35596_1080p_video_on_cmd359},
+{ 0x8 , nt35596_1080p_video_on_cmd360},
+{ 0x8 , nt35596_1080p_video_on_cmd361},
+{ 0x8 , nt35596_1080p_video_on_cmd362},
+{ 0x8 , nt35596_1080p_video_on_cmd363},
+{ 0x8 , nt35596_1080p_video_on_cmd364},
+{ 0x8 , nt35596_1080p_video_on_cmd365},
+{ 0x8 , nt35596_1080p_video_on_cmd366},
+{ 0x8 , nt35596_1080p_video_on_cmd367},
+{ 0x8 , nt35596_1080p_video_on_cmd368},
+{ 0x8 , nt35596_1080p_video_on_cmd369},
+{ 0x8 , nt35596_1080p_video_on_cmd370},
+{ 0x8 , nt35596_1080p_video_on_cmd371},
+{ 0x8 , nt35596_1080p_video_on_cmd372},
+{ 0x8 , nt35596_1080p_video_on_cmd373},
+{ 0x8 , nt35596_1080p_video_on_cmd374},
+{ 0x8 , nt35596_1080p_video_on_cmd375},
+{ 0x8 , nt35596_1080p_video_on_cmd376},
+{ 0x8 , nt35596_1080p_video_on_cmd377},
+{ 0x8 , nt35596_1080p_video_on_cmd378},
+{ 0x8 , nt35596_1080p_video_on_cmd379},
+{ 0x8 , nt35596_1080p_video_on_cmd380},
+{ 0x8 , nt35596_1080p_video_on_cmd381},
+{ 0x8 , nt35596_1080p_video_on_cmd382},
+{ 0x8 , nt35596_1080p_video_on_cmd383},
+{ 0x8 , nt35596_1080p_video_on_cmd384},
+{ 0x8 , nt35596_1080p_video_on_cmd385},
+{ 0x8 , nt35596_1080p_video_on_cmd386},
+{ 0x8 , nt35596_1080p_video_on_cmd387},
+{ 0x8 , nt35596_1080p_video_on_cmd388},
+{ 0x8 , nt35596_1080p_video_on_cmd389},
+{ 0x8 , nt35596_1080p_video_on_cmd390},
+{ 0x8 , nt35596_1080p_video_on_cmd391},
+{ 0x8 , nt35596_1080p_video_on_cmd392},
+{ 0x8 , nt35596_1080p_video_on_cmd393},
+{ 0x8 , nt35596_1080p_video_on_cmd394},
+{ 0x8 , nt35596_1080p_video_on_cmd395},
+{ 0x8 , nt35596_1080p_video_on_cmd396},
+{ 0x8 , nt35596_1080p_video_on_cmd397},
+{ 0x8 , nt35596_1080p_video_on_cmd398},
+{ 0x8 , nt35596_1080p_video_on_cmd399},
+{ 0x8 , nt35596_1080p_video_on_cmd400},
+{ 0x8 , nt35596_1080p_video_on_cmd401},
+{ 0x8 , nt35596_1080p_video_on_cmd402},
+{ 0x8 , nt35596_1080p_video_on_cmd403},
+{ 0x8 , nt35596_1080p_video_on_cmd404},
+{ 0x8 , nt35596_1080p_video_on_cmd405},
+{ 0x8 , nt35596_1080p_video_on_cmd406},
+{ 0x8 , nt35596_1080p_video_on_cmd407},
+{ 0x8 , nt35596_1080p_video_on_cmd408},
+{ 0x8 , nt35596_1080p_video_on_cmd409},
+{ 0x8 , nt35596_1080p_video_on_cmd410},
+{ 0x8 , nt35596_1080p_video_on_cmd411},
+{ 0x8 , nt35596_1080p_video_on_cmd412},
+{ 0x8 , nt35596_1080p_video_on_cmd413},
+{ 0x8 , nt35596_1080p_video_on_cmd414},
+{ 0x8 , nt35596_1080p_video_on_cmd415},
+{ 0x8 , nt35596_1080p_video_on_cmd416},
+{ 0x8 , nt35596_1080p_video_on_cmd417},
+{ 0x8 , nt35596_1080p_video_on_cmd418},
+{ 0x8 , nt35596_1080p_video_on_cmd419},
+{ 0x8 , nt35596_1080p_video_on_cmd420},
+{ 0x8 , nt35596_1080p_video_on_cmd421},
+{ 0x8 , nt35596_1080p_video_on_cmd422},
+{ 0x8 , nt35596_1080p_video_on_cmd423},
+{ 0x8 , nt35596_1080p_video_on_cmd424},
+{ 0x8 , nt35596_1080p_video_on_cmd425},
+{ 0x8 , nt35596_1080p_video_on_cmd426},
+{ 0x8 , nt35596_1080p_video_on_cmd427},
+{ 0x8 , nt35596_1080p_video_on_cmd428},
+{ 0x8 , nt35596_1080p_video_on_cmd429},
+{ 0x8 , nt35596_1080p_video_on_cmd430},
+{ 0x8 , nt35596_1080p_video_on_cmd431},
+{ 0x8 , nt35596_1080p_video_on_cmd432},
+{ 0x8 , nt35596_1080p_video_on_cmd433},
+{ 0x8 , nt35596_1080p_video_on_cmd434},
+{ 0x8 , nt35596_1080p_video_on_cmd435},
+{ 0x8 , nt35596_1080p_video_on_cmd436},
+{ 0x8 , nt35596_1080p_video_on_cmd437},
+{ 0x8 , nt35596_1080p_video_on_cmd438},
+{ 0x8 , nt35596_1080p_video_on_cmd439},
+{ 0x8 , nt35596_1080p_video_on_cmd440},
+{ 0x8 , nt35596_1080p_video_on_cmd441},
+{ 0x8 , nt35596_1080p_video_on_cmd442},
+{ 0x8 , nt35596_1080p_video_on_cmd443},
+{ 0x8 , nt35596_1080p_video_on_cmd444},
+{ 0x8 , nt35596_1080p_video_on_cmd445},
+{ 0x8 , nt35596_1080p_video_on_cmd446},
+{ 0x8 , nt35596_1080p_video_on_cmd447},
+{ 0x8 , nt35596_1080p_video_on_cmd448},
+{ 0x8 , nt35596_1080p_video_on_cmd449},
+{ 0x8 , nt35596_1080p_video_on_cmd450},
+{ 0x8 , nt35596_1080p_video_on_cmd451},
+{ 0x8 , nt35596_1080p_video_on_cmd452},
+{ 0x8 , nt35596_1080p_video_on_cmd453},
+{ 0x8 , nt35596_1080p_video_on_cmd454},
+{ 0x8 , nt35596_1080p_video_on_cmd455},
+{ 0x8 , nt35596_1080p_video_on_cmd456},
+{ 0x8 , nt35596_1080p_video_on_cmd457},
+{ 0x8 , nt35596_1080p_video_on_cmd458},
+{ 0x8 , nt35596_1080p_video_on_cmd459},
+{ 0x8 , nt35596_1080p_video_on_cmd460},
+{ 0x8 , nt35596_1080p_video_on_cmd461},
+{ 0x8 , nt35596_1080p_video_on_cmd462},
+{ 0x8 , nt35596_1080p_video_on_cmd463},
+{ 0x8 , nt35596_1080p_video_on_cmd464},
+{ 0x8 , nt35596_1080p_video_on_cmd465},
+{ 0x8 , nt35596_1080p_video_on_cmd466},
+{ 0x8 , nt35596_1080p_video_on_cmd467},
+{ 0x8 , nt35596_1080p_video_on_cmd468},
+{ 0x8 , nt35596_1080p_video_on_cmd469},
+{ 0x8 , nt35596_1080p_video_on_cmd470},
+{ 0x8 , nt35596_1080p_video_on_cmd471},
+{ 0x8 , nt35596_1080p_video_on_cmd472},
+{ 0x8 , nt35596_1080p_video_on_cmd473},
+{ 0x8 , nt35596_1080p_video_on_cmd474},
+{ 0x8 , nt35596_1080p_video_on_cmd475},
+{ 0x8 , nt35596_1080p_video_on_cmd476},
+{ 0x8 , nt35596_1080p_video_on_cmd477},
+{ 0x8 , nt35596_1080p_video_on_cmd478},
+{ 0x8 , nt35596_1080p_video_on_cmd479},
+{ 0x8 , nt35596_1080p_video_on_cmd480},
+{ 0x8 , nt35596_1080p_video_on_cmd481},
+{ 0x8 , nt35596_1080p_video_on_cmd482},
+{ 0x8 , nt35596_1080p_video_on_cmd483},
+{ 0x8 , nt35596_1080p_video_on_cmd484},
+{ 0x8 , nt35596_1080p_video_on_cmd485},
+{ 0x8 , nt35596_1080p_video_on_cmd486},
+{ 0x8 , nt35596_1080p_video_on_cmd487},
+{ 0x8 , nt35596_1080p_video_on_cmd488},
+{ 0x8 , nt35596_1080p_video_on_cmd489},
+{ 0x8 , nt35596_1080p_video_on_cmd490},
+{ 0x8 , nt35596_1080p_video_on_cmd491},
+{ 0x8 , nt35596_1080p_video_on_cmd492},
+{ 0x8 , nt35596_1080p_video_on_cmd493},
+{ 0x8 , nt35596_1080p_video_on_cmd494},
+{ 0x8 , nt35596_1080p_video_on_cmd495},
+{ 0x8 , nt35596_1080p_video_on_cmd496},
+{ 0x8 , nt35596_1080p_video_on_cmd497},
+{ 0x8 , nt35596_1080p_video_on_cmd498},
+{ 0x8 , nt35596_1080p_video_on_cmd499},
+{ 0x8 , nt35596_1080p_video_on_cmd500},
+{ 0x8 , nt35596_1080p_video_on_cmd501},
+{ 0x8 , nt35596_1080p_video_on_cmd502},
+{ 0x8 , nt35596_1080p_video_on_cmd503},
+{ 0x8 , nt35596_1080p_video_on_cmd504},
+{ 0x8 , nt35596_1080p_video_on_cmd505},
+{ 0x8 , nt35596_1080p_video_on_cmd506},
+{ 0x8 , nt35596_1080p_video_on_cmd507},
+{ 0x8 , nt35596_1080p_video_on_cmd508},
+{ 0x8 , nt35596_1080p_video_on_cmd509},
+{ 0x8 , nt35596_1080p_video_on_cmd510},
+{ 0x8 , nt35596_1080p_video_on_cmd511},
+{ 0x8 , nt35596_1080p_video_on_cmd512},
+{ 0x8 , nt35596_1080p_video_on_cmd513},
+{ 0x8 , nt35596_1080p_video_on_cmd514},
+{ 0x8 , nt35596_1080p_video_on_cmd515},
+{ 0x8 , nt35596_1080p_video_on_cmd516},
+{ 0x8 , nt35596_1080p_video_on_cmd517},
+{ 0x8 , nt35596_1080p_video_on_cmd518},
+{ 0x8 , nt35596_1080p_video_on_cmd519}
+};
+#define NT35596_1080P_VIDEO_ON_COMMAND 520
+
+
+static char nt35596_1080p_videooff_cmd0[] = {
+0x28, 0x00, 0x05, 0x80 };
+
+
+static char nt35596_1080p_videooff_cmd1[] = {
+0x10, 0x00, 0x05, 0x80 };
+
+
+
+
+static struct mipi_dsi_cmd nt35596_1080p_video_off_command[] = {
+{ 0x4 , nt35596_1080p_videooff_cmd0},
+{ 0x4 , nt35596_1080p_videooff_cmd1}
+};
+#define NT35596_1080P_VIDEO_OFF_COMMAND 2
+
+
+static struct command_state nt35596_1080p_video_state = {
+  0, 1
+};
+
+/*---------------------------------------------------------------------------*/
+/* Command mode panel information                                            */
+/*---------------------------------------------------------------------------*/
+
+static struct commandpanel_info nt35596_1080p_video_command_panel = {
+  0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Video mode panel information                                              */
+/*---------------------------------------------------------------------------*/
+
+static struct videopanel_info nt35596_1080p_video_video_panel = {
+  1, 0, 0, 0, 1, 1, 2, 0, 0x9
+};
+
+/*---------------------------------------------------------------------------*/
+/* Lane Configuration                                                        */
+/*---------------------------------------------------------------------------*/
+
+static struct lane_configuration nt35596_1080p_video_lane_config = {
+  4, 0, 1, 1, 1, 1
+};
+
+
+/*---------------------------------------------------------------------------*/
+/* Panel Timing                                                              */
+/*---------------------------------------------------------------------------*/
+const uint32_t nt35596_1080p_video_timings[] = {
+  0xf9, 0x3d, 0x34, 0x00, 0x58, 0x4d, 0x36, 0x3f, 0x53, 0x03, 0x04, 0x00
+};
+
+static struct panel_timing nt35596_1080p_video_timing_info = {
+  0, 4, 0x1e, 0x38
+};
+
+/*---------------------------------------------------------------------------*/
+/* Backlight Settings                                                        */
+/*---------------------------------------------------------------------------*/
+
+static struct backlight nt35596_1080p_video_backlight = {
+  1, 1, 4095, 100, 1, "PMIC_8941"
+};
+
+
+#endif /*_PANEL_NT35596_1080P_VIDEO_H_*/
diff --git a/dev/gcdb/display/include/panel_toshiba_720p_video.h b/dev/gcdb/display/include/panel_toshiba_720p_video.h
new file mode 100755
index 0000000..8f3cd68
--- /dev/null
+++ b/dev/gcdb/display/include/panel_toshiba_720p_video.h
@@ -0,0 +1,344 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+/*---------------------------------------------------------------------------
+ * This file is autogenerated file using gcdb parser. Please do not edit it.
+ * Update input XML file to add a new entry or update variable in this file
+ * VERSION = "1.0"
+ *---------------------------------------------------------------------------*/
+
+#ifndef _PANEL_TOSHIBA_720P_VIDEO_H_
+
+#define _PANEL_TOSHIBA_720P_VIDEO_H_
+/*---------------------------------------------------------------------------*/
+/* HEADER files                                                              */
+/*---------------------------------------------------------------------------*/
+#include "panel.h"
+
+/*---------------------------------------------------------------------------*/
+/* Panel configuration                                                       */
+/*---------------------------------------------------------------------------*/
+
+static struct panel_config toshiba_720p_video_panel_data = {
+  "toshiba 720p video mode dsi panel", "mdss_dsi0", "qcom,mdss-dsi-panel",
+  10, 0, "DISPLAY_1", 0, 424000000, 60, 0, 0, 0, 0, 0, 0, 0, 0, 0, 1
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel resolution                                                          */
+/*---------------------------------------------------------------------------*/
+static struct panel_resolution toshiba_720p_video_panel_res = {
+  720, 1280, 144, 32, 12, 0, 9, 3, 4, 0, 0, 0, 0, 0, 0, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel Color Information                                                   */
+/*---------------------------------------------------------------------------*/
+static struct color_info toshiba_720p_video_color = {
+  24, 0, 0xff, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Panel Command information                                                 */
+/*---------------------------------------------------------------------------*/
+static char toshiba_720p_video_on_cmd0[] = {
+0xb0, 0x00, 0x23, 0x80 };
+
+
+static char toshiba_720p_video_on_cmd1[] = {
+0xb2, 0x00, 0x23, 0x80 };
+
+
+static char toshiba_720p_video_on_cmd2[] = {
+0xb3, 0x0c, 0x23, 0x80 };
+
+
+static char toshiba_720p_video_on_cmd3[] = {
+0xb4, 0x02, 0x23, 0x80 };
+
+
+static char toshiba_720p_video_on_cmd4[] = {
+0x06, 0x00, 0x29, 0xC0,
+0xc0, 0x40, 0x02, 0x7f,
+0xc8, 0x08, 0xFF, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd5[] = {
+0x10, 0x00, 0x29, 0xC0,
+0xc1, 0x00, 0xa8, 0x00,
+0x00, 0x00, 0x00, 0x00,
+0x9d, 0x08, 0x27, 0x00,
+0x00, 0x00, 0x00, 0x00,
+ };
+
+
+static char toshiba_720p_video_on_cmd6[] = {
+0x06, 0x00, 0x29, 0xC0,
+0xc2, 0x00, 0x00, 0x09,
+0x00, 0x00, 0xFF, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd7[] = {
+0xc3, 0x04, 0x23, 0x80 };
+
+
+static char toshiba_720p_video_on_cmd8[] = {
+0x04, 0x00, 0x29, 0xC0,
+0xc4, 0x4d, 0x83, 0x00,
+ };
+
+
+static char toshiba_720p_video_on_cmd9[] = {
+0x0b, 0x00, 0x29, 0xC0,
+0xc6, 0x12, 0x00, 0x08,
+0x71, 0x00, 0x00, 0x00,
+0x80, 0x00, 0x04, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd10[] = {
+0xc7, 0x22, 0x23, 0x80 };
+
+
+static char toshiba_720p_video_on_cmd11[] = {
+0x05, 0x00, 0x29, 0xC0,
+0xc8, 0x4c, 0x0c, 0x0c,
+0x0c, 0xFF, 0xFF, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd12[] = {
+0x0e, 0x00, 0x29, 0xC0,
+0xc9, 0x00, 0x40, 0x00,
+0x16, 0x32, 0x2e, 0x3a,
+0x43, 0x3e, 0x3c, 0x45,
+0x79, 0x3f, 0xFF, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd13[] = {
+0x0e, 0x00, 0x29, 0xC0,
+0xca, 0x00, 0x46, 0x1a,
+0x23, 0x21, 0x1c, 0x25,
+0x31, 0x2d, 0x49, 0x5f,
+0x7f, 0x3f, 0xFF, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd14[] = {
+0x0e, 0x00, 0x29, 0xC0,
+0xcb, 0x00, 0x4c, 0x20,
+0x3a, 0x42, 0x40, 0x47,
+0x4b, 0x42, 0x3e, 0x46,
+0x7e, 0x3f, 0xFF, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd15[] = {
+0x0e, 0x00, 0x29, 0xC0,
+0xcc, 0x00, 0x41, 0x19,
+0x21, 0x1d, 0x14, 0x18,
+0x1f, 0x1d, 0x25, 0x3f,
+0x73, 0x3f, 0xFF, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd16[] = {
+0x0e, 0x00, 0x29, 0xC0,
+0xcd, 0x23, 0x79, 0x5a,
+0x5f, 0x57, 0x4c, 0x51,
+0x51, 0x45, 0x3f, 0x4b,
+0x7f, 0x3f, 0xFF, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd17[] = {
+0x0e, 0x00, 0x29, 0xC0,
+0xce, 0x00, 0x40, 0x14,
+0x20, 0x1a, 0x0e, 0x0e,
+0x13, 0x08, 0x00, 0x05,
+0x46, 0x1c, 0xFF, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd18[] = {
+0x04, 0x00, 0x29, 0xC0,
+0xd0, 0x6a, 0x64, 0x01,
+ };
+
+
+static char toshiba_720p_video_on_cmd19[] = {
+0x03, 0x00, 0x29, 0xC0,
+0xd1, 0x77, 0xd4, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd20[] = {
+0xd3, 0x33, 0x23, 0x80 };
+
+
+static char toshiba_720p_video_on_cmd21[] = {
+0x03, 0x00, 0x29, 0xC0,
+0xd5, 0x0f, 0x0f, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd22[] = {
+0x07, 0x00, 0x29, 0xC0,
+0xd8, 0x34, 0x64, 0x23,
+0x25, 0x62, 0x32, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd23[] = {
+0x0c, 0x00, 0x29, 0xC0,
+0xde, 0x10, 0x7b, 0x11,
+0x0a, 0x00, 0x00, 0x00,
+0x00, 0x00, 0x00, 0x00,
+ };
+
+
+static char toshiba_720p_video_on_cmd24[] = {
+0x09, 0x00, 0x29, 0xC0,
+0xfd, 0x04, 0x55, 0x53,
+0x00, 0x70, 0xff, 0x10,
+0x73, 0xFF, 0xFF, 0xFF,  };
+
+
+static char toshiba_720p_video_on_cmd25[] = {
+0xe2, 0x00, 0x23, 0x80 };
+
+
+static char toshiba_720p_video_on_cmd26[] = {
+0x11, 0x00, 0x05, 0x80 };
+
+
+static char toshiba_720p_video_on_cmd27[] = {
+0x29, 0x00, 0x05, 0x80 };
+
+
+
+
+static struct mipi_dsi_cmd toshiba_720p_video_on_command[] = {
+{ 0x4 , toshiba_720p_video_on_cmd0},
+{ 0x4 , toshiba_720p_video_on_cmd1},
+{ 0x4 , toshiba_720p_video_on_cmd2},
+{ 0x4 , toshiba_720p_video_on_cmd3},
+{ 0xc , toshiba_720p_video_on_cmd4},
+{ 0x14 , toshiba_720p_video_on_cmd5},
+{ 0xc , toshiba_720p_video_on_cmd6},
+{ 0x4 , toshiba_720p_video_on_cmd7},
+{ 0x8 , toshiba_720p_video_on_cmd8},
+{ 0x10 , toshiba_720p_video_on_cmd9},
+{ 0x4 , toshiba_720p_video_on_cmd10},
+{ 0xc , toshiba_720p_video_on_cmd11},
+{ 0x14 , toshiba_720p_video_on_cmd12},
+{ 0x14 , toshiba_720p_video_on_cmd13},
+{ 0x14 , toshiba_720p_video_on_cmd14},
+{ 0x14 , toshiba_720p_video_on_cmd15},
+{ 0x14 , toshiba_720p_video_on_cmd16},
+{ 0x14 , toshiba_720p_video_on_cmd17},
+{ 0x8 , toshiba_720p_video_on_cmd18},
+{ 0x8 , toshiba_720p_video_on_cmd19},
+{ 0x4 , toshiba_720p_video_on_cmd20},
+{ 0x8 , toshiba_720p_video_on_cmd21},
+{ 0xc , toshiba_720p_video_on_cmd22},
+{ 0x10 , toshiba_720p_video_on_cmd23},
+{ 0x10 , toshiba_720p_video_on_cmd24},
+{ 0x4 , toshiba_720p_video_on_cmd25},
+{ 0x4 , toshiba_720p_video_on_cmd26},
+{ 0x4 , toshiba_720p_video_on_cmd27}
+};
+#define TOSHIBA_720P_VIDEO_ON_COMMAND 28
+
+
+static char toshiba_720p_videooff_cmd0[] = {
+0x28, 0x00, 0x05, 0x80 };
+
+
+static char toshiba_720p_videooff_cmd1[] = {
+0x10, 0x00, 0x05, 0x80 };
+
+
+
+
+static struct mipi_dsi_cmd toshiba_720p_video_off_command[] = {
+{ 0x4 , toshiba_720p_videooff_cmd0},
+{ 0x4 , toshiba_720p_videooff_cmd1}
+};
+#define TOSHIBA_720P_VIDEO_OFF_COMMAND 2
+
+
+static struct command_state toshiba_720p_video_state = {
+  0, 1
+};
+
+/*---------------------------------------------------------------------------*/
+/* Command mode panel information                                            */
+/*---------------------------------------------------------------------------*/
+
+static struct commandpanel_info toshiba_720p_video_command_panel = {
+  0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0, 0
+};
+
+/*---------------------------------------------------------------------------*/
+/* Video mode panel information                                              */
+/*---------------------------------------------------------------------------*/
+
+static struct videopanel_info toshiba_720p_video_video_panel = {
+  0, 0, 0, 0, 1, 1, 1, 0, 0x9
+};
+
+/*---------------------------------------------------------------------------*/
+/* Lane Configuration                                                        */
+/*---------------------------------------------------------------------------*/
+
+static struct lane_configuration toshiba_720p_video_lane_config = {
+  4, 0, 1, 1, 1, 1
+};
+
+
+/*---------------------------------------------------------------------------*/
+/* Panel Timing                                                              */
+/*---------------------------------------------------------------------------*/
+const uint32_t toshiba_720p_video_timings[] = {
+  0xb0, 0x23, 0x1b, 0x00, 0x94, 0x93, 0x1e, 0x25,  0x15, 0x03, 0x04, 0x00
+};
+
+
+
+static struct mipi_dsi_cmd toshiba_720p_video_rotation[] = {
+
+};
+#define TOSHIBA_720P_VIDEO_ROTATION 0
+
+
+static struct panel_timing toshiba_720p_video_timing_info = {
+  0x0, 0x04, 0x04, 0x1b
+};
+
+/*---------------------------------------------------------------------------*/
+/* Backlight Settings                                                        */
+/*---------------------------------------------------------------------------*/
+
+static struct backlight toshiba_720p_video_backlight = {
+  1, 1, 4095, 100, 1, "PMIC_8941"
+};
+
+
+#endif /*_PANEL_TOSHIBA_720P_VIDEO_H_*/
diff --git a/dev/gcdb/display/oem_panel.c b/dev/gcdb/display/oem_panel.c
new file mode 100755
index 0000000..bacea0f
--- /dev/null
+++ b/dev/gcdb/display/oem_panel.c
@@ -0,0 +1,216 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+#include <debug.h>
+#include <err.h>
+#include <smem.h>
+#include <msm_panel.h>
+#include <board.h>
+#include <mipi_dsi.h>
+
+#include "include/panel.h"
+#include "panel_display.h"
+
+/*---------------------------------------------------------------------------*/
+/* GCDB Panel Database                                                       */
+/*---------------------------------------------------------------------------*/
+#include "include/panel_toshiba_720p_video.h"
+#include "include/panel_nt35590_720p_video.h"
+#include "include/panel_nt35590_720p_cmd.h"
+#include "include/panel_nt35596_1080p_video.h"
+
+/*---------------------------------------------------------------------------*/
+/* static panel selection variable                                           */
+/*---------------------------------------------------------------------------*/
+enum {
+TOSHIBA_720P_VIDEO_PANEL,
+NT35590_720P_CMD_PANEL,
+NT35590_720P_VIDEO_PANEL,
+NT35596_1080P_VIDEO_PANEL
+};
+
+static uint32_t panel_id;
+
+int oem_panel_rotation()
+{
+	int ret = NO_ERROR;
+	switch (panel_id) {
+	case TOSHIBA_720P_VIDEO_PANEL:
+		ret = mipi_dsi_cmds_tx(toshiba_720p_video_rotation,
+				TOSHIBA_720P_VIDEO_ROTATION);
+		break;
+	case NT35590_720P_CMD_PANEL:
+		ret = mipi_dsi_cmds_tx(nt35590_720p_cmd_rotation,
+				NT35590_720P_CMD_ROTATION);
+		break;
+	case NT35590_720P_VIDEO_PANEL:
+		ret = mipi_dsi_cmds_tx(nt35590_720p_video_rotation,
+				NT35590_720P_VIDEO_ROTATION);
+		break;
+	}
+
+	return ret;
+}
+
+
+int oem_panel_on()
+{
+	/* OEM can keep there panel spefic on instructions in this
+	function */
+	return NO_ERROR;
+}
+
+int oem_panel_off()
+{
+	/* OEM can keep there panel spefic off instructions in this
+	function */
+	return NO_ERROR;
+}
+
+static void init_panel_data(struct panel_struct *panelstruct,
+			struct msm_panel_info *pinfo,
+			struct mdss_dsi_phy_ctrl *phy_db)
+{
+	switch (panel_id) {
+	case TOSHIBA_720P_VIDEO_PANEL:
+		panelstruct->paneldata    = &toshiba_720p_video_panel_data;
+		panelstruct->panelres     = &toshiba_720p_video_panel_res;
+		panelstruct->color        = &toshiba_720p_video_color;
+		panelstruct->videopanel   = &toshiba_720p_video_video_panel;
+		panelstruct->commandpanel = &toshiba_720p_video_command_panel;
+		panelstruct->state        = &toshiba_720p_video_state;
+		panelstruct->laneconfig   = &toshiba_720p_video_lane_config;
+		panelstruct->paneltiminginfo
+					 = &toshiba_720p_video_timing_info;
+		panelstruct->backlightinfo = &toshiba_720p_video_backlight;
+		pinfo->mipi.panel_cmds
+					= toshiba_720p_video_on_command;
+		pinfo->mipi.num_of_panel_cmds
+					= TOSHIBA_720P_VIDEO_ON_COMMAND;
+		memcpy(phy_db->timing,
+			toshiba_720p_video_timings, TIMING_SIZE);
+		break;
+	case NT35590_720P_VIDEO_PANEL:
+		panelstruct->paneldata    = &nt35590_720p_video_panel_data;
+		panelstruct->panelres     = &nt35590_720p_video_panel_res;
+		panelstruct->color        = &nt35590_720p_video_color;
+		panelstruct->videopanel   = &nt35590_720p_video_video_panel;
+		panelstruct->commandpanel = &nt35590_720p_video_command_panel;
+		panelstruct->state        = &nt35590_720p_video_state;
+		panelstruct->laneconfig   = &nt35590_720p_video_lane_config;
+		panelstruct->paneltiminginfo
+					 = &nt35590_720p_video_timing_info;
+		panelstruct->backlightinfo = &nt35590_720p_video_backlight;
+		pinfo->mipi.panel_cmds
+					= nt35590_720p_video_on_command;
+		pinfo->mipi.num_of_panel_cmds
+					= NT35590_720P_VIDEO_ON_COMMAND;
+		memcpy(phy_db->timing,
+				nt35590_720p_video_timings, TIMING_SIZE);
+		break;
+	case NT35590_720P_CMD_PANEL:
+		panelstruct->paneldata    = &nt35590_720p_cmd_panel_data;
+		panelstruct->panelres     = &nt35590_720p_cmd_panel_res;
+		panelstruct->color        = &nt35590_720p_cmd_color;
+		panelstruct->videopanel   = &nt35590_720p_cmd_video_panel;
+		panelstruct->commandpanel = &nt35590_720p_cmd_command_panel;
+		panelstruct->state        = &nt35590_720p_cmd_state;
+		panelstruct->laneconfig   = &nt35590_720p_cmd_lane_config;
+		panelstruct->paneltiminginfo = &nt35590_720p_cmd_timing_info;
+		panelstruct->backlightinfo = &nt35590_720p_cmd_backlight;
+		pinfo->mipi.panel_cmds
+					= nt35590_720p_cmd_on_command;
+		pinfo->mipi.num_of_panel_cmds
+					= NT35590_720P_CMD_ON_COMMAND;
+		memcpy(phy_db->timing,
+				nt35590_720p_cmd_timings, TIMING_SIZE);
+		break;
+	case NT35596_1080P_VIDEO_PANEL:
+		panelstruct->paneldata    = &nt35596_1080p_video_panel_data;
+		panelstruct->panelres     = &nt35596_1080p_video_panel_res;
+		panelstruct->color        = &nt35596_1080p_video_color;
+		panelstruct->videopanel   = &nt35596_1080p_video_video_panel;
+		panelstruct->commandpanel = &nt35596_1080p_video_command_panel;
+		panelstruct->state        = &nt35596_1080p_video_state;
+		panelstruct->laneconfig   = &nt35596_1080p_video_lane_config;
+		panelstruct->paneltiminginfo
+					= &nt35596_1080p_video_timing_info;
+		panelstruct->backlightinfo
+					= &nt35596_1080p_video_backlight;
+		pinfo->mipi.panel_cmds
+					= nt35596_1080p_video_on_command;
+		pinfo->mipi.num_of_panel_cmds
+					= NT35596_1080P_VIDEO_ON_COMMAND;
+		memcpy(phy_db->timing,
+				nt35596_1080p_video_timings, TIMING_SIZE);
+		break;
+	}
+}
+
+bool oem_panel_select(struct panel_struct *panelstruct,
+			struct msm_panel_info *pinfo,
+			struct mdss_dsi_phy_ctrl *phy_db)
+{
+	uint32_t hw_id = board_hardware_id();
+	uint32_t platformid = board_platform_id();
+
+	switch (platformid) {
+	case MSM8974:
+		switch (hw_id) {
+		case HW_PLATFORM_FLUID:
+		case HW_PLATFORM_MTP:
+		case HW_PLATFORM_SURF:
+			panel_id = TOSHIBA_720P_VIDEO_PANEL;
+			break;
+		default:
+			dprintf(CRITICAL, "Display not enabled for %d HW type\n"
+						, hw_id);
+			return false;
+		}
+		break;
+	case MSM8226:
+	case MSM8626:
+		switch (hw_id) {
+		case HW_PLATFORM_QRD:
+		case HW_PLATFORM_MTP:
+		case HW_PLATFORM_SURF:
+			panel_id = NT35590_720P_VIDEO_PANEL;
+			break;
+		default:
+			dprintf(CRITICAL, "Display not enabled for %d HW type\n"
+						, hw_id);
+			return false;
+		}
+		break;
+	}
+
+	init_panel_data(panelstruct, pinfo, phy_db);
+
+	return true;
+}
diff --git a/dev/gcdb/display/panel_display.c b/dev/gcdb/display/panel_display.c
new file mode 100755
index 0000000..7f78122
--- /dev/null
+++ b/dev/gcdb/display/panel_display.c
@@ -0,0 +1,279 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ *
+ */
+
+/*---------------------------------------------------------------------------*/
+/* HEADER files                                                              */
+/*---------------------------------------------------------------------------*/
+#include <stdint.h>
+#include <msm_panel.h>
+#include <mipi_dsi.h>
+#include <sys/types.h>
+#include <platform/iomap.h>
+#include <err.h>
+#include <reg.h>
+#include <mdp5.h>
+
+
+/*---------------------------------------------------------------------------*/
+/* Panel Header                                                              */
+/*---------------------------------------------------------------------------*/
+#include "panel_display.h"
+#include "include/panel.h"
+
+/*---------------------------------------------------------------------------*/
+/* Panel Init                                                                */
+/*---------------------------------------------------------------------------*/
+int dsi_panel_init(struct msm_panel_info *pinfo,
+			struct panel_struct *pstruct)
+{
+	/* Resolution setting*/
+	pinfo->xres = pstruct->panelres->panel_width;
+	pinfo->yres = pstruct->panelres->panel_height;
+	pinfo->lcdc.h_back_porch = pstruct->panelres->hback_porch;
+	pinfo->lcdc.h_front_porch = pstruct->panelres->hfront_porch;
+	pinfo->lcdc.h_pulse_width = pstruct->panelres->hpulse_width;
+	pinfo->lcdc.v_back_porch = pstruct->panelres->vback_porch;
+	pinfo->lcdc.v_front_porch = pstruct->panelres->vfront_porch;
+	pinfo->lcdc.v_pulse_width = pstruct->panelres->vpulse_width;
+	pinfo->lcdc.hsync_skew = pstruct->panelres->hsync_skew;
+	pinfo->lcdc.xres_pad = pstruct->panelres->hleft_border +
+				pstruct->panelres->hright_border;
+	pinfo->lcdc.yres_pad = pstruct->panelres->vtop_border +
+				 pstruct->panelres->vbottom_border;
+
+	pinfo->lcdc.dual_pipe = (pstruct->paneldata->panel_operating_mode
+								 & 0x2);
+	pinfo->lcdc.pipe_swap = (pstruct->paneldata->panel_operating_mode
+								 & 0x4);
+
+	/* Color setting*/
+	pinfo->lcdc.border_clr = pstruct->color->border_color;
+	pinfo->lcdc.underflow_clr = pstruct->color->underflow_color;
+	pinfo->mipi.rgb_swap = pstruct->color->color_order;
+	switch (pinfo->bpp) {
+	case BPP_16:
+		pinfo->mipi.dst_format = DSI_VIDEO_DST_FORMAT_RGB565;
+		break;
+	case BPP_18:
+		if (pstruct->color->pixel_packing)
+			pinfo->mipi.dst_format
+				= DSI_VIDEO_DST_FORMAT_RGB666_LOOSE;
+		else
+			pinfo->mipi.dst_format
+				 = DSI_VIDEO_DST_FORMAT_RGB666;
+		break;
+	case BPP_24:
+	default:
+		pinfo->mipi.dst_format = DSI_VIDEO_DST_FORMAT_RGB888;
+		break;
+	}
+
+	/* Panel generic info */
+	pinfo->mipi.mode = pstruct->paneldata->panel_type;
+	if (pinfo->mipi.mode) {
+		pinfo->type = MIPI_CMD_PANEL;
+	} else {
+		pinfo->type = MIPI_VIDEO_PANEL;
+	}
+	pinfo->bpp = pstruct->color->color_format;
+	pinfo->clk_rate = pstruct->paneldata->panel_clockrate;
+	pinfo->rotation = pstruct->paneldata->panel_orientation;
+	pinfo->mipi.interleave_mode = pstruct->paneldata->interleave_mode;
+	pinfo->broadcastmode = pstruct->paneldata->panel_broadcast_mode;
+	pinfo->lowpowerstop = pstruct->paneldata->dsi_lp11_atinit;
+	pinfo->mipi.vc = pstruct->paneldata->dsi_virtualchannel_id;
+	pinfo->mipi.frame_rate = pstruct->paneldata->panel_framerate;
+	pinfo->mipi.stream = pstruct->paneldata->dsi_stream;
+	pinfo->mipi.dual_dsi = (pstruct->paneldata->panel_operating_mode
+								 & 0x1);
+	pinfo->mipi.bitclock = pstruct->paneldata->panel_bitclock_freq;
+
+	/* Video Panel configuration */
+	pinfo->mipi.pulse_mode_hsa_he = pstruct->videopanel->hsync_pulse;
+	pinfo->mipi.hfp_power_stop = pstruct->videopanel->hfp_power_mode;
+	pinfo->mipi.hbp_power_stop = pstruct->videopanel->hbp_power_mode;
+	pinfo->mipi.hsa_power_stop = pstruct->videopanel->hsa_power_mode;
+	pinfo->mipi.eof_bllp_power_stop
+			 = pstruct->videopanel->bllp_eof_power_mode;
+	pinfo->mipi.bllp_power_stop = pstruct->videopanel->bllp_power_mode;
+	pinfo->mipi.traffic_mode = pstruct->videopanel->traffic_mode;
+	pinfo->mipi.eof_bllp_power = pstruct->videopanel->bllp_eof_power;
+
+	/* Command Panel configuratoin */
+	pinfo->mipi.insert_dcs_cmd = pstruct->commandpanel->tedcs_command;
+	pinfo->mipi.wr_mem_continue
+			 = pstruct->commandpanel->tevsync_continue_lines;
+	pinfo->mipi.wr_mem_start
+			 = pstruct->commandpanel->tevsync_rdptr_irqline;
+	pinfo->mipi.te_sel = pstruct->commandpanel->tepin_select;
+
+	/* Data lane configuraiton */
+	pinfo->mipi.num_of_lanes = pstruct->laneconfig->dsi_lanes;
+	pinfo->mipi.data_lane0 = pstruct->laneconfig->lane0_state;
+	pinfo->mipi.data_lane1 = pstruct->laneconfig->lane1_state;
+	pinfo->mipi.data_lane2 = pstruct->laneconfig->lane2_state;
+	pinfo->mipi.data_lane3 = pstruct->laneconfig->lane3_state;
+	pinfo->mipi.lane_swap = pstruct->laneconfig->dsi_lanemap;
+
+	pinfo->mipi.t_clk_post = pstruct->paneltiminginfo->tclk_post;
+	pinfo->mipi.t_clk_pre = pstruct->paneltiminginfo->tclk_pre;
+	pinfo->mipi.mdp_trigger = pstruct->paneltiminginfo->dsi_mdp_trigger;
+	pinfo->mipi.dma_trigger = pstruct->paneltiminginfo->dsi_dma_trigger;
+
+	pinfo->on = dsi_panel_on;
+	pinfo->off = dsi_panel_off;
+	pinfo->rotate = dsi_panel_rotation;
+	pinfo->config = dsi_panel_config;
+
+	return NO_ERROR;
+}
+
+/*---------------------------------------------------------------------------*/
+/* Panel Callbacks                                                           */
+/*---------------------------------------------------------------------------*/
+
+int dsi_panel_on()
+{
+	return oem_panel_on();
+}
+
+int dsi_panel_off()
+{
+	return oem_panel_off();
+}
+
+int dsi_panel_rotation()
+{
+	return oem_panel_rotation();
+}
+
+int dsi_video_panel_config(struct msm_panel_info *pinfo,
+			  struct lcdc_panel_info *plcdc
+			   )
+{
+	int ret = NO_ERROR;
+	uint8_t lane_enable = 0;
+	uint32_t panel_width = pinfo->xres;
+
+	if (pinfo->mipi.dual_dsi)
+		panel_width = panel_width / 2;
+
+	switch (pinfo->mipi.num_of_lanes) {
+	case 1:
+		lane_enable = 0x1; /*1 lane only */
+		break;
+	case 2:
+		lane_enable = 0x3; /* 2 lanes only */
+		break;
+	case 3:
+		lane_enable = 0x7; /* 3 lanes only */
+		break;
+	case 4:
+	default:
+		lane_enable = 0xf; /* 4 lanes */
+		break;
+	}
+
+	ret = mdss_dsi_video_mode_config((panel_width + plcdc->xres_pad),
+			(pinfo->yres + plcdc->yres_pad),
+			(panel_width),
+			(pinfo->yres),
+			(plcdc->h_front_porch),
+			(plcdc->h_back_porch + plcdc->h_pulse_width),
+			(plcdc->v_front_porch),
+			(plcdc->v_back_porch + plcdc->v_pulse_width),
+			(plcdc->h_pulse_width),
+			(plcdc->v_pulse_width),
+			pinfo->mipi.dst_format,
+			pinfo->mipi.traffic_mode,
+			lane_enable,
+			pinfo->lowpowerstop,
+			pinfo->mipi.eof_bllp_power,
+			pinfo->mipi.interleave_mode,
+			MIPI_DSI0_BASE);
+
+	if (pinfo->mipi.dual_dsi)
+		ret = mdss_dsi_video_mode_config(
+			(panel_width + plcdc->xres_pad),
+			(pinfo->yres + plcdc->yres_pad),
+			(panel_width),
+			(pinfo->yres),
+			(plcdc->h_front_porch),
+			(plcdc->h_back_porch + plcdc->h_pulse_width),
+			(plcdc->v_front_porch),
+			(plcdc->v_back_porch + plcdc->v_pulse_width),
+			(plcdc->h_pulse_width),
+			(plcdc->v_pulse_width),
+			pinfo->mipi.dst_format,
+			pinfo->mipi.traffic_mode,
+			lane_enable,
+			pinfo->lowpowerstop,
+			pinfo->mipi.eof_bllp_power,
+			pinfo->mipi.interleave_mode,
+			MIPI_DSI1_BASE);
+
+	return ret;
+}
+
+int dsi_cmd_panel_config (struct msm_panel_info *pinfo,
+			struct lcdc_panel_info *plcdc)
+{
+	int ret = NO_ERROR;
+
+	ret = mdss_dsi_cmd_mode_config((pinfo->xres + plcdc->xres_pad),
+			(pinfo->yres + plcdc->yres_pad),
+			(pinfo->xres), (pinfo->yres),
+			pinfo->mipi.dst_format, pinfo->mipi.traffic_mode);
+
+	return ret;
+}
+
+
+int dsi_panel_config(void *pdata)
+{
+	int ret = NO_ERROR;
+	struct msm_panel_info *pinfo = (struct msm_panel_info *)pdata;
+	struct lcdc_panel_info *plcdc = NULL;
+
+	if (pinfo == NULL)
+		return ERR_INVALID_ARGS;
+
+	plcdc =  &(pinfo->lcdc);
+	if (plcdc == NULL)
+		return ERR_INVALID_ARGS;
+
+
+	if (pinfo->mipi.mode == DSI_VIDEO_MODE) {
+		ret = dsi_video_panel_config(pinfo, plcdc);
+	} else {
+		ret = dsi_cmd_panel_config(pinfo, plcdc);
+	}
+
+	return ret;
+}
diff --git a/dev/gcdb/display/panel_display.h b/dev/gcdb/display/panel_display.h
new file mode 100755
index 0000000..195a82c
--- /dev/null
+++ b/dev/gcdb/display/panel_display.h
@@ -0,0 +1,74 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *  * Redistributions of source code must retain the above copyright
+ *    notice, this list of conditions and the following disclaimer.
+ *  * Redistributions in binary form must reproduce the above copyright
+ *    notice, this list of conditions and the following disclaimer in
+ *    the documentation and/or other materials provided with the
+ *    distribution.
+ *  * Neither the name of The Linux Foundation nor the names of its
+ *    contributors may be used to endorse or promote products derived
+ *    from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "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
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ */
+
+#ifndef _PANEL_DISPLAY_H_
+#define _PANEL_DISPLAY_H_
+
+/*---------------------------------------------------------------------------*/
+/* MACRO definition                                                          */
+/*---------------------------------------------------------------------------*/
+
+#define BPP_16 16
+#define BPP_18 18
+#define BPP_24 24
+
+#define TIMING_SIZE 48
+/*---------------------------------------------------------------------------*/
+/* struct definition                                                         */
+/*---------------------------------------------------------------------------*/
+typedef struct panel_struct{
+ struct panel_config       *paneldata;
+ struct panel_resolution   *panelres;
+ struct color_info         *color;
+ struct videopanel_info    *videopanel;
+ struct commandpanel_info  *commandpanel;
+ struct command_state      *state;
+ struct lane_configuration *laneconfig;
+ struct panel_timing       *paneltiminginfo;
+ struct backlight          *backlightinfo;
+};
+
+
+/*---------------------------------------------------------------------------*/
+/* API                                                                       */
+/*---------------------------------------------------------------------------*/
+int dsi_panel_init(struct msm_panel_info *pinfo,
+		struct panel_struct *pstruct);
+
+int dsi_panel_on();
+int dsi_panel_off();
+int dsi_panel_rotation();
+int dsi_panel_config(void *);
+
+/* This should be implemented by oem */
+int oem_panel_rotation();
+int oem_panel_on();
+int oem_panel_off();
+
+#endif /*_PLATFORM_DISPLAY_H_ */
diff --git a/dev/gcdb/display/rules.mk b/dev/gcdb/display/rules.mk
new file mode 100755
index 0000000..438c6c7
--- /dev/null
+++ b/dev/gcdb/display/rules.mk
@@ -0,0 +1,9 @@
+LOCAL_DIR := $(GET_LOCAL_DIR)
+
+INCLUDES += -I$(LOCAL_DIR)/include
+
+OBJS += \
+    $(LOCAL_DIR)/gcdb_display.o \
+    $(LOCAL_DIR)/panel_display.o \
+    $(LOCAL_DIR)/oem_panel.o \
+    $(LOCAL_DIR)/gcdb_autopll.o
diff --git a/dev/panel/msm/mipi_truly_video_wvga.c b/dev/panel/msm/mipi_truly_video_wvga.c
new file mode 100644
index 0000000..4e6f416
--- /dev/null
+++ b/dev/panel/msm/mipi_truly_video_wvga.c
@@ -0,0 +1,313 @@
+/* Copyright (c) 2012-2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ *
+ */
+
+#include <stdint.h>
+#include <msm_panel.h>
+#include <mipi_dsi.h>
+#include <sys/types.h>
+#include <err.h>
+#include <reg.h>
+#include <debug.h>
+#include <target/display.h>
+#include <platform/iomap.h>
+
+#define WVGA_MIPI_FB_WIDTH            480
+#define WVGA_MIPI_FB_HEIGHT           800
+
+#define TRULY_PANEL_FRAME_RATE        60
+#define TRULY_PANEL_NUM_OF_LANES      2
+#define TRULY_PANEL_LANE_SWAP         0
+#define TRULY_PANEL_T_CLK_PRE         0x41b
+#define TRULY_PANEL_T_CLK_POST        0x0
+#define TRULY_PANEL_BPP               24
+#define TRULY_PANEL_CLK_RATE          499000000
+
+static char disp_on0[4] = {
+	0x01, 0x00, 0x05, 0x80
+};
+static char disp_on1[4] = {
+	0xB0, 0x04, 0x23, 0x80
+};
+static char disp_on2[8] = {
+	0x03, 0x00, 0x29, 0xC0,
+	0xB3, 0x02, 0x00, 0xFF
+};
+static char disp_on3[4] = {
+	0xBD, 0x00, 0x23, 0x80
+};
+static char disp_on4[8] = {
+	0x03, 0x00, 0x29, 0xC0,
+	0xC0, 0x18, 0x66, 0xFF
+};
+static char disp_on5[20] = {
+	0x10, 0x00, 0x29, 0xC0,
+	0xC1, 0x23, 0x31, 0x99,
+	0x21, 0x20, 0x00, 0x30,
+	0x28, 0x0C, 0x0C, 0x00,
+	0x00, 0x00, 0x21, 0x01
+};
+static char disp_on6[12] = {
+	0x07, 0x00, 0x29, 0xC0,
+	0xC2, 0x10, 0x06, 0x06,
+	0x01, 0x03, 0x00, 0xFF
+};
+static char disp_on7[32] = {
+	0x19, 0x00, 0x29, 0xC0,
+	0xC8, 0x04, 0x10, 0x18,
+	0x20, 0x2E, 0x46, 0x3C,
+	0x28, 0x1F, 0x18, 0x10,
+	0x04, 0x04, 0x10, 0x18,
+	0x20, 0x2E, 0x46, 0x3C,
+	0x28, 0x1F, 0x18, 0x10,
+	0x04, 0xFF, 0xFF, 0xFF
+};
+static char disp_on8[32] = {
+	0x19, 0x00, 0x29, 0xC0,
+	0xC9, 0x04, 0x10, 0x18,
+	0x20, 0x2E, 0x46, 0x3C,
+	0x28, 0x1F, 0x18, 0x10,
+	0x04, 0x04, 0x10, 0x18,
+	0x20, 0x2E, 0x46, 0x3C,
+	0x28, 0x1F, 0x18, 0x10,
+	0x04, 0xFF, 0xFF, 0xFF
+};
+static char disp_on9[32] = {
+	0x19, 0x00, 0x29, 0xC0,
+	0xCA, 0x04, 0x10, 0x18,
+	0x20, 0x2E, 0x46, 0x3C,
+	0x28, 0x1F, 0x18, 0x10,
+	0x04, 0x04, 0x10, 0x18,
+	0x20, 0x2E, 0x46, 0x3C,
+	0x28, 0x1F, 0x18, 0x10,
+	0x04, 0xFF, 0xFF, 0xFF
+};
+static char disp_on10[24] = {
+	0x11, 0x00, 0x29, 0xC0,
+	0xD0, 0x29, 0x03, 0xce,
+	0xa6, 0x00, 0x43, 0x20,
+	0x10, 0x01, 0x00, 0x01,
+	0x01, 0x00, 0x03, 0x01,
+	0x00, 0xFF, 0xFF, 0xFF
+};
+static char disp_on11[12] = {
+	0x08, 0x00, 0x29, 0xC0,
+	0xD1, 0x18, 0x0C, 0x23,
+	0x03, 0x75, 0x02, 0x50
+};
+static char disp_on12[4] = {
+	0xD3, 0x11, 0x23, 0x80
+};
+static char disp_on13[8] = {
+	0x03, 0x00, 0x29, 0xC0,
+	0xD5, 0x2A, 0x2A, 0xFF
+};
+static char disp_on14[8] = {
+	0x03, 0x00, 0x29, 0xC0,
+	0xDE, 0x01, 0x41, 0xFF
+};
+static char disp_on15[4] = {
+	0xE6, 0x51, 0x23, 0x80
+};
+static char disp_on16[4] = {
+	0xFA, 0x03, 0x23, 0x80
+};
+static char disp_on17[4] = {
+	0xD6, 0x28, 0x23, 0x80
+};
+static char disp_on18[12] = {
+	0x05, 0x00, 0x39, 0xC0,
+	0x2A, 0x00, 0x00, 0x01,
+	0xDF, 0xFF, 0xFF, 0xFF
+};
+static char disp_on19[12] = {
+	0x05, 0x00, 0x39, 0xC0,
+	0x2B, 0x00, 0x00, 0x03,
+	0x1F, 0xFF, 0xFF, 0xFF
+};
+static char disp_on20[4] = {
+	0x35, 0x00, 0x15, 0x80
+};
+static char disp_on21[8] = {
+	0x03, 0x00, 0x39, 0xc0,
+	0x44, 0x00, 0x50, 0xFF
+};
+static char disp_on22[4] = {
+	0x36, 0xC1, 0x15, 0x80
+};
+static char disp_on23[4] = {
+	0x3A, 0x77, 0x15, 0x80
+};
+static char disp_on24[4] = {
+	0x11, 0x00, 0x05, 0x80
+};
+static char disp_on25[4] = {
+	0x29, 0x00, 0x05, 0x80
+};
+
+static struct mipi_dsi_cmd truly_wvga_panel_video_mode_cmds[] = {
+	{sizeof(disp_on0), (char *)disp_on0},
+	{sizeof(disp_on1), (char *)disp_on1},
+	{sizeof(disp_on2), (char *)disp_on2},
+	{sizeof(disp_on3), (char *)disp_on3},
+	{sizeof(disp_on4), (char *)disp_on4},
+	{sizeof(disp_on5), (char *)disp_on5},
+	{sizeof(disp_on6), (char *)disp_on6},
+	{sizeof(disp_on7), (char *)disp_on7},
+	{sizeof(disp_on8), (char *)disp_on8},
+	{sizeof(disp_on9), (char *)disp_on9},
+	{sizeof(disp_on10), (char *)disp_on10},
+	{sizeof(disp_on11), (char *)disp_on11},
+	{sizeof(disp_on12), (char *)disp_on12},
+	{sizeof(disp_on13), (char *)disp_on13},
+	{sizeof(disp_on14), (char *)disp_on14},
+	{sizeof(disp_on15), (char *)disp_on15},
+	{sizeof(disp_on16), (char *)disp_on16},
+	{sizeof(disp_on17), (char *)disp_on17},
+	{sizeof(disp_on18), (char *)disp_on18},
+	{sizeof(disp_on19), (char *)disp_on19},
+	{sizeof(disp_on20), (char *)disp_on20},
+	{sizeof(disp_on21), (char *)disp_on21},
+	{sizeof(disp_on22), (char *)disp_on22},
+	{sizeof(disp_on23), (char *)disp_on23},
+	{sizeof(disp_on24), (char *)disp_on24},
+	{sizeof(disp_on25), (char *)disp_on25},
+};
+
+int mipi_truly_video_wvga_config(void *pdata)
+{
+	int ret = NO_ERROR;
+	/* 2 Lanes -- Enables Data Lane0, 1 */
+	unsigned char lane_en = 3;
+	unsigned long low_pwr_stop_mode = 0;
+
+	/* Needed or else will have blank line at top of display */
+	unsigned char eof_bllp_pwr = 0x9;
+
+	unsigned char interleav = 0;
+	struct lcdc_panel_info *lcdc = NULL;
+	struct msm_panel_info *pinfo = (struct msm_panel_info *) pdata;
+
+	if (pinfo == NULL)
+		return ERR_INVALID_ARGS;
+
+	lcdc =  &(pinfo->lcdc);
+	if (lcdc == NULL)
+		return ERR_INVALID_ARGS;
+
+	ret = mdss_dsi_video_mode_config((pinfo->xres),
+			(pinfo->yres),
+			(pinfo->xres),
+			(pinfo->yres),
+			(lcdc->h_front_porch),
+			(lcdc->h_back_porch),
+			(lcdc->v_front_porch),
+			(lcdc->v_back_porch),
+			(lcdc->h_pulse_width),
+			(lcdc->v_pulse_width),
+			pinfo->mipi.dst_format,
+			pinfo->mipi.traffic_mode,
+			lane_en,
+			low_pwr_stop_mode,
+			eof_bllp_pwr,
+			interleav,
+			MIPI_DSI0_BASE);
+	return ret;
+}
+
+int mipi_truly_video_wvga_on()
+{
+	int ret = NO_ERROR;
+	return ret;
+}
+
+int mipi_truly_video_wvga_off()
+{
+	int ret = NO_ERROR;
+	return ret;
+}
+
+static struct mdss_dsi_phy_ctrl dsi_video_mode_phy_db = {
+	/* regulator */
+	{0x09, 0x08, 0x05, 0x00, 0x20, 0x03},
+	/* timing   */
+	{0x5d, 0x12, 0x0c, 0x00, 0x33, 0x38,
+		0x10, 0x16, 0x1e, 0x03, 0x04, 0x00},
+	/* phy ctrl */
+	{0x7f, 0x00, 0x00, 0x00},
+	/* strength */
+	{0xff, 0x06},
+	/* bist */
+	{0x03, 0x03, 0x00, 0x00, 0x0f, 0x00},
+	/* lane config */
+	{0x80, 0x45, 0x00, 0x00, 0x00, 0x01, 0x66, 0x00, 0x00,
+		0x80, 0x45, 0x00, 0x00, 0x00, 0x01, 0x66, 0x00, 0x00,
+		0x80, 0x45, 0x00, 0x00, 0x00, 0x01, 0x66, 0x00, 0x00,
+		0x80, 0x45, 0x00, 0x00, 0x00, 0x01, 0x66, 0x00, 0x00,
+		0x40, 0x67, 0x00, 0x00, 0x00, 0x01, 0x88, 0x00, 0x00},
+};
+
+void mipi_truly_video_wvga_init(struct msm_panel_info *pinfo)
+{
+	if (!pinfo)
+		return;
+
+	pinfo->xres = WVGA_MIPI_FB_WIDTH;
+	pinfo->yres = WVGA_MIPI_FB_HEIGHT;
+	pinfo->lcdc.h_back_porch = MIPI_HSYNC_BACK_PORCH_DCLK;
+	pinfo->lcdc.h_front_porch = MIPI_HSYNC_FRONT_PORCH_DCLK;
+	pinfo->lcdc.h_pulse_width = MIPI_HSYNC_PULSE_WIDTH;
+	pinfo->lcdc.v_back_porch = MIPI_VSYNC_BACK_PORCH_LINES;
+	pinfo->lcdc.v_front_porch = MIPI_VSYNC_FRONT_PORCH_LINES;
+	pinfo->lcdc.v_pulse_width = MIPI_VSYNC_PULSE_WIDTH;
+	pinfo->mipi.num_of_lanes = TRULY_PANEL_NUM_OF_LANES;
+	pinfo->mipi.frame_rate = TRULY_PANEL_FRAME_RATE;
+
+	pinfo->type = MIPI_VIDEO_PANEL;
+	pinfo->wait_cycle = 0;
+	pinfo->bpp = TRULY_PANEL_BPP;
+	pinfo->clk_rate = TRULY_PANEL_CLK_RATE;
+
+	pinfo->mipi.mode = DSI_VIDEO_MODE;
+	pinfo->mipi.traffic_mode = 1;
+	pinfo->mipi.dst_format = DSI_VIDEO_DST_FORMAT_RGB888;
+	pinfo->mipi.mdss_dsi_phy_db = &dsi_video_mode_phy_db;
+	pinfo->mipi.tx_eot_append = TRUE;
+
+	pinfo->mipi.lane_swap = TRULY_PANEL_LANE_SWAP;
+	pinfo->mipi.t_clk_post = TRULY_PANEL_T_CLK_POST;
+	pinfo->mipi.t_clk_pre = TRULY_PANEL_T_CLK_PRE;
+	pinfo->mipi.panel_cmds = truly_wvga_panel_video_mode_cmds;
+	pinfo->mipi.num_of_panel_cmds = ARRAY_SIZE(truly_wvga_panel_video_mode_cmds);
+
+	pinfo->on = mipi_truly_video_wvga_on;
+	pinfo->off = mipi_truly_video_wvga_off;
+	pinfo->config = mipi_truly_video_wvga_config;
+
+	return;
+}
diff --git a/dev/panel/msm/rules.mk b/dev/panel/msm/rules.mk
index 6c7b26d..b3bdac3 100644
--- a/dev/panel/msm/rules.mk
+++ b/dev/panel/msm/rules.mk
@@ -32,3 +32,8 @@
 	$(LOCAL_DIR)/mipi_nt35590_video_720p.o \
 	$(LOCAL_DIR)/mipi_nt35590_cmd_720p.o
 endif
+
+ifeq ($(PLATFORM),msm8610)
+OBJS += \
+	$(LOCAL_DIR)/mipi_truly_video_wvga.o
+endif
diff --git a/dev/pmic/pm8x41/include/pm8x41.h b/dev/pmic/pm8x41/include/pm8x41.h
index 074cbf2..45f3bc7 100644
--- a/dev/pmic/pm8x41/include/pm8x41.h
+++ b/dev/pmic/pm8x41/include/pm8x41.h
@@ -62,7 +62,12 @@
 #define PON_PSHOLD_WARM_RESET   0x1
 #define PON_PSHOLD_SHUTDOWN     0x4
 
-#define PMIC_VERSION_V2         1
+enum PM8X41_VERSIONS
+{
+	PM8X41_VERSION_V1 = 0,
+	PM8X41_VERSION_V2 = 1,
+};
+
 
 /*Target power on reasons*/
 #define DC_CHG                  8
@@ -184,8 +189,8 @@
 int pm8x41_gpio_set(uint8_t gpio, uint8_t value);
 int pm8x41_gpio_config(uint8_t gpio, struct pm8x41_gpio *config);
 void pm8x41_set_boot_done();
+uint32_t pm8x41_v2_resin_status();
 uint32_t pm8x41_resin_status();
-uint32_t pm8x41_resin_bark_workaround_status();
 void pm8x41_reset_configure(uint8_t);
 void pm8x41_v2_reset_configure(uint8_t);
 int pm8x41_ldo_set_voltage(struct pm8x41_ldo *ldo, uint32_t voltage);
diff --git a/dev/pmic/pm8x41/pm8x41.c b/dev/pmic/pm8x41/pm8x41.c
index b9e147b..0e1109b 100644
--- a/dev/pmic/pm8x41/pm8x41.c
+++ b/dev/pmic/pm8x41/pm8x41.c
@@ -187,7 +187,7 @@
 }
 
 /* Resin irq status for faulty pmic*/
-uint32_t pm8x41_resin_bark_workaround_status()
+uint32_t pm8x41_v2_resin_status()
 {
 	uint8_t rt_sts = 0;
 
diff --git a/include/dev/fbcon.h b/include/dev/fbcon.h
index e8b047b..7ab5ca1 100644
--- a/include/dev/fbcon.h
+++ b/include/dev/fbcon.h
@@ -2,7 +2,7 @@
  * Copyright (c) 2008, Google Inc.
  * All rights reserved.
  *
- * Copyright (c) 2009-2010, The Linux Foundation. All rights reserved.
+ * Copyright (c) 2009-2013, The Linux Foundation. All rights reserved.
  *
  * Redistribution and use in source and binary forms, with or without
  * modification, are permitted provided that the following conditions
@@ -32,7 +32,9 @@
 #define __DEV_FBCON_H
 
 #define FB_FORMAT_RGB565 0
-#define FB_FORMAT_RGB888 1
+#define FB_FORMAT_RGB666 1
+#define FB_FORMAT_RGB666_LOOSE 2
+#define FB_FORMAT_RGB888 3
 
 struct fbcon_config {
 	void		*base;
diff --git a/platform/mpq8092/acpuclock.c b/platform/mpq8092/acpuclock.c
new file mode 100644
index 0000000..2adfacb
--- /dev/null
+++ b/platform/mpq8092/acpuclock.c
@@ -0,0 +1,98 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ */
+
+#include <err.h>
+#include <assert.h>
+#include <debug.h>
+#include <reg.h>
+#include <platform/timer.h>
+#include <platform/iomap.h>
+#include <mmc.h>
+#include <clock.h>
+#include <platform/clock.h>
+
+void hsusb_clock_init(void)
+{
+
+}
+
+void clock_init_mmc(uint32_t interface)
+{
+
+}
+
+/* Configure MMC clock */
+void clock_config_mmc(uint32_t interface, uint32_t freq)
+{
+	uint32_t reg;
+
+	reg = 0;
+	reg |= MMC_BOOT_MCI_CLK_ENABLE;
+	reg |= MMC_BOOT_MCI_CLK_ENA_FLOW;
+	reg |= MMC_BOOT_MCI_CLK_IN_FEEDBACK;
+	writel(reg, MMC_BOOT_MCI_CLK);
+}
+
+/* Configure UART clock based on the UART block id*/
+void clock_config_uart_dm(uint8_t id)
+{
+
+}
+
+/* Function to asynchronously reset CE.
+ * Function assumes that all the CE clocks are off.
+ */
+static void ce_async_reset(uint8_t instance)
+{
+
+}
+
+static void clock_ce_enable(uint8_t instance)
+{
+
+}
+
+static void clock_ce_disable(uint8_t instance)
+{
+
+}
+
+void clock_config_ce(uint8_t instance)
+{
+	/* Need to enable the clock before disabling since the clk_disable()
+	 * has a check to default to nop when the clk_enable() is not called
+	 * on that particular clock.
+	 */
+	clock_ce_enable(instance);
+
+	clock_ce_disable(instance);
+
+	ce_async_reset(instance);
+
+	clock_ce_enable(instance);
+}
diff --git a/platform/mpq8092/gpio.c b/platform/mpq8092/gpio.c
new file mode 100644
index 0000000..6f0c834
--- /dev/null
+++ b/platform/mpq8092/gpio.c
@@ -0,0 +1,63 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ */
+
+#include <debug.h>
+#include <reg.h>
+#include <platform/iomap.h>
+#include <platform/gpio.h>
+
+void gpio_tlmm_config(uint32_t gpio, uint8_t func,
+			uint8_t dir, uint8_t pull,
+			uint8_t drvstr, uint32_t enable)
+{
+	uint32_t val = 0;
+	val |= pull;
+	val |= func << 2;
+	val |= drvstr << 6;
+	val |= enable << 9;
+	writel(val, (uint32_t *)GPIO_CONFIG_ADDR(gpio));
+	return;
+}
+
+void gpio_set(uint32_t gpio, uint32_t dir)
+{
+	writel(dir, (uint32_t *)GPIO_IN_OUT_ADDR(gpio));
+	return;
+}
+
+/* Configure gpio for blsp uart 2 */
+void gpio_config_uart_dm(uint8_t id)
+{
+	/* configure rx gpio */
+	gpio_tlmm_config(5, 2, GPIO_INPUT, GPIO_NO_PULL,
+				GPIO_8MA, GPIO_DISABLE);
+
+	/* configure tx gpio */
+	gpio_tlmm_config(4, 2, GPIO_OUTPUT, GPIO_NO_PULL,
+				GPIO_8MA, GPIO_DISABLE);
+}
diff --git a/platform/mpq8092/include/platform/clock.h b/platform/mpq8092/include/platform/clock.h
new file mode 100644
index 0000000..2113d4b
--- /dev/null
+++ b/platform/mpq8092/include/platform/clock.h
@@ -0,0 +1,45 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ */
+
+#ifndef __MPQ8092_CLOCK_H
+#define __MPQ8092_CLOCK_H
+
+#include <clock.h>
+#include <clock_lib2.h>
+
+#define UART_DM_CLK_RX_TX_BIT_RATE 0xCC
+
+void platform_clock_init(void);
+
+void clock_init_mmc(uint32_t interface);
+void clock_config_mmc(uint32_t interface, uint32_t freq);
+void clock_config_uart_dm(uint8_t id);
+void hsusb_clock_init(void);
+void clock_config_ce(uint8_t instance);
+
+#endif
diff --git a/platform/mpq8092/include/platform/gpio.h b/platform/mpq8092/include/platform/gpio.h
new file mode 100644
index 0000000..4c6e24e
--- /dev/null
+++ b/platform/mpq8092/include/platform/gpio.h
@@ -0,0 +1,58 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ */
+
+#ifndef __PLATFORM_MPQ8092_GPIO_H
+#define __PLATFORM_MPQ8092_GPIO_H
+
+/* GPIO TLMM: Direction */
+#define GPIO_INPUT      0
+#define GPIO_OUTPUT     1
+
+/* GPIO TLMM: Pullup/Pulldown */
+#define GPIO_NO_PULL    0
+#define GPIO_PULL_DOWN  1
+#define GPIO_KEEPER     2
+#define GPIO_PULL_UP    3
+
+/* GPIO TLMM: Drive Strength */
+#define GPIO_2MA        0
+#define GPIO_4MA        1
+#define GPIO_6MA        2
+#define GPIO_8MA        3
+#define GPIO_10MA       4
+#define GPIO_12MA       5
+#define GPIO_14MA       6
+#define GPIO_16MA       7
+
+/* GPIO TLMM: Status */
+#define GPIO_ENABLE     0
+#define GPIO_DISABLE    1
+
+void gpio_config_uart_dm(uint8_t id);
+
+#endif
diff --git a/platform/mpq8092/include/platform/iomap.h b/platform/mpq8092/include/platform/iomap.h
new file mode 100644
index 0000000..ba10f13
--- /dev/null
+++ b/platform/mpq8092/include/platform/iomap.h
@@ -0,0 +1,130 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ */
+
+#ifndef _PLATFORM_MSM8092_IOMAP_H_
+#define _PLATFORM_MSM8092_IOMAP_H_
+
+#define MSM_IOMAP_BASE              0xF9000000
+#define MSM_IOMAP_END               0xFEFFFFFF
+
+#define SDRAM_START_ADDR            0x00000000
+
+#define MSM_SHARED_BASE             0x0FA00000
+
+#define APPS_SS_BASE                0xF9000000
+
+#define MSM_GIC_DIST_BASE           APPS_SS_BASE
+#define MSM_GIC_CPU_BASE            (APPS_SS_BASE + 0x2000)
+#define APPS_APCS_QTMR_AC_BASE      (APPS_SS_BASE + 0x00020000)
+#define APPS_APCS_F0_QTMR_V1_BASE   (APPS_SS_BASE + 0x00021000)
+#define QTMR_BASE                   APPS_APCS_F0_QTMR_V1_BASE
+
+#define PERIPH_SS_BASE              0xF9800000
+
+#define MSM_SDC1_BAM_BASE           (PERIPH_SS_BASE + 0x00004000)
+#define MSM_SDC1_BASE               (PERIPH_SS_BASE + 0x00024000)
+#define MSM_SDC1_DML_BASE           (PERIPH_SS_BASE + 0x00024800)
+#define MSM_SDC3_BAM_BASE           (PERIPH_SS_BASE + 0x00044000)
+#define MSM_SDC3_BASE               (PERIPH_SS_BASE + 0x00064000)
+#define MSM_SDC3_DML_BASE           (PERIPH_SS_BASE + 0x00064800)
+#define MSM_SDC2_BAM_BASE           (PERIPH_SS_BASE + 0x00084000)
+#define MSM_SDC2_BASE               (PERIPH_SS_BASE + 0x000A4000)
+#define MSM_SDC2_DML_BASE           (PERIPH_SS_BASE + 0x000A4800)
+#define MSM_SDC4_BAM_BASE           (PERIPH_SS_BASE + 0x000C4000)
+#define MSM_SDC4_BASE               (PERIPH_SS_BASE + 0x000E4000)
+#define MSM_SDC4_DML_BASE           (PERIPH_SS_BASE + 0x000E4800)
+
+#define BLSP1_UART0_BASE            (PERIPH_SS_BASE + 0x0011D000)
+#define BLSP1_UART1_BASE            (PERIPH_SS_BASE + 0x0011E000)
+#define BLSP1_UART2_BASE            (PERIPH_SS_BASE + 0x0011F000)
+#define BLSP1_UART3_BASE            (PERIPH_SS_BASE + 0x00120000)
+#define BLSP1_UART4_BASE            (PERIPH_SS_BASE + 0x00121000)
+#define BLSP1_UART5_BASE            (PERIPH_SS_BASE + 0x00122000)
+#define MSM_USB_BASE                (PERIPH_SS_BASE + 0x00255000)
+
+#define CLK_CTL_BASE                0xFC400000
+
+#define GCC_WDOG_DEBUG              (CLK_CTL_BASE +  0x00001780)
+
+#define USB_HS_BCR                  (CLK_CTL_BASE + 0x480)
+#define USB_BOOT_CLOCK_CTL          (CLK_CTL_BASE + 0x1A00)
+
+#define SPMI_BASE                   0xFC4C0000
+#define SPMI_GENI_BASE              (SPMI_BASE + 0xA000)
+#define SPMI_PIC_BASE               (SPMI_BASE + 0xB000)
+
+#define MSM_CE1_BAM_BASE            0xFD404000
+#define MSM_CE1_BASE                0xFD41A000
+
+#define TLMM_BASE_ADDR              0xFD510000
+#define GPIO_CONFIG_ADDR(x)         (TLMM_BASE_ADDR + 0x1000 + (x)*0x10)
+#define GPIO_IN_OUT_ADDR(x)         (TLMM_BASE_ADDR + 0x1004 + (x)*0x10)
+
+#define MPM2_MPM_CTRL_BASE          0xFC4A1000
+#define MPM2_MPM_PS_HOLD            0xFC4AB000
+
+/* CE 2 */
+#define  GCC_CE2_BCR                (CLK_CTL_BASE + 0x1080)
+#define  GCC_CE2_CMD_RCGR           (CLK_CTL_BASE + 0x1090)
+#define  GCC_CE2_CFG_RCGR           (CLK_CTL_BASE + 0x1094)
+#define  GCC_CE2_CBCR               (CLK_CTL_BASE + 0x1084)
+#define  GCC_CE2_AXI_CBCR           (CLK_CTL_BASE + 0x1088)
+#define  GCC_CE2_AHB_CBCR           (CLK_CTL_BASE + 0x108C)
+
+/* GPLL */
+#define GPLL0_STATUS                (CLK_CTL_BASE + 0x001C)
+#define APCS_GPLL_ENA_VOTE          (CLK_CTL_BASE + 0x1480)
+#define APCS_CLOCK_BRANCH_ENA_VOTE  (CLK_CTL_BASE + 0x1484)
+
+/* SDCC */
+#define SDCC1_BCR                   (CLK_CTL_BASE + 0x4C0) /* block reset */
+#define SDCC1_APPS_CBCR             (CLK_CTL_BASE + 0x4C4) /* branch control */
+#define SDCC1_AHB_CBCR              (CLK_CTL_BASE + 0x4C8)
+#define SDCC1_INACTIVITY_TIMER_CBCR (CLK_CTL_BASE + 0x4CC)
+#define SDCC1_CMD_RCGR              (CLK_CTL_BASE + 0x4D0) /* cmd */
+#define SDCC1_CFG_RCGR              (CLK_CTL_BASE + 0x4D4) /* cfg */
+#define SDCC1_M                     (CLK_CTL_BASE + 0x4D8) /* m */
+#define SDCC1_N                     (CLK_CTL_BASE + 0x4DC) /* n */
+#define SDCC1_D                     (CLK_CTL_BASE + 0x4E0) /* d */
+
+/* UART */
+#define BLSP1_AHB_CBCR              (CLK_CTL_BASE + 0x5C4)
+#define BLSP1_UART2_APPS_CBCR       (CLK_CTL_BASE + 0x704)
+#define BLSP1_UART2_APPS_CMD_RCGR   (CLK_CTL_BASE + 0x70C)
+#define BLSP1_UART2_APPS_CFG_RCGR   (CLK_CTL_BASE + 0x710)
+#define BLSP1_UART2_APPS_M          (CLK_CTL_BASE + 0x714)
+#define BLSP1_UART2_APPS_N          (CLK_CTL_BASE + 0x718)
+#define BLSP1_UART2_APPS_D          (CLK_CTL_BASE + 0x71C)
+
+/* USB */
+#define USB_HS_SYSTEM_CBCR          (CLK_CTL_BASE + 0x484)
+#define USB_HS_AHB_CBCR             (CLK_CTL_BASE + 0x488)
+#define USB_HS_SYSTEM_CMD_RCGR      (CLK_CTL_BASE + 0x490)
+#define USB_HS_SYSTEM_CFG_RCGR      (CLK_CTL_BASE + 0x494)
+
+#endif
diff --git a/platform/mpq8092/include/platform/irqs.h b/platform/mpq8092/include/platform/irqs.h
new file mode 100644
index 0000000..33430cb
--- /dev/null
+++ b/platform/mpq8092/include/platform/irqs.h
@@ -0,0 +1,61 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ */
+
+#ifndef __IRQS_MPQ8092_H
+#define __IRQS_MPQ8092_H
+
+/* MSM ACPU Interrupt Numbers */
+
+/* 0-15:  STI/SGI (software triggered/generated interrupts)
+ * 16-31: PPI (private peripheral interrupts)
+ * 32+:   SPI (shared peripheral interrupts)
+ */
+
+#define GIC_PPI_START                          16
+#define GIC_SPI_START                          32
+
+#define INT_QTMR_NON_SECURE_PHY_TIMER_EXP      (GIC_PPI_START + 3)
+#define INT_QTMR_VIRTUAL_TIMER_EXP             (GIC_PPI_START + 4)
+
+#define INT_QTMR_FRM_0_PHYSICAL_TIMER_EXP      (GIC_SPI_START + 8)
+
+#define USB1_HS_BAM_IRQ                        (GIC_SPI_START + 135)
+#define USB1_HS_IRQ                            (GIC_SPI_START + 134)
+
+/* Retrofit universal macro names */
+#define INT_USB_HS                             USB1_HS_IRQ
+
+#define EE0_KRAIT_HLOS_SPMI_PERIPH_IRQ         (GIC_SPI_START + 190)
+
+#define NR_MSM_IRQS                            256
+#define NR_GPIO_IRQS                           173
+#define NR_BOARD_IRQS                          0
+
+#define NR_IRQS                                (NR_MSM_IRQS + NR_GPIO_IRQS + \
+                                               NR_BOARD_IRQS)
+#endif /* __IRQS_MPQ8092_H */
diff --git a/platform/mpq8092/platform.c b/platform/mpq8092/platform.c
new file mode 100644
index 0000000..5509d78
--- /dev/null
+++ b/platform/mpq8092/platform.c
@@ -0,0 +1,49 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS"
+ * AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE
+ * IMPLIED WARRANTIES OF MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND
+ * NON-INFRINGEMENT ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR
+ * CONTRIBUTORS 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.
+ */
+
+#include <debug.h>
+#include <reg.h>
+#include <platform/iomap.h>
+#include <qgic.h>
+#include <qtimer.h>
+
+void platform_early_init(void)
+{
+	qgic_init();
+	qtimer_init();
+}
+
+void platform_init(void)
+{
+	dprintf(INFO, "platform_init()\n");
+}
+
+void platform_uninit(void)
+{
+	qtimer_uninit();
+}
diff --git a/platform/mpq8092/rules.mk b/platform/mpq8092/rules.mk
new file mode 100644
index 0000000..11faf01
--- /dev/null
+++ b/platform/mpq8092/rules.mk
@@ -0,0 +1,25 @@
+LOCAL_DIR := $(GET_LOCAL_DIR)
+
+ARCH    := arm
+#Compiling this as cortex-a8 until the compiler supports krait
+ARM_CPU := cortex-a8
+CPU     := generic
+
+DEFINES += ARM_CPU_CORE_KRAIT
+
+MMC_SLOT         := 1
+
+DEFINES += PERIPH_BLK_BLSP=1
+DEFINES += WITH_CPU_EARLY_INIT=0 WITH_CPU_WARM_BOOT=0 \
+          MMC_SLOT=$(MMC_SLOT)
+
+INCLUDES += -I$(LOCAL_DIR)/include -I$(LK_TOP_DIR)/platform/msm_shared/include
+
+OBJS += \
+       $(LOCAL_DIR)/platform.o \
+       $(LOCAL_DIR)/acpuclock.o \
+       $(LOCAL_DIR)/gpio.o
+
+LINKER_SCRIPT += $(BUILDDIR)/system-onesegment.ld
+
+include platform/msm_shared/rules.mk
diff --git a/platform/msm8226/acpuclock.c b/platform/msm8226/acpuclock.c
old mode 100644
new mode 100755
index 855b77b..82e56a3
--- a/platform/msm8226/acpuclock.c
+++ b/platform/msm8226/acpuclock.c
@@ -399,6 +399,54 @@
 	writel(0x1, DSI_PIXEL0_CBCR);
 }
 
+void mmss_clock_auto_pll_init(uint8_t pclk0_m, uint8_t pclk0_n, uint8_t pclk0_d)
+{
+	int ret;
+
+	/* Configure Byte clock -autopll- This will not change becasue
+	byte clock does not need any divider*/
+	writel(0x100, DSI_BYTE0_CFG_RCGR);
+	writel(0x1, DSI_BYTE0_CMD_RCGR);
+	writel(0x1, DSI_BYTE0_CBCR);
+
+	/* Configure ESC clock */
+	ret = clk_get_set_enable("mdss_esc0_clk", 0, 1);
+	if (ret) {
+		dprintf(CRITICAL, "failed to set esc0_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	/* Configure MMSSNOC AXI clock */
+	ret = clk_get_set_enable("mmss_mmssnoc_axi_clk", 100000000, 1);
+	if (ret) {
+		dprintf(CRITICAL, "failed to set mmssnoc_axi_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	/* Configure MMSSNOC AXI clock */
+	ret = clk_get_set_enable("mmss_s0_axi_clk", 100000000, 1);
+	if (ret) {
+		dprintf(CRITICAL, "failed to set mmss_s0_axi_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	/* Configure AXI clock */
+	ret = clk_get_set_enable("mdss_axi_clk", 100000000, 1);
+	if (ret) {
+		dprintf(CRITICAL, "failed to set mdss_axi_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	/* Configure Pixel clock */
+	writel(0x100, DSI_PIXEL0_CFG_RCGR);
+	writel(0x1, DSI_PIXEL0_CMD_RCGR);
+	writel(0x1, DSI_PIXEL0_CBCR);
+
+	writel(pclk0_m, DSI_PIXEL0_M);
+	writel(pclk0_n, DSI_PIXEL0_N);
+	writel(pclk0_d, DSI_PIXEL0_D);
+}
+
 void mmss_clock_disable(void)
 {
 
diff --git a/platform/msm8226/include/platform/clock.h b/platform/msm8226/include/platform/clock.h
old mode 100644
new mode 100755
index ca655e8..fbbd77a
--- a/platform/msm8226/include/platform/clock.h
+++ b/platform/msm8226/include/platform/clock.h
@@ -68,6 +68,9 @@
 #define DSI_PIXEL0_CMD_RCGR             REG_MM(0x2000)
 #define DSI_PIXEL0_CFG_RCGR             REG_MM(0x2004)
 #define DSI_PIXEL0_CBCR                 REG_MM(0x2314)
+#define DSI_PIXEL0_M                    REG_MM(0x2008)
+#define DSI_PIXEL0_N                    REG_MM(0x200C)
+#define DSI_PIXEL0_D                    REG_MM(0x2010)
 
 void platform_clock_init(void);
 
diff --git a/platform/msm8226/include/platform/iomap.h b/platform/msm8226/include/platform/iomap.h
index 36756ba..ea8bbeb 100644
--- a/platform/msm8226/include/platform/iomap.h
+++ b/platform/msm8226/include/platform/iomap.h
@@ -160,4 +160,32 @@
 #define MDP_BASE                    (0xfd900000)
 #define REG_MDP(off)                (MDP_BASE + (off))
 
+#define SOFT_RESET                  0x118
+#define CLK_CTRL                    0x11C
+#define TRIG_CTRL                   0x084
+#define CTRL                        0x004
+#define COMMAND_MODE_DMA_CTRL       0x03C
+#define ERR_INT_MASK0               0x10C
+
+#define LANE_SWAP_CTL               0x0B0
+#define TIMING_CTL                  0x0C4
+
+#define VIDEO_MODE_ACTIVE_H         0x024
+#define VIDEO_MODE_ACTIVE_V         0x028
+#define VIDEO_MODE_TOTAL            0x02C
+#define VIDEO_MODE_HSYNC            0x030
+#define VIDEO_MODE_VSYNC            0x034
+#define VIDEO_MODE_VSYNC_VPOS       0x038
+
+#define DMA_CMD_OFFSET              0x048
+#define DMA_CMD_LENGTH              0x04C
+
+#define INT_CTRL                    0x110
+#define CMD_MODE_DMA_SW_TRIGGER     0x090
+
+#define EOT_PACKET_CTRL             0x0C8
+#define MISR_VIDEO_CTRL             0x0A4
+#define VIDEO_MODE_CTRL             0x010
+#define HS_TIMER_CTRL               0x0BC
+
 #endif
diff --git a/platform/msm8610/acpuclock.c b/platform/msm8610/acpuclock.c
index 1d3fcfd..f1dcba7 100644
--- a/platform/msm8610/acpuclock.c
+++ b/platform/msm8610/acpuclock.c
@@ -172,3 +172,278 @@
 {
 }
 
+/* Configure MDP clock */
+void mdp_clock_enable(void)
+{
+	int ret;
+
+	ret = clk_get_set_enable("axi_clk_src", 100000000, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set axi_clk_src ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = clk_get_set_enable("mmss_mmssnoc_axi_clk", 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set mmss_mmssnoc_axi_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = clk_get_set_enable("mmss_s0_axi_clk", 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set mmss_s0_axi_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = clk_get_set_enable("mdp_ahb_clk", 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set mdp_ahb_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = clk_get_set_enable("mdp_axi_clk" , 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set mdp_axi_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = clk_get_set_enable("mdp_vsync_clk" , 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set mdp_vsync_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+}
+
+void mdp_clock_disable(void)
+{
+	clk_disable(clk_get("mdp_vsync_clk"));
+	clk_disable(clk_get("mdp_axi_clk"));
+	clk_disable(clk_get("mdp_ahb_clk"));
+	clk_disable(clk_get("mmss_s0_axi_clk"));
+	clk_disable(clk_get("mmss_mmssnoc_axi_clk"));
+}
+
+int dsi_vco_set_rate(uint32_t rate)
+{
+	uint32_t temp, val;
+	unsigned long fb_divider;
+
+	temp = rate / 10;
+	val = VCO_PARENT_RATE / 10;
+	fb_divider = (temp * VCO_PREF_DIV_RATIO) / val;
+	fb_divider = fb_divider / 2 - 1;
+
+	temp = readl(DSIPHY_PLL_CTRL(1));
+	val = (temp & 0xFFFFFF00) | (fb_divider & 0xFF);
+	writel(val, DSIPHY_PLL_CTRL(1));
+
+	temp = readl(DSIPHY_PLL_CTRL(2));
+	val = (temp & 0xFFFFFFF8) | ((fb_divider >> 8) & 0x07);
+	writel(val, DSIPHY_PLL_CTRL(2));
+
+	temp = readl(DSIPHY_PLL_CTRL(3));
+	val = (temp & 0xFFFFFFC0) | (VCO_PREF_DIV_RATIO - 1);
+	writel(val, DSIPHY_PLL_CTRL(3));
+	return 0;
+}
+
+uint32_t dsi_vco_round_rate(uint32_t rate)
+{
+	uint32_t vco_rate = rate;
+
+	if (rate < VCO_MIN_RATE)
+		vco_rate = VCO_MIN_RATE;
+	else if (rate > VCO_MAX_RATE)
+		vco_rate = VCO_MAX_RATE;
+
+	return vco_rate;
+}
+
+int dsi_byte_clk_set(uint32_t *vcoclk_rate, uint32_t rate)
+{
+	int div, ret;
+	uint32_t vco_rate, bitclk_rate;
+	uint32_t temp, val;
+
+	bitclk_rate = 8 * rate;
+
+	for (div = 1; div < VCO_MAX_DIVIDER; div++)
+	{
+		vco_rate = dsi_vco_round_rate(bitclk_rate * div);
+
+		if (vco_rate == bitclk_rate * div)
+			break;
+
+		if (vco_rate < bitclk_rate * div)
+			return -1;
+	}
+
+	if (vco_rate != bitclk_rate * div)
+		return -1;
+
+	ret = dsi_vco_set_rate(vco_rate);
+	if (ret)
+	{
+		dprintf(CRITICAL, "fail to set vco rate, ret = %d\n", ret);
+		return ret;
+	}
+	*vcoclk_rate = vco_rate;
+
+	/* set the bit clk divider */
+	temp =  readl(DSIPHY_PLL_CTRL(8));
+	val = (temp & 0xFFFFFFF0) | (div - 1);
+	writel(val, DSIPHY_PLL_CTRL(8));
+
+	/* set the byte clk divider */
+	temp = readl(DSIPHY_PLL_CTRL(9));
+	val = (temp & 0xFFFFFF00) | (vco_rate / rate - 1);
+	writel(val, DSIPHY_PLL_CTRL(9));
+
+	return 0;
+}
+
+int dsi_dsi_clk_set(uint32_t vco_rate, uint32_t rate)
+{
+	uint32_t temp, val;
+
+	if (vco_rate % rate != 0)
+	{
+		dprintf(CRITICAL, "dsiclk_set_rate invalid rate\n");
+		return -1;
+	}
+
+	temp = readl(DSIPHY_PLL_CTRL(10));
+	val = (temp & 0xFFFFFF00) | (vco_rate / rate - 1);
+	writel(val, DSIPHY_PLL_CTRL(10));
+
+	return 0;
+}
+
+void dsi_setup_dividers(uint32_t val, uint32_t cfg_rcgr,
+	uint32_t cmd_rcgr)
+{
+	uint32_t i = 0;
+	uint32_t term_cnt = 5000;
+	int32_t reg;
+
+	writel(val, cfg_rcgr);
+	writel(0x1, cmd_rcgr);
+	reg = readl(cmd_rcgr);
+	while (reg & 0x1)
+	{
+		i++;
+		if (i > term_cnt)
+		{
+			dprintf(CRITICAL, "some dsi clock not enabled"
+					"exceeded polling TIMEOUT!\n");
+			break;
+		}
+		udelay(1);
+		reg = readl(cmd_rcgr);
+	}
+}
+
+void vco_enable(int enable)
+{
+	if (enable)
+	{
+		writel(0x1, DSIPHY_PLL_CTRL(0));
+		while (!(readl(DSIPHY_PLL_READY) & 0x01))
+			udelay(1);
+	} else {
+		writel(0x0, DSIPHY_PLL_CTRL(0));
+	}
+}
+
+void dsi_clock_enable(uint32_t dsiclk_rate, uint32_t byteclk_rate)
+{
+	uint32_t vcoclk_rate;
+	int ret;
+
+	ret = clk_get_set_enable("dsi_ahb_clk", 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set dsi_ahb_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = dsi_byte_clk_set(&vcoclk_rate, byteclk_rate);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set byteclk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = dsi_dsi_clk_set(vcoclk_rate, dsiclk_rate);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set dsiclk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	vco_enable(1);
+
+	dsi_setup_dividers(0x105, DSI_PCLK_CFG_RCGR, DSI_PCLK_CMD_RCGR);
+	dsi_setup_dividers(0x101, DSI_BYTE_CFG_RCGR, DSI_BYTE_CMD_RCGR);
+	dsi_setup_dividers(0x101, DSI_CFG_RCGR, DSI_CMD_RCGR);
+
+	ret = clk_get_set_enable("dsi_clk", 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set dsi_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = clk_get_set_enable("dsi_byte_clk", 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set dsi_byte_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = clk_get_set_enable("dsi_esc_clk", 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set dsi_esc_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = clk_get_set_enable("dsi_pclk_clk", 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set dsi_pclk_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = clk_get_set_enable("mdp_lcdc_clk" , 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set mdp_lcdc_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+
+	ret = clk_get_set_enable("mdp_dsi_clk" , 0, 1);
+	if(ret)
+	{
+		dprintf(CRITICAL, "failed to set mdp_dsi_clk ret = %d\n", ret);
+		ASSERT(0);
+	}
+}
+
+void dsi_clock_disable(void)
+{
+	clk_disable(clk_get("mdp_dsi_clk"));
+	clk_disable(clk_get("mdp_lcdc_clk"));
+	clk_disable(clk_get("dsi_pclk_clk"));
+	clk_disable(clk_get("dsi_esc_clk"));
+	clk_disable(clk_get("dsi_byte_clk"));
+	clk_disable(clk_get("dsi_clk"));
+	vco_enable(0);
+	clk_disable(clk_get("dsi_ahb_clk"));
+}
diff --git a/platform/msm8610/include/platform/clock.h b/platform/msm8610/include/platform/clock.h
index 1f37b03..de50978 100644
--- a/platform/msm8610/include/platform/clock.h
+++ b/platform/msm8610/include/platform/clock.h
@@ -32,13 +32,52 @@
 #include <clock.h>
 #include <clock_lib2.h>
 
+#define REG_MM(off)                     (MSM_MMSS_CLK_CTL_BASE + (off))
+
+#define VSYNC_CMD_RCGR                  REG_MM(0x2080)
+#define VSYNC_CFG_RCGR                  REG_MM(0x2084)
+#define AXI_CMD_RCGR                    REG_MM(0x5040)
+#define AXI_CFG_RCGR                    REG_MM(0x5044)
+
+#define MDP_AXI_CBCR                    REG_MM(0x2314)
+#define MDP_AHB_CBCR                    REG_MM(0x2318)
+#define MDP_VSYNC_CBCR                  REG_MM(0x231C)
+#define MDP_DSI_CBCR                    REG_MM(0x2320)
+#define MDP_LCDC_CBCR                   REG_MM(0x2340)
+
+#define MMSS_S0_AXI_CBCR                REG_MM(0x5064)
+#define MMSS_MMSSNOC_AXI_CBCR           REG_MM(0x506C)
+
+#define DSI_CBCR                        REG_MM(0x2324)
+#define DSI_BYTE_CBCR                   REG_MM(0x2328)
+#define DSI_ESC_CBCR                    REG_MM(0x232C)
+#define DSI_AHB_CBCR                    REG_MM(0x2330)
+#define DSI_PCLK_CBCR                   REG_MM(0x233C)
+
+#define DSI_CMD_RCGR                    REG_MM(0x2020)
+#define DSI_CFG_RCGR                    REG_MM(0x2024)
+#define DSI_PCLK_CMD_RCGR               REG_MM(0x2000)
+#define DSI_PCLK_CFG_RCGR               REG_MM(0x2004)
+#define DSI_BYTE_CMD_RCGR               REG_MM(0x2120)
+#define DSI_BYTE_CFG_RCGR               REG_MM(0x2124)
+
 #define UART_DM_CLK_RX_TX_BIT_RATE 0xCC
 
+#define VCO_MAX_DIVIDER		 256
+#define VCO_MIN_RATE       600000000
+#define VCO_MAX_RATE       1200000000
+#define VCO_PREF_DIV_RATIO 26
+#define VCO_PARENT_RATE    19200000
+
 void platform_clock_init(void);
 
 void clock_init_mmc(uint32_t interface);
 void clock_config_mmc(uint32_t interface, uint32_t freq);
 void clock_config_uart_dm(uint8_t id);
 void hsusb_clock_init(void);
+void mdp_clock_enable(void);
+void mdp_clock_disable(void);
+void dsi_clock_enable(uint32_t dsiclk_rate, uint32_t byteclk_rate);
+void dsi_clock_disable(void);
 
 #endif
diff --git a/platform/msm8610/include/platform/iomap.h b/platform/msm8610/include/platform/iomap.h
index 0c00cf4..79344d7 100644
--- a/platform/msm8610/include/platform/iomap.h
+++ b/platform/msm8610/include/platform/iomap.h
@@ -1,5 +1,8 @@
 /* Copyright (c) 2013, The Linux Foundation. All rights reserved.
  *
+ * Copyright (c) 2008, Google Inc.
+ * All rights reserved.
+ *
  * Redistribution and use in source and binary forms, with or without
  * modification, are permitted provided that the following conditions are
  * met:
@@ -42,6 +45,10 @@
 #define MSM_SHARED_IMEM_BASE        0xFE805000
 #define RESTART_REASON_ADDR         (MSM_SHARED_IMEM_BASE + 0x65C)
 
+#define BS_INFO_OFFSET              (0x6B0)
+#define BS_INFO_ADDR                (MSM_SHARED_IMEM_BASE + BS_INFO_OFFSET)
+#define MPM2_MPM_SLEEP_TIMETICK_COUNT_VAL    0xFC4A3000
+
 #define MSM_GIC_DIST_BASE           APPS_SS_BASE
 #define MSM_GIC_CPU_BASE            (APPS_SS_BASE + 0x2000)
 #define APPS_APCS_QTMR_AC_BASE      (APPS_SS_BASE + 0x00020000)
@@ -83,6 +90,105 @@
 #define GPIO_CONFIG_ADDR(x)         (TLMM_BASE_ADDR + 0x1000 + (x)*0x10)
 #define GPIO_IN_OUT_ADDR(x)         (TLMM_BASE_ADDR + 0x1004 + (x)*0x10)
 
+#define MSM_MMSS_CLK_CTL_BASE       0xFD8C0000
+
+/* DSI */
+#define MIPI_DSI_BASE               0xFDD00000
+#define MIPI_DSI0_BASE              MIPI_DSI_BASE
+#define MIPI_DSI1_BASE              MIPI_DSI_BASE
+#define REG_DSI(off)                (MIPI_DSI_BASE + (off))
+
+#define DSIPHY_REGULATOR_BASE       0x500
+#define DSIPHY_TIMING_BASE          0x440
+#define DSIPHY_CTRL_BASE            0x470
+#define DSIPHY_PLL_BASE             0x200
+#define DSIPHY_STRENGTH_BASE        0x480
+#define DSIPHY_CAL_SW_BASE          0x52C
+#define DSIPHY_CAL_HW_BASE          0x538
+
+/* Range 0 - 4 */
+#define DSIPHY_REGULATOR_CTRL(x)    REG_DSI(DSIPHY_REGULATOR_BASE + (x) * 4)
+/* Range 0 - 11 */
+#define DSIPHY_TIMING_CTRL(x)       REG_DSI(DSIPHY_TIMING_BASE + (x) * 4)
+/* Range 0 - 3 */
+#define DSIPHY_CTRL(x)              REG_DSI(DSIPHY_CTRL_BASE + (x) * 4)
+/* Range 0 - 2 */
+#define DSIPHY_STRENGTH_CTRL(x)     REG_DSI(DSIPHY_STRENGTH_BASE + (x) * 4)
+/* Range 0 - 19 */
+#define DSIPHY_PLL_CTRL(x)          REG_DSI(DSIPHY_PLL_BASE + (x) * 4)
+/* Range 0 - 2 */
+#define DSIPHY_CAL_SW_CFG(x)        REG_DSI(DSIPHY_CAL_SW_BASE + (x) * 4)
+/* Range 0 - 4 */
+#define DSIPHY_CAL_HW_CFG(x)        REG_DSI(DSIPHY_CAL_HW_BASE + (x) * 4)
+
+#define DSIPHY_REGULATOR_CAL_PWR_CFG REG_DSI(0x518)
+#define DSIPHY_CAL_HW_TRIGGER       REG_DSI(0x528)
+#define DSIPHY_SW_RESET             REG_DSI(0x128)
+#define DSIPHY_LANE_SWAP            REG_DSI(0x0ac)
+#define DSIPHY_PLL_READY            REG_DSI(0x280)
+
+/* MDP */
+#define MDP_BASE                    0xFD900000
+#define REG_MDP(off)                (MDP_BASE + (off))
+
+#define MDP_DMA_P_CONFIG            REG_MDP(0x90000)
+#define MDP_DMA_P_OUT_XY            REG_MDP(0x90010)
+#define MDP_DMA_P_SIZE              REG_MDP(0x90004)
+#define MDP_DMA_P_BUF_ADDR          REG_MDP(0x90008)
+#define MDP_DMA_P_BUF_Y_STRIDE      REG_MDP(0x9000C)
+
+#define MDP_DSI_VIDEO_EN                 REG_MDP(0xF0000)
+#define MDP_DSI_VIDEO_HSYNC_CTL          REG_MDP(0xF0004)
+#define MDP_DSI_VIDEO_VSYNC_PERIOD       REG_MDP(0xF0008)
+#define MDP_DSI_VIDEO_VSYNC_PULSE_WIDTH  REG_MDP(0xF000C)
+#define MDP_DSI_VIDEO_DISPLAY_HCTL       REG_MDP(0xF0010)
+#define MDP_DSI_VIDEO_DISPLAY_V_START    REG_MDP(0xF0014)
+#define MDP_DSI_VIDEO_DISPLAY_V_END      REG_MDP(0xF0018)
+#define MDP_DSI_VIDEO_BORDER_CLR         REG_MDP(0xF0028)
+#define MDP_DSI_VIDEO_HSYNC_SKEW         REG_MDP(0xF0030)
+#define MDP_DSI_VIDEO_CTL_POLARITY       REG_MDP(0xF0038)
+#define MDP_DSI_VIDEO_TEST_CTL           REG_MDP(0xF0034)
+
+#define MDP_DMA_P_START                REG_MDP(0x00044)
+#define MDP_DMA_S_START                REG_MDP(0x00048)
+#define MDP_DISP_INTF_SEL              REG_MDP(0x00038)
+#define MDP_MAX_RD_PENDING_CMD_CONFIG  REG_MDP(0x0004C)
+#define MDP_INTR_ENABLE                REG_MDP(0x00020)
+#define MDP_INTR_CLEAR                 REG_MDP(0x00028)
+#define MDP_DSI_CMD_MODE_ID_MAP        REG_MDP(0xF1000)
+#define MDP_DSI_CMD_MODE_TRIGGER_EN    REG_MDP(0XF1004)
+
+#define MDP_TEST_MODE_CLK           REG_MDP(0xF0000)
+#define MDP_INTR_STATUS             REG_MDP(0x00054)
+
+#define SOFT_RESET                  0x114
+#define CLK_CTRL                    0x118
+#define TRIG_CTRL                   0x080
+#define CTRL                        0x000
+#define COMMAND_MODE_DMA_CTRL       0x038
+#define ERR_INT_MASK0               0x108
+
+#define LANE_SWAP_CTL               0x0AC
+#define TIMING_CTL                  0x0C0
+
+#define VIDEO_MODE_ACTIVE_H         0x020
+#define VIDEO_MODE_ACTIVE_V         0x024
+#define VIDEO_MODE_TOTAL            0x028
+#define VIDEO_MODE_HSYNC            0x02C
+#define VIDEO_MODE_VSYNC            0x030
+#define VIDEO_MODE_VSYNC_VPOS       0x034
+
+#define DMA_CMD_OFFSET              0x044
+#define DMA_CMD_LENGTH              0x048
+
+#define INT_CTRL                    0x10C
+#define CMD_MODE_DMA_SW_TRIGGER     0x08C
+
+#define EOT_PACKET_CTRL             0x0C8
+#define MISR_VIDEO_CTRL             0x0A0
+#define VIDEO_MODE_CTRL             0x00C
+#define HS_TIMER_CTRL               0x0B8
+
 #define MPM2_MPM_CTRL_BASE          0xFC4A1000
 #define MPM2_MPM_PS_HOLD            0xFC4AB000
 
diff --git a/platform/msm8610/msm8610-clock.c b/platform/msm8610/msm8610-clock.c
index 4d13801..a9b13b8 100644
--- a/platform/msm8610/msm8610-clock.c
+++ b/platform/msm8610/msm8610-clock.c
@@ -1,4 +1,4 @@
-/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+/* Copyright (c) 2012-2013, The Linux Foundation. All rights reserved.
  *
  * Redistribution and use in source and binary forms, with or without
  * modification, are permitted provided that the following conditions are
@@ -270,6 +270,143 @@
 	},
 };
 
+/* Diplay related clock LUT */
+static struct clk_freq_tbl ftbl_mmss_axi_clk[] = {
+	F_MM(19200000,     cxo,     1,   0,   0),
+	F_MM(100000000,  gpll0,     6,   0,   0),
+	F_END
+};
+
+static struct clk_freq_tbl ftbl_mdss_vsync_clk[] = {
+	F_MM(19200000,    cxo,   1,   0,   0),
+	F_END
+};
+
+static struct rcg_clk vsync_clk_src = {
+	.cmd_reg  = (uint32_t *) VSYNC_CMD_RCGR,
+	.cfg_reg  = (uint32_t *) VSYNC_CFG_RCGR,
+	.set_rate = clock_lib2_rcg_set_rate_hid,
+	.freq_tbl = ftbl_mdss_vsync_clk,
+	.c        = {
+		.dbg_name = "vsync_clk_src",
+		.ops      = &clk_ops_rcg,
+	},
+};
+
+static struct rcg_clk axi_clk_src = {
+	.cmd_reg  = (uint32_t *) AXI_CMD_RCGR,
+	.cfg_reg  = (uint32_t *) AXI_CFG_RCGR,
+	.set_rate = clock_lib2_rcg_set_rate_hid,
+	.freq_tbl = ftbl_mmss_axi_clk,
+	.c        = {
+		.dbg_name = "axi_clk_src",
+		.ops      = &clk_ops_rcg,
+	},
+};
+
+static struct branch_clk mdp_ahb_clk = {
+	.cbcr_reg    = (uint32_t *) MDP_AHB_CBCR,
+	.has_sibling = 1,
+	.c           = {
+		.dbg_name = "mdp_ahb_clk",
+		.ops      = &clk_ops_branch,
+	},
+};
+
+static struct branch_clk mdp_axi_clk = {
+	.cbcr_reg    = (uint32_t *) MDP_AXI_CBCR,
+	.parent      = &axi_clk_src.c,
+	.c           = {
+		.dbg_name = "mdp_axi_clk",
+		.ops      = &clk_ops_branch,
+	},
+};
+
+static struct branch_clk mdp_dsi_clk = {
+	.cbcr_reg    = (uint32_t *) MDP_DSI_CBCR,
+	.c           = {
+		.dbg_name = "mdp_dsi_clk",
+		.ops      = &clk_ops_branch,
+	},
+};
+
+static struct branch_clk mmss_mmssnoc_axi_clk = {
+	.cbcr_reg    = (uint32_t *) MMSS_MMSSNOC_AXI_CBCR,
+	.parent      = &axi_clk_src.c,
+	.c           = {
+		.dbg_name = "mmss_mmssnoc_axi_clk",
+		.ops      = &clk_ops_branch,
+	},
+};
+
+static struct branch_clk mmss_s0_axi_clk = {
+	.cbcr_reg    = (uint32_t *) MMSS_S0_AXI_CBCR,
+	.parent      = &axi_clk_src.c,
+	.c           = {
+		.dbg_name = "mmss_s0_axi_clk",
+		.ops      = &clk_ops_branch,
+	},
+};
+
+static struct branch_clk mdp_vsync_clk = {
+	.cbcr_reg    = MDP_VSYNC_CBCR,
+	.parent      = &vsync_clk_src.c,
+	.c           = {
+		.dbg_name = "mdp_vsync_clk",
+		.ops      = &clk_ops_branch,
+	},
+};
+
+static struct branch_clk mdp_lcdc_clk = {
+	.cbcr_reg    = MDP_LCDC_CBCR,
+	.parent      = &axi_clk_src.c,
+	.c           = {
+		.dbg_name = "mdp_lcdc_clk",
+		.ops      = &clk_ops_branch,
+	},
+};
+
+static struct branch_clk dsi_clk = {
+	.cbcr_reg = DSI_CBCR,
+	.c = {
+		.dbg_name = "dsi_clk",
+		.ops = &clk_ops_branch,
+	},
+};
+
+static struct branch_clk dsi_ahb_clk = {
+	.cbcr_reg = DSI_AHB_CBCR,
+	.has_sibling = 1,
+	.c = {
+		.dbg_name = "dsi_ahb_clk",
+		.ops = &clk_ops_branch,
+	},
+};
+
+static struct branch_clk dsi_byte_clk = {
+	.cbcr_reg = DSI_BYTE_CBCR,
+	.c = {
+		.dbg_name = "dsi_byte_clk",
+		.ops = &clk_ops_branch,
+	},
+};
+
+static struct branch_clk dsi_esc_clk = {
+	.cbcr_reg = DSI_ESC_CBCR,
+	.c = {
+		.dbg_name = "dsi_esc_clk",
+		.ops = &clk_ops_branch,
+	},
+};
+
+static struct branch_clk dsi_pclk_clk = {
+	.cbcr_reg = DSI_PCLK_CBCR,
+	.c = {
+		.dbg_name = "dsi_pclk_clk",
+		.ops = &clk_ops_branch,
+	},
+};
+
 /* Clock lookup table */
 static struct clk_lookup msm_clocks_8610[] =
 {
@@ -281,6 +418,21 @@
 
 	CLK_LOOKUP("usb_iface_clk",  gcc_usb_hs_ahb_clk.c),
 	CLK_LOOKUP("usb_core_clk",   gcc_usb_hs_system_clk.c),
+
+	CLK_LOOKUP("axi_clk_src",          axi_clk_src.c),
+	CLK_LOOKUP("mmss_mmssnoc_axi_clk", mmss_mmssnoc_axi_clk.c),
+	CLK_LOOKUP("mmss_s0_axi_clk",      mmss_s0_axi_clk.c),
+	CLK_LOOKUP("mdp_axi_clk",          mdp_axi_clk.c),
+	CLK_LOOKUP("mdp_dsi_clk",          mdp_dsi_clk.c),
+	CLK_LOOKUP("mdp_vsync_clk",        mdp_vsync_clk.c),
+	CLK_LOOKUP("mdp_lcdc_clk",         mdp_lcdc_clk.c),
+	CLK_LOOKUP("mdp_ahb_clk",          mdp_ahb_clk.c),
+
+	CLK_LOOKUP("dsi_clk",              dsi_clk.c),
+	CLK_LOOKUP("dsi_ahb_clk",          dsi_ahb_clk.c),
+	CLK_LOOKUP("dsi_byte_clk",         dsi_byte_clk.c),
+	CLK_LOOKUP("dsi_esc_clk",          dsi_esc_clk.c),
+	CLK_LOOKUP("dsi_pclk_clk",         dsi_pclk_clk.c),
 };
 
 void platform_clock_init(void)
diff --git a/platform/msm8610/platform.c b/platform/msm8610/platform.c
index ac74205..e4dad94 100644
--- a/platform/msm8610/platform.c
+++ b/platform/msm8610/platform.c
@@ -36,6 +36,7 @@
 #include <arch/arm/mmu.h>
 #include <smem.h>
 #include <board.h>
+#include <boot_stats.h>
 
 #define MB (1024*1024)
 
@@ -76,8 +77,22 @@
 	dprintf(INFO, "platform_init()\n");
 }
 
+uint32_t platform_get_sclk_count(void)
+{
+	return readl(MPM2_MPM_SLEEP_TIMETICK_COUNT_VAL);
+}
+
+addr_t get_bs_info_addr()
+{
+	return ((addr_t)BS_INFO_ADDR);
+}
+
 void platform_uninit(void)
 {
+#if DISPLAY_SPLASH_SCREEN
+	display_shutdown();
+#endif
+
 	qtimer_uninit();
 }
 
diff --git a/platform/msm8610/rules.mk b/platform/msm8610/rules.mk
index 2aa5109..b050c3d 100644
--- a/platform/msm8610/rules.mk
+++ b/platform/msm8610/rules.mk
@@ -15,6 +15,9 @@
 
 INCLUDES += -I$(LOCAL_DIR)/include -I$(LK_TOP_DIR)/platform/msm_shared/include
 
+DEV += fbcon
+MODULES += dev/fbcon
+
 OBJS += \
 	$(LOCAL_DIR)/platform.o \
 	$(LOCAL_DIR)/acpuclock.o \
diff --git a/platform/msm8974/acpuclock.c b/platform/msm8974/acpuclock.c
index 4b1798f..6131e61 100644
--- a/platform/msm8974/acpuclock.c
+++ b/platform/msm8974/acpuclock.c
@@ -340,17 +340,18 @@
 	uint32_t reg = 0;
 	reg = readl(MDP_GDSCR);
 	if (enable) {
-		if (reg & 0x1) {
+		if (!(reg & GDSC_POWER_ON_BIT)) {
 			reg &=  ~(BIT(0) | GDSC_EN_FEW_WAIT_MASK);
 			reg |= GDSC_EN_FEW_WAIT_256_MASK;
 			writel(reg, MDP_GDSCR);
+			while(!(readl(MDP_GDSCR) & (GDSC_POWER_ON_BIT)));
+		} else {
+			dprintf(INFO, "MDP GDSC already enabled\n");
 		}
-
-		while(readl(MDP_GDSCR) & ((GDSC_POWER_ON_BIT) | (GDSC_POWER_ON_STATUS_BIT)));
 	} else {
-		reg &= ~BIT(0);
+		reg |= BIT(0);
 		writel(reg, MDP_GDSCR);
-		while(!(readl(MDP_GDSCR) & ((GDSC_POWER_ON_BIT))));
+		while(readl(MDP_GDSCR) & (GDSC_POWER_ON_BIT));
 	}
 }
 
diff --git a/platform/msm8974/include/platform/iomap.h b/platform/msm8974/include/platform/iomap.h
index 02a59bc..799fc86 100644
--- a/platform/msm8974/include/platform/iomap.h
+++ b/platform/msm8974/include/platform/iomap.h
@@ -174,6 +174,34 @@
 #define MDP_BASE                    (0xfd900000)
 #define REG_MDP(off)                (MDP_BASE + (off))
 
+#define SOFT_RESET                  0x118
+#define CLK_CTRL                    0x11C
+#define TRIG_CTRL                   0x084
+#define CTRL                        0x004
+#define COMMAND_MODE_DMA_CTRL       0x03C
+#define ERR_INT_MASK0               0x10C
+
+#define LANE_SWAP_CTL               0x0B0
+#define TIMING_CTL                  0x0C4
+
+#define VIDEO_MODE_ACTIVE_H         0x024
+#define VIDEO_MODE_ACTIVE_V         0x028
+#define VIDEO_MODE_TOTAL            0x02C
+#define VIDEO_MODE_HSYNC            0x030
+#define VIDEO_MODE_VSYNC            0x034
+#define VIDEO_MODE_VSYNC_VPOS       0x038
+
+#define DMA_CMD_OFFSET              0x048
+#define DMA_CMD_LENGTH              0x04C
+
+#define INT_CTRL                    0x110
+#define CMD_MODE_DMA_SW_TRIGGER     0x090
+
+#define EOT_PACKET_CTRL             0x0C8
+#define MISR_VIDEO_CTRL             0x0A4
+#define VIDEO_MODE_CTRL             0x010
+#define HS_TIMER_CTRL               0x0BC
+
 /* DRV strength for sdcc */
 #define SDC1_HDRV_PULL_CTL           (TLMM_BASE_ADDR + 0x00002044)
 
diff --git a/platform/msm_shared/board.c b/platform/msm_shared/board.c
index dcc750d..3e93888 100644
--- a/platform/msm_shared/board.c
+++ b/platform/msm_shared/board.c
@@ -103,6 +103,20 @@
 		board.platform_hw = board_info_v8.board_info_v3.hw_platform;
 		board.platform_subtype = board_info_v8.platform_subtype;
 
+		/*
+		* fill in board.target with variant_id information
+		*                 bit no |31  24 | 23   16| 15   8 |7         0|
+		*          board.target =|subtype| major  | minor  |hw_platform|
+		* Have QRD board.target =| OEM   | EVT/DVT|Reserved| QRD        |
+		*
+		*/
+		if (board_info_v8.board_info_v3.hw_platform == HW_PLATFORM_QRD) {
+			board.target = (((board_info_v8.platform_subtype & 0xff) << 24) |
+					(((board_info_v8.platform_version >> 16) & 0xff) << 16) |
+					((board_info_v8.platform_version & 0xff) << 8) |
+					((board_info_v8.board_info_v3.hw_platform & 0xff) << 0));
+		}
+
 		for (i = 0; i < SMEM_V8_SMEM_MAX_PMIC_DEVICES; i++) {
 			board.pmic_info[i].pmic_type = board_info_v8.pmic_info[i].pmic_type;
 			board.pmic_info[i].pmic_version = board_info_v8.pmic_info[i].pmic_version;
diff --git a/platform/msm_shared/dev_tree.c b/platform/msm_shared/dev_tree.c
index de5384b..ee0582d 100644
--- a/platform/msm_shared/dev_tree.c
+++ b/platform/msm_shared/dev_tree.c
@@ -134,13 +134,31 @@
 	return 0;
 }
 
-/* Function to obtain the index information for the correct device tree
- *  based on the platform data.
- *  If a matching device tree is found, the information is returned in the
- *  "dt_entry_info" out parameter and a function value of 0 is returned, otherwise
- *  a non-zero function value is returned.
- */
-int dev_tree_get_entry_info(struct dt_table *table, struct dt_entry *dt_entry_info)
+static int platform_dt_match(struct dt_entry *cur_dt_entry, uint32_t target_variant_id, uint32_t subtype_mask)
+{
+	/* 1. must match the platform_id, hardware_id, platform_version
+	*  2. soc rev number equal then return 0
+	*  3. dt soc rev number less than cdt return -1
+	*  4. otherwise return 1
+	*/
+	uint32_t cur_dt_target_id ;
+
+	cur_dt_target_id  = cur_dt_entry->variant_id | ((cur_dt_entry->board_hw_subtype & subtype_mask & 0xff) << 24);
+
+	if((cur_dt_entry->platform_id == board_platform_id()) &&
+		(cur_dt_target_id == target_variant_id)) {
+		if(cur_dt_entry->soc_rev == board_soc_version()) {
+			return 0;
+		} else if(cur_dt_entry->soc_rev < board_soc_version()) {
+			return -1;
+		}
+	}
+
+	return 1;
+}
+
+static int __dev_tree_get_entry_info(struct dt_table *table, struct dt_entry *dt_entry_info,
+										uint32_t target_variant_id, uint32_t subtype_mask)
 {
 	uint32_t i;
 	unsigned char *table_ptr;
@@ -149,6 +167,7 @@
 	struct dt_entry *cur_dt_entry;
 	struct dt_entry *best_match_dt_entry;
 	struct dt_entry_v1 *dt_entry_v1;
+	uint32_t found = 0;
 
 	if (!dt_entry_info) {
 		dprintf(CRITICAL, "ERROR: Bad parameter passed to %s \n",
@@ -160,7 +179,7 @@
 	cur_dt_entry = &dt_entry_buf_1;
 	best_match_dt_entry = NULL;
 
-	for(i = 0; i < table->num_entries; i++)
+	for(i = 0; found == 0 && i < table->num_entries; i++)
 	{
 		memset(cur_dt_entry, 0, sizeof(struct dt_entry));
 		switch(table->version) {
@@ -190,37 +209,79 @@
 		 * we pickup the DTB with highest soc rev number which is less
 		 * than or equal to actual hardware
 		 */
-		if((cur_dt_entry->platform_id == board_platform_id()) &&
-		   (cur_dt_entry->variant_id == board_hardware_id()) &&
-		   (cur_dt_entry->board_hw_subtype == board_hardware_subtype()))
-		{
-			if(cur_dt_entry->soc_rev == board_soc_version()) {
+		switch(platform_dt_match(cur_dt_entry, target_variant_id, subtype_mask)) {
+		case 0:
+			best_match_dt_entry = cur_dt_entry;
+			found = 1;
+			break;
+		case -1:
+			if (!best_match_dt_entry) {
 				/* copy structure */
-				*dt_entry_info = *cur_dt_entry;
-				return 0;
-			} else if (cur_dt_entry->soc_rev < board_soc_version()){
-				/* Keep this as the next best candidate. */
-				if (!best_match_dt_entry) {
-					best_match_dt_entry = cur_dt_entry;
-					cur_dt_entry = &dt_entry_buf_2;
-				} else {
-					/* Swap dt_entry buffers */
-					struct dt_entry *temp = cur_dt_entry;
-					cur_dt_entry = best_match_dt_entry;
-					best_match_dt_entry = temp;
-				}
+				best_match_dt_entry = cur_dt_entry;
+				cur_dt_entry = &dt_entry_buf_2;
+			} else {
+				/* Swap dt_entry buffers */
+				struct dt_entry *temp = cur_dt_entry;
+				cur_dt_entry = best_match_dt_entry;
+				best_match_dt_entry = temp;
 			}
+		default:
+			break;
 		}
 	}
 
 	if (best_match_dt_entry) {
 		*dt_entry_info = *best_match_dt_entry;
+		found = 1;
+	}
+
+	if (found != 0) {
+		dprintf(INFO, "Using DTB entry %u/%08x/%u/%u for device %u/%08x/%u/%u\n",
+				dt_entry_info->platform_id, dt_entry_info->soc_rev,
+				dt_entry_info->variant_id, dt_entry_info->board_hw_subtype,
+				board_platform_id(), board_soc_version(),
+				board_hardware_id(), board_hardware_subtype());
 		return 0;
 	}
 
+	dprintf(CRITICAL, "ERROR: Unable to find suitable device tree for device (%u/0x%08x/%u/%u)\n",
+			board_platform_id(), board_soc_version(),
+			board_hardware_id(), board_hardware_subtype());
 	return -1;
 }
 
+/* Function to obtain the index information for the correct device tree
+ *  based on the platform data.
+ *  If a matching device tree is found, the information is returned in the
+ *  "dt_entry_info" out parameter and a function value of 0 is returned, otherwise
+ *  a non-zero function value is returned.
+ */
+int dev_tree_get_entry_info(struct dt_table *table, struct dt_entry *dt_entry_info)
+{
+	uint32_t target_variant_id;
+
+	if(board_hardware_id() == HW_PLATFORM_QRD) {
+		target_variant_id = board_target_id();
+		if (__dev_tree_get_entry_info(table, dt_entry_info, target_variant_id, 0xff) == 0) {
+			return 0;
+		}
+	}
+	/*
+	* for compatible with version 1 and version 2 dtbtool
+	* will compare the subtype inside the variant id
+	*/
+	target_variant_id = board_hardware_id() | ((board_hardware_subtype() & 0xff) << 24);
+	if (__dev_tree_get_entry_info(table, dt_entry_info, target_variant_id, 0xff) == 0) {
+		return 0;
+	}
+
+	/*
+	* add compatible with old device selection method which don't compare subtype
+	*/
+	target_variant_id = board_hardware_id();
+	return __dev_tree_get_entry_info(table, dt_entry_info, target_variant_id, 0);
+}
+
 /* Function to add the first RAM partition info to the device tree.
  * Note: The function replaces the reg property in the "/memory" node
  * with the addr and size provided.
@@ -362,3 +423,4 @@
 
 	return ret;
 }
+
diff --git a/platform/msm_shared/display.c b/platform/msm_shared/display.c
old mode 100644
new mode 100755
index c6d02c4..026142c
--- a/platform/msm_shared/display.c
+++ b/platform/msm_shared/display.c
@@ -73,6 +73,7 @@
 int msm_display_config()
 {
 	int ret = NO_ERROR;
+	int mdp_rev;
 	struct msm_panel_info *pinfo;
 
 	if (!panel)
@@ -93,7 +94,8 @@
 	case MIPI_VIDEO_PANEL:
 		dprintf(INFO, "Config MIPI_VIDEO_PANEL.\n");
 
-		if (mdp_get_revision() == MDP_REV_50)
+		mdp_rev = mdp_get_revision();
+		if (mdp_rev == MDP_REV_50 || mdp_rev == MDP_REV_304)
 			ret = mdss_dsi_config(panel);
 		else
 			ret = mipi_config(panel);
@@ -236,6 +238,10 @@
 	if (pdata->clk_func)
 		ret = pdata->clk_func(1);
 
+	/* Only enabled for auto PLL calculation */
+	if (pdata->pll_clk_func)
+		ret = pdata->pll_clk_func(1, &(panel->panel_info));
+
 	if (ret)
 		goto msm_display_init_out;
 
@@ -310,6 +316,10 @@
 	if (panel->clk_func)
 		ret = panel->clk_func(0);
 
+	/* Only for AUTO PLL calculation */
+	if (panel->pll_clk_func)
+		ret = panel->pll_clk_func(0, pinfo);
+
 	if (ret)
 		goto msm_display_off_out;
 
diff --git a/platform/msm_shared/include/mipi_dsi.h b/platform/msm_shared/include/mipi_dsi.h
old mode 100644
new mode 100755
index 55f39e4..6a00efa
--- a/platform/msm_shared/include/mipi_dsi.h
+++ b/platform/msm_shared/include/mipi_dsi.h
@@ -39,34 +39,6 @@
 #define DSI_SOFT_RESET                        REG_DSI(0x114)
 #define DSI_CAL_CTRL                          REG_DSI(0x0F4)
 
-#define SOFT_RESET                            0x118
-#define CLK_CTRL                              0x11C
-#define TRIG_CTRL                             0x084
-#define CTRL                                  0x004
-#define COMMAND_MODE_DMA_CTRL                 0x03C
-#define ERR_INT_MASK0                         0x10C
-
-#define LANE_SWAP_CTL                         0x0B0
-#define TIMING_CTL                            0x0C4
-
-#define VIDEO_MODE_ACTIVE_H                   0x024
-#define VIDEO_MODE_ACTIVE_V                   0x028
-#define VIDEO_MODE_TOTAL                      0x02C
-#define VIDEO_MODE_HSYNC                      0x030
-#define VIDEO_MODE_VSYNC                      0x034
-#define VIDEO_MODE_VSYNC_VPOS                 0x038
-
-#define DMA_CMD_OFFSET                        0x048
-#define DMA_CMD_LENGTH                        0x04C
-
-#define INT_CTRL                              0x110
-#define CMD_MODE_DMA_SW_TRIGGER               0x090
-
-#define EOT_PACKET_CTRL                       0x0C8
-#define MISR_VIDEO_CTRL                       0x0A4
-#define VIDEO_MODE_CTRL                       0x010
-#define HS_TIMER_CTRL                         0x0BC
-
 #define DSIPHY_SW_RESET                       REG_DSI(0x128)
 #define DSIPHY_PLL_RDY                        REG_DSI(0x280)
 #define DSIPHY_REGULATOR_CAL_PWR_CFG          REG_DSI(0x518)
@@ -669,6 +641,21 @@
 	char laneCfg[45];
 };
 
+typedef struct mdss_dsi_pll_config {
+	uint32_t  pixel_clock;
+	uint32_t  pixel_clock_mhz;
+	uint32_t  byte_clock;
+	uint32_t  bit_clock;
+	uint32_t  halfbit_clock;
+	uint32_t  vco_clock;
+	uint8_t   directpath;
+	uint8_t   posdiv1;
+	uint8_t   posdiv3;
+	uint8_t   pclk_m;
+	uint8_t   pclk_n;
+	uint8_t   pclk_d;
+};
+
 struct mipi_dsi_cmd {
 	int size;
 	char *payload;
@@ -966,6 +953,15 @@
 #define DSI_CMD_TRIGGER_SW_SEOF		0x05	/* cmd dma only */
 #define DSI_CMD_TRIGGER_SW_TE		0x06
 
+#define DSI_DATALANE_SWAP_0123 0
+#define DSI_DATALANE_SWAP_3012 1
+#define DSI_DATALANE_SWAP_2301 2
+#define DSI_DATALANE_SWAP_1230 3
+#define DSI_DATALANE_SWAP_0321 4
+#define DSI_DATALANE_SWAP_1032 5
+#define DSI_DATALANE_SWAP_2103 6
+#define DSI_DATALANE_SWAP_3210 7
+
 int mipi_config(struct msm_fb_panel_data *panel);
 int mdss_dsi_config(struct msm_fb_panel_data *panel);
 
diff --git a/platform/msm_shared/include/msm_panel.h b/platform/msm_shared/include/msm_panel.h
old mode 100644
new mode 100755
index 8185a0f..22a47ad
--- a/platform/msm_shared/include/msm_panel.h
+++ b/platform/msm_shared/include/msm_panel.h
@@ -55,6 +55,7 @@
 	MDP_REV_22,
 	MDP_REV_30,
 	MDP_REV_303,
+	MDP_REV_304,
 	MDP_REV_31,
 	MDP_REV_40,
 	MDP_REV_41,
@@ -106,6 +107,8 @@
 struct mipi_panel_info {
 	char mode;		/* video/cmd */
 	char interleave_mode;
+	int eof_bllp_power;
+	uint32_t bitclock;
 	char crc_check;
 	char ecc_check;
 	char dst_format;	/* shared by video and command */
@@ -126,6 +129,7 @@
 	char vc;	/* virtual channel */
 	struct mipi_dsi_phy_ctrl *dsi_phy_db;
 	struct mdss_dsi_phy_ctrl *mdss_dsi_phy_db;
+	struct mdss_dsi_pll_config *dsi_pll_config;
 	struct mipi_dsi_cmd *panel_cmds;
 	int num_of_panel_cmds;
 	/* video mode */
@@ -174,6 +178,9 @@
 	uint32_t type;
 	uint32_t wait_cycle;
 	uint32_t clk_rate;
+	uint32_t rotation;
+	uint32_t broadcastmode;
+	char     lowpowerstop;
 
 	struct lcd_panel_info lcd;
 	struct lcdc_panel_info lcdc;
@@ -197,6 +204,7 @@
 	/* function entry chain */
 	int (*power_func) (int enable);
 	int (*clk_func) (int enable);
+	int (*pll_clk_func) (int enable, struct msm_panel_info *);
 };
 
 
diff --git a/platform/msm_shared/mdp5.c b/platform/msm_shared/mdp5.c
index 690c955..e86c8df 100644
--- a/platform/msm_shared/mdp5.c
+++ b/platform/msm_shared/mdp5.c
@@ -59,13 +59,10 @@
 	uint32_t mdss_mdp_intf_off;
 	uint32_t mdss_mdp_rev = readl(MDP_HW_REV);
 
-	if (mdss_mdp_rev ==  MDSS_MDP_HW_REV_100
-		|| mdss_mdp_rev ==  MDSS_MDP_HW_REV_102)
+	if (mdss_mdp_rev >= MDSS_MDP_HW_REV_102)
 		mdss_mdp_intf_off = 0;
-	else if (mdss_mdp_rev ==  MDSS_MDP_HW_REV_101)
-		mdss_mdp_intf_off = 0xEC00;
 	else
-		mdss_mdp_intf_off = 0;
+		mdss_mdp_intf_off = 0xEC00;
 
 	return mdss_mdp_intf_off;
 }
@@ -131,7 +128,7 @@
 		writel(0x1, VBIF_VBIF_DDR_FORCE_CLK_ON);
 
 		if (mdp_hw_rev == MDSS_MDP_HW_REV_100
-			|| mdp_hw_rev == MDSS_MDP_HW_REV_102) {
+			|| mdp_hw_rev >= MDSS_MDP_HW_REV_102) {
 			/* Configure DDR burst length */
 			writel(0x00000707, VBIF_VBIF_DDR_OUT_MAX_BURST);
 			writel(0x00000030, VBIF_VBIF_DDR_ARB_CTRL );
@@ -140,7 +137,7 @@
 			writel(0x0FFF0FFF, VBIF_VBIF_DDR_OUT_AX_AOOO);
 			writel(0x22222222, VBIF_VBIF_DDR_AXI_AMEMTYPE_CONF0);
 			writel(0x00002222, VBIF_VBIF_DDR_AXI_AMEMTYPE_CONF1);
-		} else if (mdp_hw_rev == MDSS_MDP_HW_REV_101) {
+		} else if (mdp_hw_rev >= MDSS_MDP_HW_REV_101) {
 			writel(0x00000707, VBIF_VBIF_DDR_OUT_MAX_BURST);
 			writel(0x00000003, VBIF_VBIF_DDR_ARB_CTRL);
 		}
@@ -158,12 +155,11 @@
 	xres = pinfo->xres;
 	bpp = pinfo->bpp;
 
-	if (mdss_mdp_rev == MDSS_MDP_HW_REV_101) {
-		rgb0_client_id = MMSS_MDP_1_1_CLIENT_ID_RGB0;
-	} else if (mdss_mdp_rev == MDSS_MDP_HW_REV_100
-		|| mdss_mdp_rev == MDSS_MDP_HW_REV_102) {
+	if (mdss_mdp_rev == MDSS_MDP_HW_REV_100
+		|| mdss_mdp_rev >= MDSS_MDP_HW_REV_102)
 		rgb0_client_id = MMSS_MDP_1_2_CLIENT_ID_RGB0;
-	}
+	else if (mdss_mdp_rev >= MDSS_MDP_HW_REV_101)
+		rgb0_client_id = MMSS_MDP_1_1_CLIENT_ID_RGB0;
 
 	if (pinfo->lcdc.dual_pipe) {
 		/* Each pipe driving half the screen */
diff --git a/platform/msm_shared/mipi_dsi.c b/platform/msm_shared/mipi_dsi.c
index 1a45097..bbda314 100644
--- a/platform/msm_shared/mipi_dsi.c
+++ b/platform/msm_shared/mipi_dsi.c
@@ -121,6 +121,7 @@
 	uint32_t count = 0;
 	int status = 0;
 
+#if (DISPLAY_TYPE_MDSS == 1)
 	writel(0x03030303, MIPI_DSI0_BASE + INT_CTRL);
 	writel(0x1, MIPI_DSI0_BASE + CMD_MODE_DMA_SW_TRIGGER);
 	dsb();
@@ -144,6 +145,7 @@
 	writel((readl(MIPI_DSI1_BASE + INT_CTRL) | 0x01000001),
 			MIPI_DSI1_BASE + INT_CTRL);
 	dprintf(SPEW, "Panel CMD: command mode dma tested successfully\n");
+#endif
 	return status;
 }
 
@@ -181,6 +183,7 @@
 	char pload[256];
 	uint32_t off;
 
+#if (DISPLAY_TYPE_MDSS == 1)
 	/* Align pload at 8 byte boundry */
 	off = pload;
 	off &= 0x07;
@@ -200,6 +203,7 @@
 		udelay(80);
 		cm++;
 	}
+#endif
 	return ret;
 }
 
@@ -336,6 +340,7 @@
 	uint8_t lane_swap = 0;
 	uint32_t timing_ctl = 0;
 
+#if (DISPLAY_TYPE_MDSS == 1)
 	switch (pinfo->num_of_lanes) {
 	default:
 	case 1:
@@ -401,10 +406,10 @@
 					pinfo->num_of_panel_cmds);
 		}
 	}
+#endif
 	return status;
 }
 
-
 int mipi_dsi_panel_initialize(struct mipi_dsi_panel_config *pinfo)
 {
 	uint8_t DMA_STREAM1 = 0;	// for mdp display processor path
@@ -743,7 +748,7 @@
 	}
 
 	/* Enable MMSS_AHB_ARB_MATER_PORT_E for arbiter master0 and master 1 request */
-#if (!DISPLAY_MIPI_PANEL_RENESAS && !DISPLAY_TYPE_DSI6G)
+#if (!DISPLAY_MIPI_PANEL_RENESAS && !DISPLAY_TYPE_DSI6G && !DISPLAY_TYPE_8610)
 	writel(0x00001800, MMSS_SFPB_GPREG);
 #endif
 
@@ -790,7 +795,7 @@
 
 	/* Enable MMSS_AHB_ARB_MATER_PORT_E for
 	   arbiter master0 and master 1 request */
-#if (!DISPLAY_MIPI_PANEL_RENESAS && !DISPLAY_TYPE_DSI6G)
+#if (!DISPLAY_MIPI_PANEL_RENESAS && !DISPLAY_TYPE_DSI6G && !DISPLAY_TYPE_8610)
 	writel(0x00001800, MMSS_SFPB_GPREG);
 #endif
 
@@ -822,9 +827,9 @@
 	uint8_t interleav,
 	uint32_t ctl_base)
 {
-
 	int status = 0;
 
+#if (DISPLAY_TYPE_MDSS == 1)
 	/* disable mdp first */
 	mdp_disable();
 
@@ -890,6 +895,7 @@
 
 	writel(interleav << 30 | 0 << 24 | 0 << 20 | lane_en << 4
 			| 0x103, ctl_base + CTRL);
+#endif
 
 	return status;
 }
@@ -900,6 +906,7 @@
 	struct msm_panel_info *pinfo;
 	struct mipi_dsi_panel_config mipi_pinfo;
 
+#if (DISPLAY_TYPE_MDSS == 1)
 	if (!panel)
 		return ERR_INVALID_ARGS;
 
@@ -922,6 +929,7 @@
 
 	if (pinfo->rotate && panel->rotate)
 		pinfo->rotate();
+#endif
 
 	return ret;
 }
@@ -1036,6 +1044,7 @@
 	uint8_t ystride = 0x03;
 	// disable mdp first
 
+#if (DISPLAY_TYPE_MDSS == 1)
 	writel(0x00000000, DSI_CLK_CTRL);
 	writel(0x00000000, DSI_CLK_CTRL);
 	writel(0x00000000, DSI_CLK_CTRL);
@@ -1075,6 +1084,7 @@
 	       DSI_CTRL);
 	writel(0x10000000, DSI_COMMAND_MODE_DMA_CTRL);
 	writel(0x10000000, DSI_MISR_CMD_CTRL);
+#endif
 
 	return NO_ERROR;
 }
@@ -1171,8 +1181,6 @@
 	{
 		writel(0, DSI_CLK_CTRL);
 		writel(0x1F1, DSI_CTRL);
-		writel(0x00000001, DSIPHY_SW_RESET);
-		writel(0x00000000, DSIPHY_SW_RESET);
 		mdelay(10);
 		writel(0x0001, DSI_SOFT_RESET);
 		writel(0x0000, DSI_SOFT_RESET);
diff --git a/platform/msm_shared/mipi_dsi_autopll.c b/platform/msm_shared/mipi_dsi_autopll.c
new file mode 100755
index 0000000..e6bac4e
--- /dev/null
+++ b/platform/msm_shared/mipi_dsi_autopll.c
@@ -0,0 +1,382 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ *
+ */
+#include <debug.h>
+#include <reg.h>
+#include <err.h>
+#include <smem.h>
+#include <mipi_dsi.h>
+#include <platform/iomap.h>
+
+#define LPFR_LUT_SIZE 10
+
+#define VCO_REF_CLOCK_RATE 19200000
+
+#define FRAC_DIVIDER 10000
+
+typedef struct lpfr_cfg {
+	uint32_t vco_rate;
+	uint8_t  resistance;
+};
+
+static struct lpfr_cfg lpfr_lut[LPFR_LUT_SIZE] = {
+		{479500000, 8},
+		{480000000, 11},
+		{575500000, 8},
+		{576000000, 12},
+		{610500000, 8},
+		{659500000, 9},
+		{671500000, 10},
+		{672000000, 14},
+		{708500000, 10},
+		{750000000, 11},
+	};
+
+uint64_t div_s64(uint64_t dividend, uint32_t divisor, uint32_t *remainder)
+{
+	*remainder = dividend % divisor;
+
+	return dividend / divisor;
+}
+
+static uint32_t dsi_pll_enable_seq_m(void)
+{
+	uint32_t i = 0;
+	uint32_t pll_locked = 0;
+
+	mdss_dsi_uniphy_pll_sw_reset(MIPI_DSI_BASE);
+
+	/*
+	 * Add hardware recommended delays between register writes for
+	 * the updates to take effect. These delays are necessary for the
+	 * PLL to successfully lock
+	 */
+	writel(0x01, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x05, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x0f, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(1000);
+
+	mdss_dsi_uniphy_pll_lock_detect_setting(MIPI_DSI_BASE);
+	pll_locked = readl(MIPI_DSI_BASE + 0x02c0) & 0x01;
+	for (i = 0; (i < 4) && !pll_locked; i++) {
+		writel(0x07, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+		if (i != 0)
+			writel(0x34, MIPI_DSI_BASE + 0x00270); /* CAL CFG1*/
+		udelay(1);
+		writel(0x0f, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+		udelay(1000);
+		mdss_dsi_uniphy_pll_lock_detect_setting(MIPI_DSI_BASE);
+		pll_locked = readl(MIPI_DSI_BASE + 0x02c0) & 0x01;
+	}
+
+	return pll_locked;
+}
+
+static uint32_t dsi_pll_enable_seq_d(void)
+{
+	uint32_t pll_locked = 0;
+
+	mdss_dsi_uniphy_pll_sw_reset(MIPI_DSI_BASE);
+
+	/*
+	 * Add hardware recommended delays between register writes for
+	 * the updates to take effect. These delays are necessary for the
+	 * PLL to successfully lock
+	 */
+	writel(0x01, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x05, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x07, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x05, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x07, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x0f, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(1000);
+
+	mdss_dsi_uniphy_pll_lock_detect_setting(MIPI_DSI_BASE);
+	pll_locked = readl(MIPI_DSI_BASE + 0x02c0) & 0x01;
+
+	return pll_locked;
+}
+
+static uint32_t dsi_pll_enable_seq_f1(void)
+{
+	uint32_t pll_locked = 0;
+
+	mdss_dsi_uniphy_pll_sw_reset(MIPI_DSI_BASE);
+
+	/*
+	 * Add hardware recommended delays between register writes for
+	 * the updates to take effect. These delays are necessary for the
+	 * PLL to successfully lock
+	 */
+	writel(0x01, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x05, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x0f, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x0d, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x0f, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(1000);
+
+	mdss_dsi_uniphy_pll_lock_detect_setting(MIPI_DSI_BASE);
+	pll_locked = readl(MIPI_DSI_BASE + 0x02c0) & 0x01;
+
+	return pll_locked;
+}
+
+static uint32_t dsi_pll_enable_seq_c(void)
+{
+	uint32_t pll_locked = 0;
+
+	mdss_dsi_uniphy_pll_sw_reset(MIPI_DSI_BASE);
+
+	/*
+	 * Add hardware recommended delays between register writes for
+	 * the updates to take effect. These delays are necessary for the
+	 * PLL to successfully lock
+	 */
+	writel(0x01, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x05, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x0f, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(1000);
+
+	mdss_dsi_uniphy_pll_lock_detect_setting(MIPI_DSI_BASE);
+	pll_locked = readl(MIPI_DSI_BASE + 0x02c0) & 0x01;
+
+	return pll_locked;
+}
+
+static uint32_t dsi_pll_enable_seq_e(void)
+{
+	uint32_t pll_locked = 0;
+
+	mdss_dsi_uniphy_pll_sw_reset(MIPI_DSI_BASE);
+
+	/*
+	 * Add hardware recommended delays between register writes for
+	 * the updates to take effect. These delays are necessary for the
+	 * PLL to successfully lock
+	 */
+	writel(0x01, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x05, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(200);
+	writel(0x0d, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(1);
+	writel(0x0f, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	udelay(1000);
+
+	mdss_dsi_uniphy_pll_lock_detect_setting(MIPI_DSI_BASE);
+	pll_locked = readl(MIPI_DSI_BASE + 0x02c0) & 0x01;
+
+	return pll_locked;
+}
+
+
+
+static uint32_t dsi_pll_enable_seq_8974(void)
+{
+	uint32_t rc = 0;
+
+	mdss_dsi_uniphy_pll_sw_reset(MIPI_DSI_BASE);
+
+	writel(0x01, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	mdelay(1);
+	writel(0x05, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	mdelay(1);
+	writel(0x07, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	mdelay(1);
+	writel(0x0f, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+	mdelay(1);
+
+	mdss_dsi_uniphy_pll_lock_detect_setting(MIPI_DSI_BASE);
+
+	while (!(readl(MIPI_DSI_BASE + 0x02c0) & 0x01)) {
+		mdss_dsi_uniphy_pll_sw_reset(MIPI_DSI_BASE);
+		writel(0x01, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+		mdelay(1);
+		writel(0x05, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+		mdelay(1);
+		writel(0x07, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+		mdelay(1);
+		writel(0x05, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+		mdelay(1);
+		writel(0x07, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+		mdelay(1);
+		writel(0x0f, MIPI_DSI_BASE + 0x0220); /* GLB CFG */
+		mdelay(2);
+		mdss_dsi_uniphy_pll_lock_detect_setting(MIPI_DSI_BASE);
+	}
+	return rc;
+}
+
+static uint32_t dsi_pll_enable_seq(void)
+{
+	uint32_t platformid = board_platform_id();
+
+	/* Only one enable seq for 8974 target */
+	if (platformid == MSM8974) {
+		dsi_pll_enable_seq_8974();
+	}
+
+	/* 6 enable seq for 8226 target */
+	else if (platformid == MSM8226 ||
+		 platformid == MSM8626) {
+		if (dsi_pll_enable_seq_m()) {
+		} else if (dsi_pll_enable_seq_d()) {
+		} else if (dsi_pll_enable_seq_d()) {
+		} else if (dsi_pll_enable_seq_f1()) {
+		} else if (dsi_pll_enable_seq_c()) {
+		} else if (dsi_pll_enable_seq_e()) {
+		} else {
+			dprintf(CRITICAL, "Not able to enable the pll\n");
+		}
+	} else {
+		dprintf(CRITICAL, "Target not supported\n");
+	}
+
+}
+
+int32_t mdss_dsi_auto_pll_config(struct mdss_dsi_pll_config *pd)
+{
+	uint32_t rem, divider;
+	uint32_t refclk_cfg = 0, frac_n_mode = 0, ref_doubler_en_b = 0;
+	uint64_t vco_clock, div_fbx;
+	uint32_t ref_clk_to_pll = 0, frac_n_value = 0;
+	uint32_t sdm_cfg0, sdm_cfg1, sdm_cfg2, sdm_cfg3;
+	uint32_t gen_vco_clk, cal_cfg10, cal_cfg11;
+	uint32_t res;
+	uint8_t i, rc = NO_ERROR;
+
+	/* Configure the Loop filter resistance */
+	for (i = 0; i < LPFR_LUT_SIZE; i++)
+		if (pd->vco_clock <= lpfr_lut[i].vco_rate)
+			break;
+	if (i == LPFR_LUT_SIZE) {
+		dprintf(INFO, "unable to get loop filter resistance. vco=%d\n"
+						, lpfr_lut[i].vco_rate);
+		rc = ERROR;
+		return rc;
+	}
+
+	mdss_dsi_phy_sw_reset(MIPI_DSI_BASE);
+
+	/* Loop filter resistance value */
+	writel(lpfr_lut[i].resistance, MIPI_DSI_BASE + 0x022c);
+	/* Loop filter capacitance values : c1 and c2 */
+	writel(0x70, MIPI_DSI_BASE + 0x0230);
+	writel(0x15, MIPI_DSI_BASE + 0x0234);
+
+	writel(0x02, MIPI_DSI_BASE + 0x0208); /* ChgPump */
+	/* postDiv1 - calculated in pll config*/
+	writel(pd->posdiv1, MIPI_DSI_BASE + 0x0204);
+	/* postDiv2 - fixed devision 4 */
+	writel(0x03, MIPI_DSI_BASE + 0x0224);
+	/* postDiv3 - calculated in pll config */
+	writel(pd->posdiv3, MIPI_DSI_BASE + 0x0228); /* postDiv3 */
+
+	writel(0x2b, MIPI_DSI_BASE + 0x0278); /* Cal CFG3 */
+	writel(0x66, MIPI_DSI_BASE + 0x027c); /* Cal CFG4 */
+	writel(0x05, MIPI_DSI_BASE + 0x0264); /* LKDetect CFG2 */
+
+	rem = pd->vco_clock % VCO_REF_CLOCK_RATE;
+	if (rem) {
+		refclk_cfg = 0x1;
+		frac_n_mode = 1;
+		ref_doubler_en_b = 0;
+	} else {
+		refclk_cfg = 0x0;
+		frac_n_mode = 0;
+		ref_doubler_en_b = 1;
+	}
+
+	ref_clk_to_pll = (VCO_REF_CLOCK_RATE * 2 * refclk_cfg)
+			  + (ref_doubler_en_b * VCO_REF_CLOCK_RATE);
+
+	vco_clock = ((uint64_t) pd->vco_clock) * FRAC_DIVIDER;
+
+	div_fbx = vco_clock / ref_clk_to_pll;
+
+	rem = (uint32_t) (div_fbx % FRAC_DIVIDER);
+	rem = rem * (1 << 16);
+	frac_n_value = rem / FRAC_DIVIDER;
+
+	divider = pd->vco_clock / ref_clk_to_pll;
+	div_fbx *= ref_clk_to_pll;
+	gen_vco_clk = div_fbx / FRAC_DIVIDER;
+
+	if (frac_n_mode) {
+		sdm_cfg0 = 0x0;
+		sdm_cfg1 = (divider & 0x3f) - 1;
+		sdm_cfg3 = frac_n_value / 256;
+		sdm_cfg2 = frac_n_value % 256;
+	} else {
+		sdm_cfg0 = (0x1 << 5);
+		sdm_cfg0 |= (divider & 0x3f) - 1;
+		sdm_cfg1 = 0x0;
+		sdm_cfg2 = 0;
+		sdm_cfg3 = 0;
+	}
+
+	cal_cfg11 = gen_vco_clk / 256000000;
+	cal_cfg10 = (gen_vco_clk % 256000000) / 1000000;
+
+	writel(sdm_cfg1 , MIPI_DSI_BASE + 0x023c); /* SDM CFG1 */
+	writel(sdm_cfg2 , MIPI_DSI_BASE + 0x0240); /* SDM CFG2 */
+	writel(sdm_cfg3 , MIPI_DSI_BASE + 0x0244); /* SDM CFG3 */
+	writel(0x00, MIPI_DSI_BASE + 0x0248); /* SDM CFG4 */
+
+	udelay(10);
+
+	writel(refclk_cfg, MIPI_DSI_BASE + 0x0200); /* REFCLK CFG */
+	writel(0x00, MIPI_DSI_BASE + 0x0214); /* PWRGEN CFG */
+	writel(0x71, MIPI_DSI_BASE + 0x020c); /* VCOLPF CFG */
+	writel(pd->directpath, MIPI_DSI_BASE + 0x0210); /* VREG CFG */
+	writel(sdm_cfg0, MIPI_DSI_BASE + 0x0238); /* SDM CFG0 */
+
+	writel(0x0a, MIPI_DSI_BASE + 0x026c); /* CAL CFG0 */
+	writel(0x30, MIPI_DSI_BASE + 0x0284); /* CAL CFG6 */
+	writel(0x00, MIPI_DSI_BASE + 0x0288); /* CAL CFG7 */
+	writel(0x60, MIPI_DSI_BASE + 0x028c); /* CAL CFG8 */
+	writel(0x00, MIPI_DSI_BASE + 0x0290); /* CAL CFG9 */
+	writel(cal_cfg10, MIPI_DSI_BASE + 0x0294); /* CAL CFG10 */
+	writel(cal_cfg11, MIPI_DSI_BASE + 0x0298); /* CAL CFG11 */
+	writel(0x20, MIPI_DSI_BASE + 0x029c); /* EFUSE CFG */
+
+	dsi_pll_enable_seq();
+}
diff --git a/platform/msm_shared/mipi_dsi_phy.c b/platform/msm_shared/mipi_dsi_phy.c
index d3a92f1..ff7b443 100644
--- a/platform/msm_shared/mipi_dsi_phy.c
+++ b/platform/msm_shared/mipi_dsi_phy.c
@@ -392,11 +392,64 @@
 
 }
 
+int mdss_dsi_v2_phy_init(struct mipi_dsi_panel_config *pinfo, uint32_t ctl_base)
+{
+	struct mdss_dsi_phy_ctrl *pd;
+	uint32_t i, ln, off = 0, offset;
+
+	pd = pinfo->mdss_dsi_phy_config;
+	/* DSI PHY configuration */
+	off = 0x480;
+	writel(pd->strength[0], ctl_base + off + (4 * 0));
+	writel(pd->strength[1], ctl_base + off + (4 * 2));
+
+	off = 0x470;
+	writel(0x10, ctl_base + off + (4 * 3));
+	writel(0x5F, ctl_base + off + (4 * 0));
+
+	off = 0x500;
+	for (i = 0; i < 5; i++)
+		writel(pd->regulator[i], ctl_base + off + (4 * i));
+
+	mipi_dsi_calibration();
+
+	/* 4 lanes + clk lane configuration */
+	/* lane config n * (0 - 4) & DataPath setup */
+	for (ln = 0; ln < 5; ln++) {
+		off = 0x0300 + (ln * 0x40);
+		for (i = 0; i < 9; i++) {
+			offset = i + (ln * 9);
+			writel(pd->laneCfg[offset], ctl_base + off);
+			dmb();
+			off += 4;
+		}
+	}
+
+	off = 0x440;
+	for (i = 0; i < 12; i++)
+		writel(pd->timing[i], ctl_base + off + (4 * i));
+
+	if (1 == pinfo->num_of_lanes)
+		writel(0x8, ctl_base + 0x200 + (4 * 11));
+
+
+	if (pinfo->lane_swap)
+		writel(pinfo->lane_swap, ctl_base + 0x0ac);
+
+	/* T_CLK_POST, T_CLK_PRE for CLK lane P/N HS 200 mV timing
+	length should > data lane HS timing length */
+	writel(0x41b, ctl_base + 0x0c0);
+	return 0;
+}
+
 int mdss_dsi_phy_init(struct mipi_dsi_panel_config *pinfo, uint32_t ctl_base)
 {
 	struct mdss_dsi_phy_ctrl *pd;
 	uint32_t i, off = 0, ln, offset;
 
+	if (mdp_get_revision() == MDP_REV_304)
+		return mdss_dsi_v2_phy_init(pinfo, ctl_base);
+
 	pd = (pinfo->mdss_dsi_phy_config);
 
 	/* Strength ctrl 0 */
diff --git a/platform/msm_shared/mmc_sdhci.c b/platform/msm_shared/mmc_sdhci.c
index 1e6aaa8..d4b0bd4 100644
--- a/platform/msm_shared/mmc_sdhci.c
+++ b/platform/msm_shared/mmc_sdhci.c
@@ -1381,7 +1381,7 @@
 {
 	struct mmc_command cmd;
 	uint32_t status;
-	uint32_t retry;
+	uint32_t retry = 0;
 
 	memset((struct mmc_command *)&cmd, 0, sizeof(struct mmc_command));
 
@@ -1537,7 +1537,7 @@
 	uint32_t status;
 	uint32_t num_wp_grps;
 	uint32_t ret;
-	uint32_t retry;
+	uint32_t retry = 0;
 	uint32_t i;
 
 	memset((struct mmc_command *)&cmd, 0, sizeof(struct mmc_command));
diff --git a/platform/msm_shared/rules.mk b/platform/msm_shared/rules.mk
old mode 100644
new mode 100755
index 3c8009f..72982b1
--- a/platform/msm_shared/rules.mk
+++ b/platform/msm_shared/rules.mk
@@ -116,6 +116,7 @@
 			$(LOCAL_DIR)/display.o \
 			$(LOCAL_DIR)/mipi_dsi.o \
 			$(LOCAL_DIR)/mipi_dsi_phy.o \
+			$(LOCAL_DIR)/mipi_dsi_autopll.o \
 			$(LOCAL_DIR)/spmi.o \
 			$(LOCAL_DIR)/bam.o \
 			$(LOCAL_DIR)/qpic_nand.o \
@@ -129,7 +130,24 @@
 			$(LOCAL_DIR)/dload_util.o
 endif
 
+ifeq ($(PLATFORM),mpq8092)
+	OBJS += $(LOCAL_DIR)/qgic.o \
+			$(LOCAL_DIR)/qtimer.o \
+			$(LOCAL_DIR)/qtimer_mmap.o \
+			$(LOCAL_DIR)/interrupts.o \
+			$(LOCAL_DIR)/clock.o \
+			$(LOCAL_DIR)/clock_pll.o \
+			$(LOCAL_DIR)/clock_lib2.o \
+			$(LOCAL_DIR)/uart_dm.o \
+			$(LOCAL_DIR)/board.o \
+			$(LOCAL_DIR)/spmi.o \
+			$(LOCAL_DIR)/bam.o \
+			$(LOCAL_DIR)/qpic_nand.o \
+			$(LOCAL_DIR)/dev_tree.o
+endif
+
 ifeq ($(PLATFORM),msm8610)
+DEFINES += DISPLAY_TYPE_MDSS=1
     OBJS += $(LOCAL_DIR)/qgic.o \
             $(LOCAL_DIR)/qtimer.o \
             $(LOCAL_DIR)/qtimer_mmap.o \
@@ -139,6 +157,10 @@
             $(LOCAL_DIR)/clock_lib2.o \
             $(LOCAL_DIR)/uart_dm.o \
             $(LOCAL_DIR)/board.o \
+            $(LOCAL_DIR)/display.o \
+            $(LOCAL_DIR)/mipi_dsi.o \
+            $(LOCAL_DIR)/mipi_dsi_phy.o \
+            $(LOCAL_DIR)/mdp3.o \
             $(LOCAL_DIR)/spmi.o \
             $(LOCAL_DIR)/bam.o \
             $(LOCAL_DIR)/qpic_nand.o \
diff --git a/platform/msm_shared/smem.h b/platform/msm_shared/smem.h
index 1b6c78a..3782c12 100755
--- a/platform/msm_shared/smem.h
+++ b/platform/msm_shared/smem.h
@@ -270,6 +270,7 @@
 	MSM8630AA = 143,
 	MSM8230AA = 144,
 	MSM8626   = 145,
+	MPQ8092   = 146,
 	MSM8610   = 147,
 	MDM9225   = 149,
 	MDM9225M  = 150,
@@ -299,10 +300,22 @@
 	APQ8074   = 184,
 	MSM8274   = 185,
 	MSM8674   = 186,
+	MSM8974AC = 194,
 	MSM8126   = 198,
 	APQ8026   = 199,
 	MSM8926   = 200,
 	MSM8326   = 205,
+	APQ8074AA  = 208,
+	APQ8074AB  = 209,
+	APQ8074AC  = 210,
+	MSM8274AA  = 211,
+	MSM8274AB  = 212,
+	MSM8274AC  = 213,
+	MSM8674AA  = 214,
+	MSM8674AB  = 215,
+	MSM8674AC  = 216,
+	MSM8974AA  = 217,
+	MSM8974AB  = 218,
 };
 
 enum platform {
diff --git a/project/mpq8092.mk b/project/mpq8092.mk
new file mode 100644
index 0000000..0ad0671
--- /dev/null
+++ b/project/mpq8092.mk
@@ -0,0 +1,16 @@
+# top level project rules for the mpq8092 project
+#
+LOCAL_DIR := $(GET_LOCAL_DIR)
+
+TARGET := mpq8092
+
+MODULES += app/aboot
+
+DEBUG := 1
+
+#DEFINES += WITH_DEBUG_DCC=1
+DEFINES += WITH_DEBUG_UART=1
+#DEFINES += WITH_DEBUG_FBCON=1
+DEFINES += DEVICE_TREE=1
+#DEFINES += MMC_BOOT_BAM=1
+#DEFINES += CRYPTO_BAM=1
diff --git a/project/msm8610.mk b/project/msm8610.mk
index 13b4268..8d68d0a 100644
--- a/project/msm8610.mk
+++ b/project/msm8610.mk
@@ -14,3 +14,9 @@
 DEFINES += DEVICE_TREE=1
 #DEFINES += MMC_BOOT_BAM=1
 #DEFINES += CRYPTO_BAM=1
+
+#Disable thumb mode
+#TODO: The gold linker has issues generating correct
+#thumb interworking code for LK. Confirm that the issue
+#is with the linker and file a bug report.
+ENABLE_THUMB := false
diff --git a/target/mpq8092/init.c b/target/mpq8092/init.c
new file mode 100644
index 0000000..86b7bc9
--- /dev/null
+++ b/target/mpq8092/init.c
@@ -0,0 +1,100 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ */
+
+#include <debug.h>
+#include <platform/iomap.h>
+#include <reg.h>
+#include <target.h>
+#include <platform.h>
+#include <uart_dm.h>
+#include <mmc.h>
+#include <spmi.h>
+#include <board.h>
+
+#define PMIC_ARB_CHANNEL_NUM    0
+#define PMIC_ARB_OWNER_ID       0
+
+static uint32_t mmc_sdc_base[] =
+	{ MSM_SDC1_BASE, MSM_SDC2_BASE, MSM_SDC3_BASE, MSM_SDC4_BASE };
+
+void target_early_init(void)
+{
+#if WITH_DEBUG_UART
+	uart_dm_init(1, 0, BLSP1_UART1_BASE);
+#endif
+}
+void target_mmc_caps(struct mmc_host *host)
+{
+	host->caps.ddr_mode = 0;
+	host->caps.hs200_mode = 0;
+	host->caps.bus_width = MMC_BOOT_BUS_WIDTH_8_BIT;
+	host->caps.hs_clk_rate = MMC_CLK_50MHZ;
+}
+static void target_keystatus()
+{
+}
+
+void target_init(void)
+{
+	uint32_t base_addr;
+	uint8_t slot;
+
+	dprintf(INFO, "target_init()\n");
+
+	spmi_init(PMIC_ARB_CHANNEL_NUM, PMIC_ARB_OWNER_ID);
+
+	target_keystatus();
+
+	/* Trying Slot 1*/
+	slot = 1;
+	base_addr = mmc_sdc_base[slot - 1];
+	if (mmc_boot_main(slot, base_addr))
+	{
+
+	/* Trying Slot 2 next */
+	slot = 2;
+	base_addr = mmc_sdc_base[slot - 1];
+	if (mmc_boot_main(slot, base_addr)) {
+		dprintf(CRITICAL, "mmc init failed!");
+		ASSERT(0);
+	}
+	}
+}
+
+void target_serialno(unsigned char *buf)
+{
+	uint32_t serialno;
+	if (target_is_emmc_boot()) {
+		serialno = mmc_get_psn();
+		snprintf((char *)buf, 13, "%x", serialno);
+	}
+}
+
+unsigned board_machtype(void)
+{
+}
diff --git a/target/mpq8092/meminfo.c b/target/mpq8092/meminfo.c
new file mode 100644
index 0000000..f12476d
--- /dev/null
+++ b/target/mpq8092/meminfo.c
@@ -0,0 +1,81 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ */
+
+#include <reg.h>
+#include <debug.h>
+#include <malloc.h>
+#include <smem.h>
+#include <stdint.h>
+#include <libfdt.h>
+#include <platform/iomap.h>
+#include <dev_tree.h>
+
+/* Funtion to add the ram partition entries into device tree.
+ * The function assumes that all the entire fixed memory regions should
+ * be listed in the first bank of the passed in ddr regions.
+ */
+uint32_t target_dev_tree_mem(void *fdt, uint32_t memory_node_offset)
+{
+	struct smem_ram_ptable ram_ptable;
+	uint32_t i;
+	int ret = 0;
+
+	/* Make sure RAM partition table is initialized */
+	ASSERT(smem_ram_ptable_init(&ram_ptable));
+
+	/* Calculating the size of the mem_info_ptr */
+	for (i = 0 ; i < ram_ptable.len; i++)
+	{
+		if ((ram_ptable.parts[i].category == SDRAM) &&
+			(ram_ptable.parts[i].type == SYS_MEMORY)) {
+
+			/* Pass along all other usable memory regions to Linux */
+			ret = dev_tree_add_mem_info(fdt,
+					memory_node_offset,
+					ram_ptable.parts[i].start,
+					ram_ptable.parts[i].size);
+			if (ret) {
+				dprintf(CRITICAL, "Failed to add secondary banks memory addresses\n");
+				goto target_dev_tree_mem_err;
+			}
+		}
+	}
+target_dev_tree_mem_err:
+
+	return ret;
+}
+
+void *target_get_scratch_address(void)
+{
+	return ((void *)SCRATCH_ADDR);
+}
+
+unsigned target_get_max_flash_size(void)
+{
+	return (512 * 1024 * 1024);
+}
diff --git a/target/mpq8092/rules.mk b/target/mpq8092/rules.mk
new file mode 100644
index 0000000..0d56e4d
--- /dev/null
+++ b/target/mpq8092/rules.mk
@@ -0,0 +1,35 @@
+LOCAL_DIR := $(GET_LOCAL_DIR)
+
+INCLUDES += -I$(LOCAL_DIR)/include -I$(LK_TOP_DIR)/platform/msm_shared
+
+PLATFORM := mpq8092
+
+MEMBASE := 0x0FF00000 # SDRAM
+MEMSIZE := 0x00100000 # 1MB
+
+BASE_ADDR        := 0x00000
+
+TAGS_ADDR        := BASE_ADDR+0x00000100
+KERNEL_ADDR      := BASE_ADDR+0x00008000
+RAMDISK_ADDR     := BASE_ADDR+0x01000000
+SCRATCH_ADDR     := 0x10000000
+
+MODULES += \
+	dev/keys \
+	lib/ptable \
+	dev/pmic/pm8x41 \
+	lib/libfdt
+
+DEFINES += \
+	MEMSIZE=$(MEMSIZE) \
+	MEMBASE=$(MEMBASE) \
+	BASE_ADDR=$(BASE_ADDR) \
+	TAGS_ADDR=$(TAGS_ADDR) \
+	KERNEL_ADDR=$(KERNEL_ADDR) \
+	RAMDISK_ADDR=$(RAMDISK_ADDR) \
+	SCRATCH_ADDR=$(SCRATCH_ADDR)
+
+
+OBJS += \
+	$(LOCAL_DIR)/init.o \
+	$(LOCAL_DIR)/meminfo.o
diff --git a/target/mpq8092/tools/makefile b/target/mpq8092/tools/makefile
new file mode 100644
index 0000000..2757e07
--- /dev/null
+++ b/target/mpq8092/tools/makefile
@@ -0,0 +1,44 @@
+#Makefile to generate appsboot.mbn
+
+ifeq ($(BOOTLOADER_OUT),.)
+APPSBOOTHEADER_DIR  := $(BUILDDIR)
+else
+APPSBOOTHEADER_DIR  := $(BOOTLOADER_OUT)/../..
+endif
+
+SRC_DIR  := target/$(TARGET)/tools
+COMPILER := gcc
+
+ifeq ($(EMMC_BOOT), 1)
+  APPSBOOTHDR_FILES := EMMCBOOT.MBN
+else
+  ifeq ($(BUILD_NANDWRITE), 1)
+    APPSBOOTHDR_FILES :=
+  else
+    APPSBOOTHDR_FILES := appsboot.mbn
+  endif
+endif
+
+APPSBOOTHEADER: $(APPSBOOTHDR_FILES)
+
+
+appsboot.mbn: appsboothd.mbn $(OUTBIN)
+	cp $(OUTBIN) $(APPSBOOTHEADER_DIR)/appsboot.raw
+	cat $(APPSBOOTHEADER_DIR)/appsboothd.mbn $(OUTBIN) > $(APPSBOOTHEADER_DIR)/appsboot.mbn
+	rm -f $(APPSBOOTHEADER_DIR)/appsboothd.mbn
+
+appsboothd.mbn: mkheader $(OUTBIN)
+	$(BUILDDIR)/mkheader $(OUTBIN) $(APPSBOOTHEADER_DIR)/appsboothd.mbn
+
+EMMCBOOT.MBN: emmc_appsboothd.mbn $(OUTBIN)
+	cp $(OUTBIN) $(APPSBOOTHEADER_DIR)/emmc_appsboot.raw
+	cat $(APPSBOOTHEADER_DIR)/emmc_appsboothd.mbn $(OUTBIN) > $(APPSBOOTHEADER_DIR)/EMMCBOOT.MBN
+	cat $(APPSBOOTHEADER_DIR)/emmc_appsboothd.mbn $(OUTBIN) > $(APPSBOOTHEADER_DIR)/emmc_appsboot.mbn
+	rm -f $(APPSBOOTHEADER_DIR)/emmc_appsboothd.mbn
+
+emmc_appsboothd.mbn: mkheader $(OUTBIN)
+	$(BUILDDIR)/mkheader $(OUTBIN) $(APPSBOOTHEADER_DIR)/emmc_appsboothd.mbn
+
+mkheader: $(SRC_DIR)/mkheader.c
+	@mkdir -p $(BUILDDIR)
+	${COMPILER} -DMEMBASE=$(MEMBASE) $(SRC_DIR)/mkheader.c -o $(BUILDDIR)/mkheader
diff --git a/target/mpq8092/tools/mkheader.c b/target/mpq8092/tools/mkheader.c
new file mode 100644
index 0000000..2d1cf9d
--- /dev/null
+++ b/target/mpq8092/tools/mkheader.c
@@ -0,0 +1,341 @@
+/*
+ * Copyright (c) 2007, Google Inc.
+ *
+ * Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ */
+
+#include <stdio.h>
+#include <stdlib.h>
+#include <unistd.h>
+#include <fcntl.h>
+#include <string.h>
+
+#include <sys/stat.h>
+
+int print_usage()
+{
+	fprintf(stderr, "usage: mkheader <bin> <hdr> <none|unified-boot>\n");
+	fprintf(stderr, "       mkheader <bin> <hdr> <unsecure-boot>"
+		" <outbin>\n");
+	fprintf(stderr, "       mkheader <bin> <hdr> <secure-boot> <outbin>"
+		" <maxsize>\n");
+	fprintf(stderr, "       mkheader <bin> <hdr> <secure-boot> <outbin>"
+		" <maxsize> <certchain> <files...>\n\n");
+	fprintf(stderr, "bin:               Input raw appsbl binary\n");
+	fprintf(stderr,
+		"hdr:               Output of appsbl header location\n");
+	fprintf(stderr,
+		"outbin:            Output of the signed or unsigned"
+		"apps boot location\n");
+	fprintf(stderr,
+		"maxsize:           Maximum size for certificate" " chain\n");
+	fprintf(stderr,
+		"certchain:         Output of the certchain location\n");
+	fprintf(stderr,
+		"files:             Input format <bin signature>"
+		"<certifcate file(s) for certificate chain>...\n");
+	fprintf(stderr,
+		"certificate chain: Files will be concatenated in order"
+		"to create the certificate chain\n\n");
+	return -1;
+}
+
+int cat(FILE * in, FILE * out, unsigned size, unsigned buff_size)
+{
+	unsigned bytes_left = size;
+	char buf[buff_size];
+	int ret = 0;
+
+	while (bytes_left) {
+		fread(buf, sizeof(char), buff_size, in);
+		if (!feof(in)) {
+			bytes_left -= fwrite(buf, sizeof(char), buff_size, out);
+		} else
+			bytes_left = 0;
+       }
+	ret = ferror(in) | ferror(out);
+	if (ret)
+		fprintf(stderr, "ERROR: Occured during file concatenation\n");
+	return ret;
+}
+
+int main(int argc, char *argv[])
+{
+	struct stat s;
+	unsigned size, base;
+	int unified_boot = 0;
+	unsigned unified_boot_magic[20];
+	unsigned non_unified_boot_magic[10];
+	unsigned magic_len = 0;
+	unsigned *magic;
+	unsigned cert_chain_size = 0;
+	unsigned signature_size = 0;
+	int secure_boot = 0;
+	int fd;
+
+	if (argc < 3) {
+		return print_usage();
+       }
+
+	if (argc == 4) {
+		if (!strcmp("unified-boot", argv[3])) {
+			unified_boot = 1;
+		} else if (!strcmp("secure-boot", argv[3])) {
+			fprintf(stderr,
+				"ERROR: Missing arguments: [outbin maxsize] |"
+				" [outbin, maxsize, certchain,"
+				" signature + certifcate(s)]\n");
+				return print_usage();
+		} else if (!strcmp("unsecure-boot", argv[3])) {
+				fprintf(stderr, "ERROR: Missing arguments:"
+				" outbin directory\n");
+			return print_usage();
+              }
+       }
+
+       if (argc > 4) {
+		if (!strcmp("secure-boot", argv[3])) {
+			if (argc < 9 && argc != 6) {
+				fprintf(stderr,"ERROR: Missing argument(s):"
+					" [outbin maxsize] | [outbin, maxsize,"
+					" certchain,"
+					" signature + certifcate(s)]\n");
+				return print_usage();
+			}
+		secure_boot = 1;
+		signature_size = 256;  //Support SHA 256
+		cert_chain_size = atoi(argv[5]);
+              }
+       }
+
+	if (stat(argv[1], &s)) {
+		perror("cannot stat binary");
+		return -1;
+	}
+
+	if (unified_boot) {
+		magic = unified_boot_magic;
+		magic_len = sizeof(unified_boot_magic);
+	} else {
+		magic = non_unified_boot_magic;
+		magic_len = sizeof(non_unified_boot_magic);
+	}
+
+	size = s.st_size;
+#if MEMBASE
+	base = MEMBASE;
+#else
+	base = 0;
+#endif
+
+	printf("Image Destination Pointer: 0x%x\n", base);
+
+	magic[0] = 0x00000005; /* appsbl */
+	magic[1] = 0x00000003; //Flash_partition_version /* nand */
+	magic[2] = 0x00000000; //image source pointer
+	magic[3] = base;       //image destination pointer
+	magic[4] = size + cert_chain_size + signature_size;    //image size
+	magic[5] = size;       //code size
+	magic[6] = base + size;
+	magic[7] = signature_size;
+	magic[8] = size + base + signature_size;
+	magic[9] = cert_chain_size;
+
+	if (unified_boot == 1) {
+		magic[10] = 0x33836685;        /* cookie magic number */
+		magic[11] = 0x00000001;        /* cookie version */
+		magic[12] = 0x00000002;        /* file formats */
+		magic[13] = 0x00000000;
+		magic[14] = 0x00000000;        /* not setting size for boot.img */
+		magic[15] = 0x00000000;
+		magic[16] = 0x00000000;
+		magic[17] = 0x00000000;
+		magic[18] = 0x00000000;
+		magic[19] = 0x00000000;
+}
+
+fd = open(argv[2], O_WRONLY | O_CREAT | O_TRUNC, 0644);
+if (fd < 0) {
+       perror("cannot open header for writing");
+       return -1;
+}
+if (write(fd, magic, magic_len) != magic_len) {
+       perror("cannot write header");
+       close(fd);
+       unlink(argv[2]);
+       return -1;
+}
+close(fd);
+
+if (secure_boot && argc > 6) {
+       FILE *input_file;
+       FILE *output_file;
+       unsigned buff_size = 1;
+       char buf[buff_size];
+       unsigned bytes_left;
+       unsigned current_cert_chain_size = 0;
+       int padding_size = 0;
+       int i;
+
+       if ((output_file = fopen(argv[6], "wb")) == NULL) {
+              perror("ERROR: Occured during fopen");
+              return -1;
+       }
+       printf("Certificate Chain Output File: %s\n", argv[6]);
+
+       for (i = 8; i < argc; i++) {
+              if ((input_file = fopen(argv[i], "rb")) == NULL) {
+                            perror("ERROR: Occured during fopen");
+              return -1;
+       }
+       stat(argv[i], &s);
+       bytes_left = s.st_size;
+       current_cert_chain_size += bytes_left;
+       if (cat(input_file, output_file, bytes_left, buff_size))
+              return -1;
+              fclose(input_file);
+       }
+
+       //Pad certifcate chain to the max expected size from input
+       memset(buf, 0xFF, sizeof(buf));
+       padding_size = cert_chain_size - current_cert_chain_size;
+
+       if (padding_size < 0) {
+              fprintf(stderr, "ERROR: Input certificate chain"
+              " (Size=%d) is larger than the maximum"
+              " specified (Size=%d)\n",
+              current_cert_chain_size, cert_chain_size);
+              return -1;
+       }
+
+       bytes_left = (padding_size > 0) ? padding_size : 0;
+       while (bytes_left) {
+              if (!ferror(output_file))
+                     bytes_left -= fwrite(buf,
+                           sizeof(buf),
+                           buff_size, output_file);
+              else {
+                     fprintf(stderr, "ERROR: Occured during"
+                            " certifcate chain padding\n");
+                     return -1;
+              }
+       }
+       fclose(output_file);
+
+       /* Concat and combine to signed image.
+        * Format [HDR][RAW APPSBOOT][PADDED CERT CHAIN]
+        */
+       if ((output_file = fopen(argv[4], "wb")) == NULL) {
+              perror("ERROR: Occured during fopen");
+              return -1;
+       }
+       printf("Image Output File: %s\n", argv[4]);
+
+              //Header
+              if ((input_file = fopen(argv[2], "rb")) == NULL) {
+                     perror("ERROR: Occured during fopen");
+                     return -1;
+              }
+              stat(argv[2], &s);
+              if (cat(input_file, output_file, s.st_size, buff_size))
+                     return -1;
+              fclose(input_file);
+
+              //Raw Appsbl
+              if ((input_file = fopen(argv[1], "rb")) == NULL) {
+                     perror("ERROR: Occured during fopen");
+                     return -1;
+              }
+              stat(argv[1], &s);
+              if (cat(input_file, output_file, s.st_size, buff_size))
+                     return -1;
+              fclose(input_file);
+
+              //Signature
+              if ((input_file = fopen(argv[7], "rb")) == NULL) {
+                     perror("ERROR: Occured during fopen");
+                     return -1;
+              }
+              stat(argv[7], &s);
+              if (cat(input_file, output_file, s.st_size, buff_size))
+                     return -1;
+              fclose(input_file);
+
+              //Certifcate Chain
+              if ((input_file = fopen(argv[6], "rb")) == NULL) {
+                     perror("ERROR: Occured during fopen");
+                     return -1;
+              }
+              if (cat(input_file, output_file,
+                     (current_cert_chain_size + padding_size), buff_size))
+                     return -1;
+              fclose(input_file);
+
+              fclose(output_file);
+
+       } else if (argc == 5 || argc == 6) {
+              FILE *input_file;
+              FILE *output_file;
+              unsigned buff_size = 1;
+              char buf[buff_size];
+
+              /* Concat and combine to unsigned image.
+               * Format [HDR][RAW APPSBOOT]
+               */
+              if ((output_file = fopen(argv[4], "wb")) == NULL) {
+                     perror("ERROR: Occured during fopen");
+                     return -1;
+              }
+              printf("Image Output File: %s\n", argv[4]);
+
+              //Header
+              if ((input_file = fopen(argv[2], "rb")) == NULL) {
+                     perror("ERROR: Occured during fopen");
+                     return -1;
+              }
+              stat(argv[2], &s);
+              if (cat(input_file, output_file, s.st_size, buff_size))
+                     return -1;
+              fclose(input_file);
+
+              //Raw Appsbl
+              if ((input_file = fopen(argv[1], "rb")) == NULL) {
+                     perror("ERROR: Occured during fopen");
+                     return -1;
+              }
+              stat(argv[1], &s);
+              if (cat(input_file, output_file, s.st_size, buff_size))
+                     return -1;
+              fclose(input_file);
+              fclose(output_file);
+       }
+
+       printf("Done execution\n");
+
+       return 0;
+}
diff --git a/target/msm8226/include/target/display.h b/target/msm8226/include/target/display.h
old mode 100644
new mode 100755
index d1d6932..bce13b8
--- a/target/msm8226/include/target/display.h
+++ b/target/msm8226/include/target/display.h
@@ -29,6 +29,80 @@
 #ifndef _TARGET_MSM8226_DISPLAY_H
 #define _TARGET_MSM8226_DISPLAY_H
 
+/*---------------------------------------------------------------------------*/
+/* HEADER files                                                              */
+/*---------------------------------------------------------------------------*/
+#include <display_resource.h>
+
+/*---------------------------------------------------------------------------*/
+/* GPIO configuration                                                        */
+/*---------------------------------------------------------------------------*/
+static struct gpio_pin reset_gpio = {
+  "msmgpio", 25, 3, 1, 0, 1
+};
+
+static struct gpio_pin enable_gpio = {
+  0, 0, 0, 0, 0, 0
+};
+
+static struct gpio_pin te_gpio = {
+  0, 0, 0, 0, 0, 0
+};
+
+static struct gpio_pin pwm_gpio = {
+  0, 0, 0, 0, 0, 0
+};
+
+static struct panel_reset_sequence reset_sequence = {
+  { 1, 0, 1, }, { 20, 20, 20, }, 2
+};
+
+
+/*---------------------------------------------------------------------------*/
+/* LDO configuration                                                         */
+/*---------------------------------------------------------------------------*/
+static struct ldo_entry ldo_entry_array[] = {
+  { "vdd", 15, 0, 2800000, 100000, 100, 0, 20, 0, 20},
+{ "vddio", 8, 0, 1800000, 100000, 100, 0, 30, 0, 30},
+{ "vdda", 4, 1, 1200000, 100000, 100, 0, 20, 0, 30},
+};
+
+#define TOTAL_LDO_DEFINED 3
+
+/*---------------------------------------------------------------------------*/
+/* Target Physical configuration                                             */
+/*---------------------------------------------------------------------------*/
+
+static const uint32_t panel_strength_ctrl[] = {
+  0xff, 0x06
+};
+
+static const char panel_bist_ctrl[] = {
+  0x00, 0x00, 0xb1, 0xff, 0x00, 0x00
+};
+
+static const uint32_t panel_regulator_settings[] = {
+  0x07, 0x09, 0x03, 0x00, 0x20, 0x00, 0x01
+};
+
+static const char panel_lane_config[] = {
+  0x00, 0x00, 0x00, 0x00, 0x00, 0x00, 0x00, 0x01, 0x97,
+  0x00, 0x00, 0x00, 0x00, 0x05, 0x00, 0x00, 0x01, 0x97,
+  0x00, 0x00, 0x00, 0x00, 0x0a, 0x00, 0x00, 0x01, 0x97,
+  0x00, 0x00, 0x00, 0x00, 0x0f, 0x00, 0x00, 0x01, 0x97,
+  0x00, 0xc0, 0x00, 0x00, 0x00, 0x00, 0x00, 0x01, 0xbb
+};
+
+static const uint32_t panel_physical_ctrl[] = {
+  0x5f, 0x00, 0x00, 0x10
+};
+
+/*---------------------------------------------------------------------------*/
+/* Other Configuration                                                       */
+/*---------------------------------------------------------------------------*/
+
+#define msm8226_DSI_FEATURE_ENABLE 0
+
 #define MIPI_FB_ADDR  0x0D200000
 
 #define MIPI_HSYNC_PULSE_WIDTH       12
@@ -41,4 +115,5 @@
 
 extern int mdss_dsi_phy_init(struct mipi_dsi_panel_config *, uint32_t ctl_base);
 extern int mdss_dsi_uniphy_pll_config(uint32_t ctl_base);
+int mdss_dsi_auto_pll_config(struct mipi_dsi_panel_config *);
 #endif
diff --git a/target/msm8226/init.c b/target/msm8226/init.c
index 19568cb..641a16f 100644
--- a/target/msm8226/init.c
+++ b/target/msm8226/init.c
@@ -59,6 +59,12 @@
 
 #define TLMM_VOL_UP_BTN_GPIO    106
 
+enum target_subtype {
+	HW_PLATFORM_SUBTYPE_SKUAA = 1,
+	HW_PLATFORM_SUBTYPE_SKUF = 2,
+	HW_PLATFORM_SUBTYPE_SKUAB = 3,
+};
+
 static uint32_t mmc_sdhci_base[] =
 	{ MSM_SDC1_SDHCI_BASE, MSM_SDC2_SDHCI_BASE, MSM_SDC3_SDHCI_BASE };
 
@@ -197,7 +203,9 @@
 /* Detect the target type */
 void target_detect(struct board_data *board)
 {
-	board->target = LINUX_MACHTYPE_UNKNOWN;
+	/*
+	* already fill the board->target on board.c
+	*/
 }
 
 /* Detect the modem type */
@@ -218,6 +226,12 @@
 	{
 	case HW_PLATFORM_SUBTYPE_UNKNOWN:
 		break;
+	case HW_PLATFORM_SUBTYPE_SKUAA:
+		break;
+	case HW_PLATFORM_SUBTYPE_SKUF:
+		break;
+	case HW_PLATFORM_SUBTYPE_SKUAB:
+		break;
 	default:
 		dprintf(CRITICAL, "Platform Subtype : %u is not supported\n", platform_subtype);
 		ASSERT(0);
diff --git a/target/msm8226/rules.mk b/target/msm8226/rules.mk
old mode 100644
new mode 100755
index c5b9059..0d338c8
--- a/target/msm8226/rules.mk
+++ b/target/msm8226/rules.mk
@@ -1,6 +1,7 @@
 LOCAL_DIR := $(GET_LOCAL_DIR)
 
 INCLUDES += -I$(LOCAL_DIR)/include -I$(LK_TOP_DIR)/platform/msm_shared
+INCLUDES += -I$(LK_TOP_DIR)/dev/gcdb/display -I$(LK_TOP_DIR)/dev/gcdb/display/include
 
 PLATFORM := msm8226
 
@@ -14,7 +15,7 @@
 RAMDISK_ADDR     := BASE_ADDR+0x01000000
 SCRATCH_ADDR     := 0x10000000
 
-DEFINES += DISPLAY_SPLASH_SCREEN=0
+DEFINES += DISPLAY_SPLASH_SCREEN=1
 DEFINES += DISPLAY_TYPE_MIPI=1
 DEFINES += DISPLAY_TYPE_DSI6G=1
 DEFINES += DISPLAY_TYPE_CMD_MODE=0
@@ -24,6 +25,7 @@
 	lib/ptable \
 	dev/pmic/pm8x41 \
 	dev/panel/msm \
+	dev/gcdb/display \
 	lib/libfdt
 
 DEFINES += \
diff --git a/target/msm8226/target_display.c b/target/msm8226/target_display.c
old mode 100644
new mode 100755
index 5997291..2da792e
--- a/target/msm8226/target_display.c
+++ b/target/msm8226/target_display.c
@@ -29,7 +29,9 @@
 
 #include <debug.h>
 #include <smem.h>
+#include <err.h>
 #include <msm_panel.h>
+#include <mipi_dsi.h>
 #include <pm8x41.h>
 #include <pm8x41_wled.h>
 #include <board.h>
@@ -38,12 +40,7 @@
 #include <platform/iomap.h>
 #include <target/display.h>
 
-static struct msm_fb_panel_data panel;
-static uint8_t display_enable;
-
-extern int msm_display_init(struct msm_fb_panel_data *pdata);
-extern int msm_display_off();
-extern int mdss_dsi_uniphy_pll_config(uint32_t ctl_base);
+#include "include/display_resource.h"
 
 static struct pm8x41_wled_data wled_ctrl = {
 	.mod_scheme      = 0xC3,
@@ -55,8 +52,10 @@
 	.full_current_scale = 0x19
 };
 
-static int msm8226_backlight_on()
+int target_backlight_ctrl(uint8_t enable)
 {
+	dprintf(SPEW, "target_backlight_ctrl\n");
+
 	pm8x41_wled_config(&wled_ctrl);
 	pm8x41_wled_sink_control(1);
 	pm8x41_wled_iled_sync_control(1);
@@ -65,15 +64,20 @@
 	return 0;
 }
 
-static int msm8226_mdss_dsi_panel_clock(uint8_t enable)
+int target_panel_clock(uint8_t enable, struct msm_panel_info *pinfo)
 {
-	dprintf(SPEW, "msm8226_mdss_dsi_panel_clock, enable = %d\n", enable);
+	struct mdss_dsi_pll_config *pll_data;
+	dprintf(SPEW, "target_panel_clock\n");
+
+	pll_data = pinfo->mipi.dsi_pll_config;
 
 	if (enable) {
 		mdp_gdsc_ctrl(enable);
 		mdp_clock_init();
-		mdss_dsi_uniphy_pll_config(MIPI_DSI0_BASE);
-		mmss_clock_init(0x100);
+		mdss_dsi_auto_pll_config(pll_data);
+		mmss_clock_auto_pll_init(pll_data->pclk_m,
+				pll_data->pclk_n,
+				pll_data->pclk_d);
 	} else if(!target_cont_splash_screen()) {
 		/* Add here for non-continuous splash */
 		/* FIXME:Need to disable the clocks.
@@ -85,100 +89,65 @@
 	return 0;
 }
 
-static void msm8226_mdss_mipi_panel_reset(int enable)
+int target_panel_reset(uint8_t enable,
+				struct gpio_pin *resetgpio,
+				struct gpio_pin *enablegpio,
+				struct panel_reset_sequence *resetseq)
 {
-	dprintf(SPEW, "msm8226_mdss_mipi_panel_reset, enable = %d\n", enable);
-
+	int ret = NO_ERROR;
 	if (enable) {
-		gpio_tlmm_config(25, 0, GPIO_OUTPUT, GPIO_NO_PULL, GPIO_8MA, GPIO_DISABLE);
-		gpio_set_dir(25, 2); //output
+		gpio_tlmm_config(resetgpio->pin_id, 0,
+				resetgpio->pin_direction, resetgpio->pin_pull,
+				resetgpio->pin_strength, resetgpio->pin_state);
 
-		/* reset */
-		gpio_set_value(25, 1);
-		mdelay(20);
-		gpio_set_value(25, 0);
-		mdelay(20);
-		gpio_set_value(25, 1);
-		mdelay(20);
+		gpio_set_dir(resetgpio->pin_id, 2);
+
+		gpio_set_value(resetgpio->pin_id, resetseq->pin_state[0]);
+		mdelay(resetseq->sleep[0]);
+		gpio_set_value(resetgpio->pin_id, resetseq->pin_state[1]);
+		mdelay(resetseq->sleep[1]);
+		gpio_set_value(resetgpio->pin_id, resetseq->pin_state[2]);
+		mdelay(resetseq->sleep[2]);
 	} else if(!target_cont_splash_screen()) {
-		gpio_set_value(25, 0);
+		gpio_set_value(resetgpio->pin_id, 0);
 	}
 
-	return;
+	return ret;
 }
 
-static int msm8226_mipi_panel_power(uint8_t enable)
+int target_ldo_ctrl(uint8_t enable, struct ldo_entry ldo_entry_array[],
+			uint8_t ldo_array_size)
 {
-	struct pm8x41_ldo ldo4  = LDO(PM8x41_LDO4, NLDO_TYPE);
-	struct pm8x41_ldo ldo8 = LDO(PM8x41_LDO8, PLDO_TYPE);
-	struct pm8x41_ldo ldo15 = LDO(PM8x41_LDO15, PLDO_TYPE);
+	uint32_t ret = NO_ERROR;
+	uint32_t ldocounter = 0;
+	uint32_t pm8x41_ldo_base = 0x13F00;
 
-	dprintf(SPEW, "msm8226_mipi_panel_power, enable = %d\n", enable);
+	while (ldocounter < ldo_array_size) {
+		struct pm8x41_ldo ldo_entry = LDO((pm8x41_ldo_base +
+			0x100 * ldo_entry_array[ldocounter].ldo_id),
+			ldo_entry_array[ldocounter].ldo_type);
 
-	if (enable) {
-		/* backlight */
-		msm8226_backlight_on();
+		dprintf(SPEW, "Setting %s\n",
+				ldo_entry_array[ldocounter].ldo_id);
 
-		pm8x41_ldo_set_voltage(&ldo15, 2800000);
-		pm8x41_ldo_control(&ldo15, enable);
-
-		pm8x41_ldo_set_voltage(&ldo8, 1800000);
-		pm8x41_ldo_control(&ldo8, enable);
-
-		pm8x41_ldo_set_voltage(&ldo4, 1200000);
-		pm8x41_ldo_control(&ldo4, enable);
-
-		/* reset */
-		msm8226_mdss_mipi_panel_reset(enable);
-	} else if(!target_cont_splash_screen()) {
-		msm8226_mdss_mipi_panel_reset(enable);
-		pm8x41_wled_enable(enable);
-		pm8x41_ldo_control(&ldo4, enable);
-		pm8x41_ldo_control(&ldo15, enable);
+		/* Set voltage during power on */
+		if (enable == 1) {
+			pm8x41_ldo_set_voltage(&ldo_entry,
+					ldo_entry_array[ldocounter].ldo_voltage);
+		}
+		pm8x41_ldo_control(&ldo_entry, enable);
+		ldocounter++;
 	}
 
-	return 0;
+	return ret;
 }
 
 void display_init(void)
 {
-	uint32_t hw_id = board_hardware_id();
-
-	dprintf(SPEW, "display_init(),target_id=%d.\n", hw_id);
-
-	switch (hw_id) {
-	case HW_PLATFORM_QRD:
-	case HW_PLATFORM_MTP:
-	case HW_PLATFORM_SURF:
-#if DISPLAY_TYPE_CMD_MODE
-		mipi_nt35590_cmd_720p_init(&(panel.panel_info));
-#else
-		mipi_nt35590_video_720p_init(&(panel.panel_info));
-#endif
-		panel.clk_func = msm8226_mdss_dsi_panel_clock;
-		panel.power_func = msm8226_mipi_panel_power;
-		panel.fb.base = MIPI_FB_ADDR;
-		panel.fb.width =  panel.panel_info.xres;
-		panel.fb.height =  panel.panel_info.yres;
-		panel.fb.stride =  panel.panel_info.xres;
-		panel.fb.bpp =  panel.panel_info.bpp;
-		panel.fb.format = FB_FORMAT_RGB888;
-		panel.mdp_rev = MDP_REV_50;
-		break;
-	default:
-		return;
-	};
-
-	if (msm_display_init(&panel)) {
-		dprintf(CRITICAL, "Display init failed!\n");
-		return;
-	}
-
-	display_enable = 1;
+	gcdb_display_init(MDP_REV_50, MIPI_FB_ADDR);
 }
 
 void display_shutdown(void)
 {
-	if (display_enable)
-		msm_display_off();
+	gcdb_display_shutdown();
 }
diff --git a/target/msm8610/include/target/display.h b/target/msm8610/include/target/display.h
new file mode 100644
index 0000000..4c8bd15
--- /dev/null
+++ b/target/msm8610/include/target/display.h
@@ -0,0 +1,44 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ *
+ */
+
+#ifndef _TARGET_MSM8610_DISPLAY_H
+#define _TARGET_MSM8610_DISPLAY_H
+
+#define MIPI_FB_ADDR  0x0D200000
+
+#define MIPI_HSYNC_PULSE_WIDTH       8
+#define MIPI_HSYNC_BACK_PORCH_DCLK   40
+#define MIPI_HSYNC_FRONT_PORCH_DCLK  160
+
+#define MIPI_VSYNC_PULSE_WIDTH       2
+#define MIPI_VSYNC_BACK_PORCH_LINES  10
+#define MIPI_VSYNC_FRONT_PORCH_LINES 12
+
+extern int mdss_dsi_v2_phy_init(struct mipi_dsi_panel_config *);
+#endif
diff --git a/target/msm8610/init.c b/target/msm8610/init.c
index 6537a4d..da32049 100644
--- a/target/msm8610/init.c
+++ b/target/msm8610/init.c
@@ -48,6 +48,12 @@
 
 #define TLMM_VOL_UP_BTN_GPIO    72
 
+enum target_subtype {
+	HW_PLATFORM_SUBTYPE_SKUAA = 1,
+	HW_PLATFORM_SUBTYPE_SKUF = 2,
+	HW_PLATFORM_SUBTYPE_SKUAB = 3,
+};
+
 static uint32_t mmc_sdc_base[] =
 	{ MSM_SDC1_BASE, MSM_SDC2_BASE };
 
@@ -103,6 +109,11 @@
 
 	target_keystatus();
 
+	/* Display splash screen if enabled */
+	dprintf(SPEW, "Display Init: Start\n");
+	display_init();
+	dprintf(SPEW, "Display Init: Done\n");
+
 	/* Trying Slot 1*/
 	slot = 1;
 	base_addr = mmc_sdc_base[slot - 1];
@@ -131,7 +142,10 @@
 /* Detect the target type */
 void target_detect(struct board_data *board)
 {
-	board->target = LINUX_MACHTYPE_UNKNOWN;
+	/*
+	* already fill the board->target on board.c
+	*/
+
 }
 
 /* Detect the modem type */
@@ -152,6 +166,12 @@
 	{
 	case HW_PLATFORM_SUBTYPE_UNKNOWN:
 		break;
+	case HW_PLATFORM_SUBTYPE_SKUAA:
+		break;
+	case HW_PLATFORM_SUBTYPE_SKUF:
+		break;
+	case HW_PLATFORM_SUBTYPE_SKUAB:
+		break;
 	default:
 		dprintf(CRITICAL, "Platform Subtype : %u is not supported\n", platform_subtype);
 		ASSERT(0);
@@ -214,6 +234,23 @@
 	dprintf(CRITICAL, "Rebooting failed\n");
 }
 
+int target_cont_splash_screen()
+{
+	int ret = 0;
+	switch(board_hardware_id())
+	{
+		case HW_PLATFORM_MTP:
+		case HW_PLATFORM_QRD:
+		case HW_PLATFORM_SURF:
+			dprintf(SPEW, "Target_cont_splash=0\n");
+			ret = 0;
+		default:
+			dprintf(SPEW, "Target_cont_splash=0\n");
+			ret = 0;
+	}
+	return ret;
+}
+
 unsigned target_pause_for_battery_charge(void)
 {
 	uint8_t pon_reason = pm8x41_get_pon_reason();
diff --git a/target/msm8610/rules.mk b/target/msm8610/rules.mk
index 2d9f6fa..92c669f 100644
--- a/target/msm8610/rules.mk
+++ b/target/msm8610/rules.mk
@@ -14,10 +14,15 @@
 RAMDISK_ADDR     := BASE_ADDR+0x01000000
 SCRATCH_ADDR     := 0x0E000000
 
+DEFINES += DISPLAY_TYPE_8610=1
+DEFINES += DISPLAY_SPLASH_SCREEN=1
+DEFINES += DISPLAY_TYPE_MIPI=1
+
 MODULES += \
 	dev/keys \
 	lib/ptable \
 	dev/pmic/pm8x41 \
+	dev/panel/msm \
 	lib/libfdt
 
 DEFINES += \
@@ -32,4 +37,5 @@
 
 OBJS += \
     $(LOCAL_DIR)/init.o \
-    $(LOCAL_DIR)/meminfo.o
+    $(LOCAL_DIR)/meminfo.o \
+    $(LOCAL_DIR)/target_display.o
diff --git a/target/msm8610/target_display.c b/target/msm8610/target_display.c
new file mode 100644
index 0000000..4904848
--- /dev/null
+++ b/target/msm8610/target_display.c
@@ -0,0 +1,208 @@
+/* Copyright (c) 2013, The Linux Foundation. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are
+ * met:
+ *     * Redistributions of source code must retain the above copyright
+ *       notice, this list of conditions and the following disclaimer.
+ *     * Redistributions in binary form must reproduce the above
+ *       copyright notice, this list of conditions and the following
+ *       disclaimer in the documentation and/or other materials provided
+ *       with the distribution.
+ *     * Neither the name of The Linux Foundation nor the names of its
+ *       contributors may be used to endorse or promote products derived
+ *       from this software without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED "AS IS" AND ANY EXPRESS OR IMPLIED
+ * WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT
+ * ARE DISCLAIMED.  IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS
+ * 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.
+ *
+ */
+
+#include <debug.h>
+#include <smem.h>
+#include <msm_panel.h>
+#include <pm8x41.h>
+#include <pm8x41_wled.h>
+#include <board.h>
+#include <platform/gpio.h>
+#include <platform/iomap.h>
+#include <target/display.h>
+
+static struct msm_fb_panel_data panel;
+static uint8_t display_enable;
+
+extern int msm_display_init(struct msm_fb_panel_data *pdata);
+extern int msm_display_off();
+extern void dsi_phy_init(struct msm_panel_info *pinfo);
+
+static int msm8610_backlight(uint8_t enable)
+{
+	struct pm8x41_mpp mpp;
+	mpp.base = PM8x41_MMP3_BASE;
+	mpp.mode = MPP_HIGH;
+	mpp.vin = MPP_VIN3;
+	if (enable)
+ {
+		pm8x41_config_output_mpp(&mpp);
+		pm8x41_enable_mpp(&mpp, MPP_ENABLE);
+	} else {
+		pm8x41_enable_mpp(&mpp, MPP_DISABLE);
+	}
+	/* Need delay before power on regulators */
+	mdelay(20);
+	return 0;
+}
+
+void dsi_calc_clk_rate(uint32_t *dsiclk_rate, uint32_t *byteclk_rate)
+{
+	uint32_t hbp, hfp, vbp, vfp, hspw, vspw, width, height;
+	uint32_t bitclk_rate;
+	int frame_rate, lanes;
+
+	width = panel.panel_info.xres;
+	height = panel.panel_info.yres;
+	hbp = panel.panel_info.lcdc.h_back_porch;
+	hfp = panel.panel_info.lcdc.h_front_porch;
+	hspw = panel.panel_info.lcdc.h_pulse_width;
+	vbp = panel.panel_info.lcdc.v_back_porch;
+	vfp = panel.panel_info.lcdc.v_front_porch;
+	vspw = panel.panel_info.lcdc.v_pulse_width;
+	lanes = panel.panel_info.mipi.num_of_lanes;
+	frame_rate = panel.panel_info.mipi.frame_rate;
+
+	bitclk_rate = (width + hbp + hfp + hspw) * (height + vbp + vfp + vspw);
+	bitclk_rate *= frame_rate;
+	bitclk_rate *= panel.panel_info.bpp;
+	bitclk_rate /= lanes;
+
+	*byteclk_rate = bitclk_rate / 8;
+	*dsiclk_rate = *byteclk_rate * lanes;
+}
+
+static int msm8610_mdss_dsi_panel_clock(uint8_t enable)
+{
+	uint32_t dsiclk_rate, byteclk_rate;
+
+	if (enable)
+	{
+		mdp_clock_enable();
+		dsi_calc_clk_rate(&dsiclk_rate, &byteclk_rate);
+		dsi_clock_enable(dsiclk_rate, byteclk_rate);
+	} else if(!target_cont_splash_screen()) {
+		dsi_clock_disable();
+		mdp_clock_disable();
+	}
+
+	return 0;
+}
+
+static void msm8610_mdss_mipi_panel_reset(int enable)
+{
+	dprintf(SPEW, "msm8610_mdss_mipi_panel_reset, enable = %d\n", enable);
+
+	if (enable)
+	{
+		gpio_tlmm_config(41, 0, GPIO_OUTPUT, GPIO_NO_PULL, GPIO_8MA, GPIO_DISABLE);
+		gpio_tlmm_config(7, 0, GPIO_OUTPUT, GPIO_NO_PULL, GPIO_8MA, GPIO_DISABLE);
+
+		/* reset */
+		gpio_set(41, 2);
+		mdelay(20);
+		gpio_set(41, 0);
+		udelay(20);
+		gpio_set(41, 2);
+		mdelay(20);
+
+		if (panel.panel_info.type == MIPI_VIDEO_PANEL)
+			gpio_set(7, 2);
+		else if (panel.panel_info.type == MIPI_CMD_PANEL)
+			gpio_set(7, 0);
+	} else if(!target_cont_splash_screen()) {
+		gpio_set(7, 0);
+		gpio_set(41, 0);
+	}
+	return;
+}
+
+static int msm8610_mipi_panel_power(uint8_t enable)
+{
+	int ret;
+	struct pm8x41_ldo ldo4 = LDO(PM8x41_LDO4, NLDO_TYPE);
+	struct pm8x41_ldo ldo14 = LDO(PM8x41_LDO14, PLDO_TYPE);
+	struct pm8x41_ldo ldo19 = LDO(PM8x41_LDO19, PLDO_TYPE);
+
+	dprintf(SPEW, "msm8610_mipi_panel_power, enable = %d\n", enable);
+	if (enable)
+	{
+		/* backlight */
+		msm8610_backlight(enable);
+
+		/* regulators */
+		pm8x41_ldo_set_voltage(&ldo14, 1800000);
+		pm8x41_ldo_control(&ldo14, enable);
+		pm8x41_ldo_set_voltage(&ldo19, 2850000);
+		pm8x41_ldo_control(&ldo19, enable);
+		pm8x41_ldo_set_voltage(&ldo4, 1200000);
+		pm8x41_ldo_control(&ldo4, enable);
+
+		/* reset */
+		msm8610_mdss_mipi_panel_reset(enable);
+	} else if(!target_cont_splash_screen()) {
+		msm8610_backlight(0);
+		msm8610_mdss_mipi_panel_reset(enable);
+
+		pm8x41_ldo_control(&ldo19, enable);
+		pm8x41_ldo_control(&ldo14, enable);
+		pm8x41_ldo_control(&ldo4, enable);
+	}
+	return 0;
+}
+
+void display_init(void)
+{
+	uint32_t hw_id = board_hardware_id();
+
+	dprintf(SPEW, "display_init(),target_id=%d.\n", hw_id);
+
+	switch (hw_id) {
+	case HW_PLATFORM_QRD:
+	case HW_PLATFORM_MTP:
+	case HW_PLATFORM_SURF:
+		mipi_truly_video_wvga_init(&(panel.panel_info));
+		panel.clk_func = msm8610_mdss_dsi_panel_clock;
+		panel.power_func = msm8610_mipi_panel_power;
+		panel.fb.base = MIPI_FB_ADDR;
+		panel.fb.width =  panel.panel_info.xres;
+		panel.fb.height =  panel.panel_info.yres;
+		panel.fb.stride =  panel.panel_info.xres;
+		panel.fb.bpp =  panel.panel_info.bpp;
+		panel.fb.format = FB_FORMAT_RGB888;
+		panel.mdp_rev = MDP_REV_304;
+		break;
+	default:
+		return;
+	};
+
+	if (msm_display_init(&panel))
+	{
+		dprintf(CRITICAL, "Display init failed!\n");
+		return;
+	}
+
+	display_enable = 1;
+}
+
+void display_shutdown(void)
+{
+	if (display_enable)
+		msm_display_off();
+}
diff --git a/target/msm8974/init.c b/target/msm8974/init.c
index 35e0add..11a9967 100644
--- a/target/msm8974/init.c
+++ b/target/msm8974/init.c
@@ -77,6 +77,8 @@
 #define SSD_PARTITION_SIZE      8192
 #endif
 
+#define BOARD_SOC_VERSION1(soc_rev) (soc_rev >= 0x10000 && soc_rev < 0x20000)
+
 #if MMC_SDHCI_SUPPORT
 static uint32_t mmc_sdhci_base[] =
 	{ MSM_SDC1_SDHCI_BASE, MSM_SDC2_SDHCI_BASE, MSM_SDC3_SDHCI_BASE, MSM_SDC4_SDHCI_BASE };
@@ -92,6 +94,27 @@
 #endif
 }
 
+/* Check for 8974 chip */
+static int target_is_8974()
+{
+	uint32_t platform = board_platform_id();
+	int ret = 0;
+
+	switch(platform)
+	{
+		case APQ8074:
+		case MSM8274:
+		case MSM8674:
+		case MSM8974:
+			ret = 1;
+			break;
+		default:
+			ret = 0;
+	};
+
+	return ret;
+}
+
 /* Return 1 if vol_up pressed */
 static int target_volume_up()
 {
@@ -123,8 +146,8 @@
 uint32_t target_volume_down()
 {
 	/* Volume down button is tied in with RESIN on MSM8974. */
-	if (pmic_ver == PMIC_VERSION_V2)
-		return pm8x41_resin_bark_workaround_status();
+	if (target_is_8974() && (pmic_ver == PM8X41_VERSION_V2))
+		return pm8x41_v2_resin_status();
 	else
 		return pm8x41_resin_status();
 }
@@ -192,10 +215,10 @@
 	switch(board_hardware_id())
 	{
 		case HW_PLATFORM_FLUID:
-			if (soc_ver >= BOARD_SOC_VERSION2)
-				config.bus_width = DATA_BUS_WIDTH_8BIT;
-			else
+			if (target_is_8974() && BOARD_SOC_VERSION1(soc_ver))
 				config.bus_width = DATA_BUS_WIDTH_4BIT;
+			else
+				config.bus_width = DATA_BUS_WIDTH_8BIT;
 			break;
 		default:
 			config.bus_width = DATA_BUS_WIDTH_8BIT;
@@ -268,10 +291,10 @@
 	switch(board_hardware_id())
 	{
 		case HW_PLATFORM_FLUID:
-			if (soc_ver >= BOARD_SOC_VERSION2)
-				host->caps.bus_width = MMC_BOOT_BUS_WIDTH_8_BIT;
-			else
+			if (target_is_8974() && BOARD_SOC_VERSION1(soc_ver))
 				host->caps.bus_width = MMC_BOOT_BUS_WIDTH_4_BIT;
+			else
+				host->caps.bus_width = MMC_BOOT_BUS_WIDTH_8_BIT;
 			break;
 		default:
 			host->caps.bus_width = MMC_BOOT_BUS_WIDTH_8_BIT;
@@ -406,9 +429,21 @@
 	case MSM8974:
 	case MSM8274:
 	case MSM8674:
+	case MSM8274AA:
+	case MSM8274AB:
+	case MSM8274AC:
+	case MSM8674AA:
+	case MSM8674AB:
+	case MSM8674AC:
+	case MSM8974AA:
+	case MSM8974AB:
+	case MSM8974AC:
 		board->baseband = BASEBAND_MSM;
 		break;
 	case APQ8074:
+	case APQ8074AA:
+	case APQ8074AB:
+	case APQ8074AC:
 		board->baseband = BASEBAND_APQ;
 		break;
 	default:
@@ -439,10 +474,10 @@
 
 	soc_ver = board_soc_version();
 
-	if (soc_ver >= BOARD_SOC_VERSION2)
-		restart_reason_addr = RESTART_REASON_ADDR_V2;
-	else
+	if (target_is_8974() && BOARD_SOC_VERSION1(soc_ver))
 		restart_reason_addr = RESTART_REASON_ADDR;
+	else
+		restart_reason_addr = RESTART_REASON_ADDR_V2;
 
 	/* Read reboot reason and scrub it */
 	restart_reason = readl(restart_reason_addr);
@@ -458,13 +493,13 @@
 	soc_ver = board_soc_version();
 
 	/* Write the reboot reason */
-	if (soc_ver >= BOARD_SOC_VERSION2)
-		writel(reboot_reason, RESTART_REASON_ADDR_V2);
-	else
+	if (target_is_8974() && BOARD_SOC_VERSION1(soc_ver))
 		writel(reboot_reason, RESTART_REASON_ADDR);
+	else
+		writel(reboot_reason, RESTART_REASON_ADDR_V2);
 
 	/* Configure PMIC for warm reset */
-	if (pmic_ver == PMIC_VERSION_V2)
+	if (target_is_8974() && (pmic_ver == PM8X41_VERSION_V2))
 		pm8x41_v2_reset_configure(PON_PSHOLD_WARM_RESET);
 	else
 		pm8x41_reset_configure(PON_PSHOLD_WARM_RESET);
@@ -496,9 +531,20 @@
 	return 0;
 }
 
+/* Check if MSM needs VBUS mimic for USB */
+static int target_needs_vbus_mimic()
+{
+	if (target_is_8974())
+		return 0;
+
+	return 1;
+}
+
 /* Do target specific usb initialization */
 void target_usb_init(void)
 {
+	uint32_t val;
+
 	/* Enable secondary USB PHY on DragonBoard8074 */
 	if (board_hardware_id() == HW_PLATFORM_DRAGON) {
 		/* Route ChipIDea to use secondary USB HS port2 */
@@ -524,6 +570,21 @@
 		writel_relaxed(((readl_relaxed(USB_PORTSC) & 0xC0000000)
 				| 0x8c000004), USB_PORTSC);
 	}
+
+	if (target_needs_vbus_mimic())
+	{
+		/* Select and enable external configuration with USB PHY */
+		ulpi_write(ULPI_MISC_A_VBUSVLDEXTSEL | ULPI_MISC_A_VBUSVLDEXT, ULPI_MISC_A_SET);
+
+		/* Enable sess_vld */
+		val = readl(USB_GENCONFIG_2) | GEN2_SESS_VLD_CTRL_EN;
+		writel(val, USB_GENCONFIG_2);
+
+		/* Enable external vbus configuration in the LINK */
+		val = readl(USB_USBCMD);
+		val |= SESS_VLD_CTRL;
+		writel(val, USB_USBCMD);
+	}
 }
 
 /* Returns 1 if target supports continuous splash screen. */
@@ -574,7 +635,7 @@
 	dprintf(CRITICAL, "Going down for shutdown.\n");
 
 	/* Configure PMIC for shutdown. */
-	if (pmic_ver == PMIC_VERSION_V2)
+	if (target_is_8974() && (pmic_ver == PM8X41_VERSION_V2))
 		pm8x41_v2_reset_configure(PON_PSHOLD_SHUTDOWN);
 	else
 		pm8x41_reset_configure(PON_PSHOLD_SHUTDOWN);
@@ -614,3 +675,12 @@
 {
 	return _emmc_recovery_init();
 }
+
+void target_usb_stop(void)
+{
+	uint32_t platform = board_platform_id();
+
+	/* Disable VBUS mimicing in the controller. */
+	if (target_needs_vbus_mimic())
+		ulpi_write(ULPI_MISC_A_VBUSVLDEXTSEL | ULPI_MISC_A_VBUSVLDEXT, ULPI_MISC_A_CLEAR);
+}