From 9d77db3c730780c8ef5ccd4b66403ff5675cfe4e Mon Sep 17 00:00:00 2001
From: hc <hc@nodka.com>
Date: Mon, 13 May 2024 10:30:14 +0000
Subject: [PATCH] modify sin led gpio

---
 kernel/drivers/gpu/drm/bridge/analogix/analogix-anx6345.c |  594 ++++++++++++++++++++++++++--------------------------------
 1 files changed, 268 insertions(+), 326 deletions(-)

diff --git a/kernel/drivers/gpu/drm/bridge/analogix/analogix-anx6345.c b/kernel/drivers/gpu/drm/bridge/analogix/analogix-anx6345.c
index 97db139..d9164fa 100644
--- a/kernel/drivers/gpu/drm/bridge/analogix/analogix-anx6345.c
+++ b/kernel/drivers/gpu/drm/bridge/analogix/analogix-anx6345.c
@@ -1,52 +1,48 @@
-// SPDX-License-Identifier: GPL-2.0
+/* SPDX-License-Identifier: GPL-2.0-only */
 /*
- * Copyright(c) Icenowy Zheng <icenowy@aosc.io>
- * Based on analogix-anx6345.c, which is:
- *   Copyright(c) 2016, Analogix Semiconductor.
+ * Copyright(c) 2016, Analogix Semiconductor.
+ * Copyright(c) 2017, Icenowy Zheng <icenowy@aosc.io>
+ *
+ * Based on anx7808 driver obtained from chromeos with copyright:
+ * Copyright(c) 2013, Google Inc.
  */
 #include <linux/delay.h>
 #include <linux/err.h>
-#include <linux/interrupt.h>
+#include <linux/gpio/consumer.h>
 #include <linux/i2c.h>
+#include <linux/interrupt.h>
 #include <linux/kernel.h>
 #include <linux/module.h>
-#include <linux/of_gpio.h>
 #include <linux/of_platform.h>
 #include <linux/regmap.h>
-#include <linux/types.h>
-#include <linux/gpio/consumer.h>
 #include <linux/regulator/consumer.h>
+#include <linux/types.h>
 
-#include <drm/drmP.h>
 #include <drm/drm_atomic_helper.h>
+#include <drm/drm_bridge.h>
 #include <drm/drm_crtc.h>
 #include <drm/drm_crtc_helper.h>
 #include <drm/drm_dp_helper.h>
 #include <drm/drm_edid.h>
+#include <drm/drm_of.h>
+#include <drm/drm_panel.h>
+#include <drm/drm_print.h>
+#include <drm/drm_probe_helper.h>
 
 #include "analogix-i2c-dptx.h"
 #include "analogix-i2c-txcommon.h"
 
-#define I2C_NUM_ADDRESSES	2
-#define I2C_IDX_DPTX		0
-#define I2C_IDX_TXCOM		1
-
-#define XTAL_CLK		270 /* 27M */
-
 #define POLL_DELAY		50000 /* us */
 #define POLL_TIMEOUT		5000000 /* us */
 
-static const u8 anx6345_i2c_addresses[] = {
-	[I2C_IDX_DPTX]	= ANALOGIX_I2C_DPTX,
-	[I2C_IDX_TXCOM]	= ANALOGIX_I2C_TXCOMMON,
-};
+#define I2C_IDX_DPTX		0
+#define I2C_IDX_TXCOM		1
 
-struct anx6345_platform_data {
-	struct regulator *dvdd12;
-	struct regulator *dvdd25;
-	struct regulator *vcc_panel;
-	struct gpio_desc *gpiod_reset;
+static const u8 anx6345_i2c_addresses[] = {
+	[I2C_IDX_DPTX]	= 0x70,
+	[I2C_IDX_TXCOM]	= 0x72,
 };
+#define I2C_NUM_ADDRESSES	ARRAY_SIZE(anx6345_i2c_addresses)
 
 struct anx6345 {
 	struct drm_dp_aux aux;
@@ -54,13 +50,13 @@
 	struct i2c_client *client;
 	struct edid *edid;
 	struct drm_connector connector;
-	struct drm_dp_link link;
-	struct anx6345_platform_data pdata;
-	struct mutex lock;
+	struct drm_panel *panel;
+	struct regulator *dvdd12;
+	struct regulator *dvdd25;
+	struct gpio_desc *gpiod_reset;
+	struct mutex lock;	/* protect EDID access */
 
-	/*
-	 * I2C Slave addresses of ANX6345 are mapped as DPTX and SYS
-	 */
+	/* I2C Slave addresses of ANX6345 are mapped as DPTX and SYS */
 	struct i2c_client *i2c_clients[I2C_NUM_ADDRESSES];
 	struct regmap *map[I2C_NUM_ADDRESSES];
 
@@ -95,13 +91,13 @@
 {
 	struct anx6345 *anx6345 = container_of(aux, struct anx6345, aux);
 
-	return anx_aux_transfer(anx6345->map[I2C_IDX_DPTX], msg);
+	return anx_dp_aux_transfer(anx6345->map[I2C_IDX_DPTX], msg);
 }
 
 static int anx6345_dp_link_training(struct anx6345 *anx6345)
 {
 	unsigned int value;
-	u8 dp_bw;
+	u8 dp_bw, dpcd[2];
 	int err;
 
 	err = anx6345_clear_bits(anx6345->map[I2C_IDX_TXCOM],
@@ -148,18 +144,34 @@
 	if (err)
 		return err;
 
-	/* Check link capabilities */
-	err = drm_dp_link_probe(&anx6345->aux, &anx6345->link);
-	if (err < 0) {
-		DRM_ERROR("Failed to probe link capabilities: %d\n", err);
-		return err;
-	}
+	/*
+	 * Power up the sink (DP_SET_POWER register is only available on DPCD
+	 * v1.1 and later).
+	 */
+	if (anx6345->dpcd[DP_DPCD_REV] >= 0x11) {
+		err = drm_dp_dpcd_readb(&anx6345->aux, DP_SET_POWER, &dpcd[0]);
+		if (err < 0) {
+			DRM_ERROR("Failed to read DP_SET_POWER register: %d\n",
+				  err);
+			return err;
+		}
 
-	/* Power up the sink */
-	err = drm_dp_link_power_up(&anx6345->aux, &anx6345->link);
-	if (err < 0) {
-		DRM_ERROR("Failed to power up DisplayPort link: %d\n", err);
-		return err;
+		dpcd[0] &= ~DP_SET_POWER_MASK;
+		dpcd[0] |= DP_SET_POWER_D0;
+
+		err = drm_dp_dpcd_writeb(&anx6345->aux, DP_SET_POWER, dpcd[0]);
+		if (err < 0) {
+			DRM_ERROR("Failed to power up DisplayPort link: %d\n",
+				  err);
+			return err;
+		}
+
+		/*
+		 * According to the DP 1.1 specification, a "Sink Device must
+		 * exit the power saving state within 1 ms" (Section 2.5.3.1,
+		 * Table 5-52, "Sink Control Field" (register 0x600).
+		 */
+		usleep_range(1000, 2000);
 	}
 
 	/* Possibly enable downspread on the sink */
@@ -198,20 +210,27 @@
 	if (err)
 		return err;
 
-	value = drm_dp_link_rate_to_bw_code(anx6345->link.rate);
+	dpcd[0] = dp_bw;
 	err = regmap_write(anx6345->map[I2C_IDX_DPTX],
-			   SP_DP_MAIN_LINK_BW_SET_REG, value);
+			   SP_DP_MAIN_LINK_BW_SET_REG, dpcd[0]);
 	if (err)
 		return err;
 
+	dpcd[1] = drm_dp_max_lane_count(anx6345->dpcd);
+
 	err = regmap_write(anx6345->map[I2C_IDX_DPTX],
-			   SP_DP_LANE_COUNT_SET_REG, anx6345->link.num_lanes);
+			   SP_DP_LANE_COUNT_SET_REG, dpcd[1]);
 	if (err)
 		return err;
 
-	err = drm_dp_link_configure(&anx6345->aux, &anx6345->link);
+	if (drm_dp_enhanced_frame_cap(anx6345->dpcd))
+		dpcd[1] |= DP_LANE_COUNT_ENHANCED_FRAME_EN;
+
+	err = drm_dp_dpcd_write(&anx6345->aux, DP_LINK_BW_SET, dpcd,
+				sizeof(dpcd));
+
 	if (err < 0) {
-		DRM_ERROR("Failed to configure DisplayPort link: %d\n", err);
+		DRM_ERROR("Failed to configure link: %d\n", err);
 		return err;
 	}
 
@@ -221,40 +240,19 @@
 	if (err)
 		return err;
 
-	err = regmap_read_poll_timeout(anx6345->map[I2C_IDX_DPTX],
+	return regmap_read_poll_timeout(anx6345->map[I2C_IDX_DPTX],
 				       SP_DP_LT_CTRL_REG,
 				       value, !(value & SP_DP_LT_INPROGRESS),
 				       POLL_DELAY, POLL_TIMEOUT);
-	if (err)
-		return err;
-
-	return 0;
 }
 
 static int anx6345_tx_initialization(struct anx6345 *anx6345)
 {
-	struct drm_display_info *di = &anx6345->connector.display_info;
 	int err, i;
-	u32 color_depth;
 
-	switch (di->bpc) {
-	case 12:
-		color_depth = SP_IN_BPC_12BIT;
-		break;
-	case 10:
-		color_depth = SP_IN_BPC_10BIT;
-		break;
-	case 6:
-		color_depth = SP_IN_BPC_6BIT;
-		break;
-	case 8:
-	default:
-		color_depth = SP_IN_BPC_8BIT;
-		break;
-	}
-
+	/* FIXME: colordepth is hardcoded for now */
 	err = regmap_write(anx6345->map[I2C_IDX_TXCOM], SP_VID_CTRL2_REG,
-			   color_depth << SP_IN_BPC_SHIFT);
+			   SP_IN_BPC_6BIT << SP_IN_BPC_SHIFT);
 	if (err)
 		return err;
 
@@ -299,116 +297,81 @@
 	if (err)
 		return err;
 
-	err = anx6345_clear_bits(anx6345->map[I2C_IDX_TXCOM],
+	return anx6345_clear_bits(anx6345->map[I2C_IDX_TXCOM],
 				 SP_RESET_CTRL2_REG, SP_AUX_RST);
-	if (err)
-		return err;
-
-	err = anx6345_dp_link_training(anx6345);
-	if (err)
-		return err;
-
-	return 0;
 }
 
 static void anx6345_poweron(struct anx6345 *anx6345)
 {
-	struct anx6345_platform_data *pdata = &anx6345->pdata;
 	int err;
-	u32 idl;
 
-	if (WARN_ON(anx6345->powered))
-		return;
+	/* Ensure reset is asserted before starting power on sequence */
+	gpiod_set_value_cansleep(anx6345->gpiod_reset, 1);
+	usleep_range(1000, 2000);
 
-	if (pdata->dvdd12) {
-		err = regulator_enable(pdata->dvdd12);
-		if (err) {
-			DRM_ERROR("Failed to enable DVDD12 regulator: %d\n",
-				  err);
-			return;
-		}
-
-		usleep_range(1000, 2000);
-	}
-
-	if (pdata->dvdd25) {
-		err = regulator_enable(pdata->dvdd25);
-		if (err) {
-			DRM_ERROR("Failed to enable DVDD25 regulator: %d\n",
-				  err);
-			return;
-		}
-
-		usleep_range(5000, 10000);
-	}
-
-	if (pdata->vcc_panel) {
-		err = regulator_enable(pdata->vcc_panel);
-		if (err) {
-			DRM_ERROR("Failed to enable panel regulator: %d\n",
-				  err);
-			return;
-		}
-	}
-
-	err = regmap_read(anx6345->map[I2C_IDX_TXCOM], SP_DEVICE_IDL_REG, &idl);
+	err = regulator_enable(anx6345->dvdd12);
 	if (err) {
-		gpiod_direction_output(pdata->gpiod_reset, 1);
-		usleep_range(1000, 2000);
-
-		gpiod_direction_output(pdata->gpiod_reset, 0);
+		DRM_ERROR("Failed to enable dvdd12 regulator: %d\n",
+			  err);
+		return;
 	}
+
+	/* T1 - delay between VDD12 and VDD25 should be 0-2ms */
+	usleep_range(1000, 2000);
+
+	err = regulator_enable(anx6345->dvdd25);
+	if (err) {
+		DRM_ERROR("Failed to enable dvdd25 regulator: %d\n",
+			  err);
+		return;
+	}
+
+	/* T2 - delay between RESETN and all power rail stable,
+	 * should be 2-5ms
+	 */
+	usleep_range(2000, 5000);
+
+	gpiod_set_value_cansleep(anx6345->gpiod_reset, 0);
 
 	/* Power on registers module */
 	anx6345_set_bits(anx6345->map[I2C_IDX_TXCOM], SP_POWERDOWN_CTRL_REG,
-			 SP_HDCP_PD | SP_AUDIO_PD);
+			 SP_HDCP_PD | SP_AUDIO_PD | SP_VIDEO_PD | SP_LINK_PD);
 	anx6345_clear_bits(anx6345->map[I2C_IDX_TXCOM], SP_POWERDOWN_CTRL_REG,
 			   SP_REGISTER_PD | SP_TOTAL_PD);
+
+	if (anx6345->panel)
+		drm_panel_prepare(anx6345->panel);
 
 	anx6345->powered = true;
 }
 
 static void anx6345_poweroff(struct anx6345 *anx6345)
 {
-	struct anx6345_platform_data *pdata = &anx6345->pdata;
 	int err;
 
-	if (WARN_ON(!anx6345->powered))
-		return;
-
-	gpiod_set_value_cansleep(pdata->gpiod_reset, 1);
+	gpiod_set_value_cansleep(anx6345->gpiod_reset, 1);
 	usleep_range(1000, 2000);
 
-	if (pdata->vcc_panel) {
-		err = regulator_disable(pdata->vcc_panel);
-		if (err) {
-			DRM_ERROR("Failed to disable panel regulator: %d\n",
-				  err);
-			return;
-		}
+	if (anx6345->panel)
+		drm_panel_unprepare(anx6345->panel);
+
+	err = regulator_disable(anx6345->dvdd25);
+	if (err) {
+		DRM_ERROR("Failed to disable dvdd25 regulator: %d\n",
+			  err);
+		return;
 	}
 
-	if (pdata->dvdd25) {
-		err = regulator_disable(pdata->dvdd25);
-		if (err) {
-			DRM_ERROR("Failed to disable DVDD25 regulator: %d\n",
-				  err);
-			return;
-		}
+	usleep_range(5000, 10000);
 
-		usleep_range(5000, 10000);
+	err = regulator_disable(anx6345->dvdd12);
+	if (err) {
+		DRM_ERROR("Failed to disable dvdd12 regulator: %d\n",
+			  err);
+		return;
 	}
 
-	if (pdata->dvdd12) {
-		err = regulator_disable(pdata->dvdd12);
-		if (err) {
-			DRM_ERROR("Failed to disable DVDD12 regulator: %d\n",
-				  err);
-			return;
-		}
-
-		usleep_range(1000, 2000);
-	}
+	usleep_range(1000, 2000);
 
 	anx6345->powered = false;
 }
@@ -422,13 +385,21 @@
 
 	/* Power on needed modules */
 	err = anx6345_clear_bits(anx6345->map[I2C_IDX_TXCOM],
-				 SP_POWERDOWN_CTRL_REG,
-				 SP_VIDEO_PD | SP_LINK_PD);
+				SP_POWERDOWN_CTRL_REG,
+				SP_VIDEO_PD | SP_LINK_PD);
 
 	err = anx6345_tx_initialization(anx6345);
 	if (err) {
-		DRM_ERROR("Failed transmitter initialization: %d\n", err);
-		goto err_poweroff;
+		DRM_ERROR("Failed eDP transmitter initialization: %d\n", err);
+		anx6345_poweroff(anx6345);
+		return err;
+	}
+
+	err = anx6345_dp_link_training(anx6345);
+	if (err) {
+		DRM_ERROR("Failed link training: %d\n", err);
+		anx6345_poweroff(anx6345);
+		return err;
 	}
 
 	/*
@@ -438,44 +409,6 @@
 	usleep_range(10000, 15000);
 
 	return 0;
-
-err_poweroff:
-	DRM_ERROR("Failed DisplayPort transmitter initialization: %d\n", err);
-	anx6345_poweroff(anx6345);
-
-	return err;
-}
-
-static int anx6345_init_pdata(struct anx6345 *anx6345)
-{
-	struct anx6345_platform_data *pdata = &anx6345->pdata;
-	struct device *dev = &anx6345->client->dev;
-
-	/* 1.2V digital core power regulator  */
-	pdata->dvdd12 = devm_regulator_get(dev, "dvdd12");
-	if (IS_ERR(pdata->dvdd12)) {
-		DRM_ERROR("DVDD12 regulator not found\n");
-		return PTR_ERR(pdata->dvdd12);
-	}
-
-	/* 2.5V digital core power regulator  */
-	pdata->dvdd25 = devm_regulator_get(dev, "dvdd25");
-	if (IS_ERR(pdata->dvdd25)) {
-		DRM_ERROR("DVDD25 regulator not found\n");
-		return PTR_ERR(pdata->dvdd25);
-	}
-
-	/* panel power regulator  */
-	pdata->vcc_panel = devm_regulator_get(dev, "panel");
-	if (IS_ERR(pdata->vcc_panel)) {
-		DRM_ERROR("panel regulator  not found\n");
-		return PTR_ERR(pdata->vcc_panel);
-	}
-
-	/* GPIO for chip reset */
-	pdata->gpiod_reset = devm_gpiod_get(dev, "reset", GPIOD_ASIS);
-
-	return PTR_ERR_OR_ZERO(pdata->gpiod_reset);
 }
 
 static int anx6345_config_dp_output(struct anx6345 *anx6345)
@@ -494,13 +427,9 @@
 		return err;
 
 	/* Force stream valid */
-	err = anx6345_set_bits(anx6345->map[I2C_IDX_DPTX],
+	return anx6345_set_bits(anx6345->map[I2C_IDX_DPTX],
 			       SP_DP_SYSTEM_CTRL_BASE + 3,
 			       SP_STRM_FORCE | SP_STRM_CTRL);
-	if (err)
-		return err;
-
-	return 0;
 }
 
 static int anx6345_get_downstream_info(struct anx6345 *anx6345)
@@ -522,96 +451,83 @@
 	return 0;
 }
 
-static int anx6345_probe_edid_from_of(struct anx6345 *anx6345)
-{
-	const u8 *edidp;
-	int len;
-
-	if (!anx6345->bridge.of_node)
-		return -ENODEV;
-
-	edidp = of_get_property(anx6345->bridge.of_node, "edid", &len);
-	if (!edidp || len != EDID_LENGTH)
-		return -EINVAL;
-
-	anx6345->edid = devm_kmemdup(&anx6345->client->dev, edidp,
-				     len, GFP_KERNEL);
-
-	if (!anx6345->edid)
-		return -ENOMEM;
-
-	return 0;
-}
-
 static int anx6345_get_modes(struct drm_connector *connector)
 {
 	struct anx6345 *anx6345 = connector_to_anx6345(connector);
 	int err, num_modes = 0;
-
-	if (WARN_ON(!anx6345->powered))
-		return 0;
-
-	if (anx6345->edid)
-		return drm_add_edid_modes(connector, anx6345->edid);
+	bool power_off = false;
 
 	mutex_lock(&anx6345->lock);
 
-	err = anx6345_get_downstream_info(anx6345);
-	if (err) {
-		DRM_ERROR("Failed to get downstream info: %d\n", err);
-		goto unlock;
-	}
-
-	anx6345->edid = drm_get_edid(connector, &anx6345->aux.ddc);
-	if (!anx6345->edid)
-		DRM_ERROR("Failed to read EDID from panel\n");
-
 	if (!anx6345->edid) {
-		err = anx6345_probe_edid_from_of(anx6345);
+		if (!anx6345->powered) {
+			anx6345_poweron(anx6345);
+			power_off = true;
+		}
+
+		err = anx6345_get_downstream_info(anx6345);
 		if (err) {
-			DRM_ERROR("Failed to probe EDID from device tree\n");
+			DRM_ERROR("Failed to get downstream info: %d\n", err);
+			goto unlock;
+		}
+
+		anx6345->edid = drm_get_edid(connector, &anx6345->aux.ddc);
+		if (!anx6345->edid)
+			DRM_ERROR("Failed to read EDID from panel\n");
+
+		err = drm_connector_update_edid_property(connector,
+							 anx6345->edid);
+		if (err) {
+			DRM_ERROR("Failed to update EDID property: %d\n", err);
 			goto unlock;
 		}
 	}
 
-	err = drm_mode_connector_update_edid_property(connector, anx6345->edid);
-	if (err) {
-		DRM_ERROR("Failed to update EDID property: %d\n", err);
-		goto unlock;
-	}
+	num_modes += drm_add_edid_modes(connector, anx6345->edid);
 
-	num_modes = drm_add_edid_modes(connector, anx6345->edid);
+	/* Driver currently supports only 6bpc */
+	connector->display_info.bpc = 6;
 
 unlock:
+	if (power_off)
+		anx6345_poweroff(anx6345);
+
 	mutex_unlock(&anx6345->lock);
+
+	if (!num_modes && anx6345->panel)
+		num_modes += drm_panel_get_modes(anx6345->panel, connector);
 
 	return num_modes;
 }
 
 static const struct drm_connector_helper_funcs anx6345_connector_helper_funcs = {
 	.get_modes = anx6345_get_modes,
-	.best_encoder = drm_atomic_helper_best_encoder,
 };
 
-static enum drm_connector_status anx6345_detect(struct drm_connector *connector,
-						bool force)
+static void
+anx6345_connector_destroy(struct drm_connector *connector)
 {
-	return connector_status_connected;
+	drm_connector_cleanup(connector);
 }
 
 static const struct drm_connector_funcs anx6345_connector_funcs = {
 	.fill_modes = drm_helper_probe_single_connector_modes,
-	.detect = anx6345_detect,
-	.destroy = drm_connector_cleanup,
+	.destroy = anx6345_connector_destroy,
 	.reset = drm_atomic_helper_connector_reset,
 	.atomic_duplicate_state = drm_atomic_helper_connector_duplicate_state,
 	.atomic_destroy_state = drm_atomic_helper_connector_destroy_state,
 };
 
-static int anx6345_bridge_attach(struct drm_bridge *bridge)
+static int anx6345_bridge_attach(struct drm_bridge *bridge,
+				 enum drm_bridge_attach_flags flags)
 {
 	struct anx6345 *anx6345 = bridge_to_anx6345(bridge);
 	int err;
+
+	if (flags & DRM_BRIDGE_ATTACH_NO_CONNECTOR) {
+		DRM_ERROR("Fix bridge driver to make connector optional!");
+		return -EINVAL;
+	}
 
 	if (!bridge->encoder) {
 		DRM_ERROR("Parent encoder object not found");
@@ -640,11 +556,16 @@
 	drm_connector_helper_add(&anx6345->connector,
 				 &anx6345_connector_helper_funcs);
 
-	anx6345->connector.port = anx6345->client->dev.of_node;
+	err = drm_connector_register(&anx6345->connector);
+	if (err) {
+		DRM_ERROR("Failed to register connector: %d\n", err);
+		return err;
+	}
+
 	anx6345->connector.polled = DRM_CONNECTOR_POLL_HPD;
 
-	err = drm_mode_connector_attach_encoder(&anx6345->connector,
-						bridge->encoder);
+	err = drm_connector_attach_encoder(&anx6345->connector,
+					   bridge->encoder);
 	if (err) {
 		DRM_ERROR("Failed to link up connector to encoder: %d\n", err);
 		return err;
@@ -653,18 +574,19 @@
 	return 0;
 }
 
-static bool anx6345_bridge_mode_fixup(struct drm_bridge *bridge,
-				      const struct drm_display_mode *mode,
-				      struct drm_display_mode *adjusted_mode)
+static enum drm_mode_status
+anx6345_bridge_mode_valid(struct drm_bridge *bridge,
+			  const struct drm_display_info *info,
+			  const struct drm_display_mode *mode)
 {
 	if (mode->flags & DRM_MODE_FLAG_INTERLACE)
-		return false;
+		return MODE_NO_INTERLACE;
 
 	/* Max 1200p at 5.4 Ghz, one lane */
 	if (mode->clock > 154000)
-		return false;
+		return MODE_CLOCK_HIGH;
 
-	return true;
+	return MODE_OK;
 }
 
 static void anx6345_bridge_disable(struct drm_bridge *bridge)
@@ -674,22 +596,20 @@
 	/* Power off all modules except configuration registers access */
 	anx6345_set_bits(anx6345->map[I2C_IDX_TXCOM], SP_POWERDOWN_CTRL_REG,
 			 SP_HDCP_PD | SP_AUDIO_PD | SP_VIDEO_PD | SP_LINK_PD);
-}
+	if (anx6345->panel)
+		drm_panel_disable(anx6345->panel);
 
-static void anx6345_bridge_mode_set(struct drm_bridge *bridge,
-				    struct drm_display_mode *mode,
-				    struct drm_display_mode *adjusted_mode)
-{
-	struct anx6345 *anx6345 = bridge_to_anx6345(bridge);
-
-	if (WARN_ON(!anx6345->powered))
-		return;
+	if (anx6345->powered)
+		anx6345_poweroff(anx6345);
 }
 
 static void anx6345_bridge_enable(struct drm_bridge *bridge)
 {
 	struct anx6345 *anx6345 = bridge_to_anx6345(bridge);
 	int err;
+
+	if (anx6345->panel)
+		drm_panel_enable(anx6345->panel);
 
 	err = anx6345_start(anx6345);
 	if (err) {
@@ -704,9 +624,8 @@
 
 static const struct drm_bridge_funcs anx6345_bridge_funcs = {
 	.attach = anx6345_bridge_attach,
-	.mode_fixup = anx6345_bridge_mode_fixup,
+	.mode_valid = anx6345_bridge_mode_valid,
 	.disable = anx6345_bridge_disable,
-	.mode_set = anx6345_bridge_mode_set,
 	.enable = anx6345_bridge_enable,
 };
 
@@ -724,52 +643,106 @@
 	.reg_bits = 8,
 	.val_bits = 8,
 	.max_register = 0xff,
+	.cache_type = REGCACHE_NONE,
 };
 
 static const u16 anx6345_chipid_list[] = {
 	0x6345,
 };
 
+static bool anx6345_get_chip_id(struct anx6345 *anx6345)
+{
+	unsigned int i, idl, idh, version;
+
+	if (regmap_read(anx6345->map[I2C_IDX_TXCOM], SP_DEVICE_IDL_REG, &idl))
+		return false;
+
+	if (regmap_read(anx6345->map[I2C_IDX_TXCOM], SP_DEVICE_IDH_REG, &idh))
+		return false;
+
+	anx6345->chipid = (u8)idl | ((u8)idh << 8);
+
+	if (regmap_read(anx6345->map[I2C_IDX_TXCOM], SP_DEVICE_VERSION_REG,
+			&version))
+		return false;
+
+	for (i = 0; i < ARRAY_SIZE(anx6345_chipid_list); i++) {
+		if (anx6345->chipid == anx6345_chipid_list[i]) {
+			DRM_INFO("Found ANX%x (ver. %d) eDP Transmitter\n",
+				 anx6345->chipid, version);
+			return true;
+		}
+	}
+
+	DRM_ERROR("ANX%x (ver. %d) not supported by this driver\n",
+		  anx6345->chipid, version);
+
+	return false;
+}
+
 static int anx6345_i2c_probe(struct i2c_client *client,
 			     const struct i2c_device_id *id)
 {
 	struct anx6345 *anx6345;
-	struct anx6345_platform_data *pdata;
-	unsigned int i, idl, idh, version;
-	bool found = false;
-	int err;
+	struct device *dev;
+	int i, err;
 
 	anx6345 = devm_kzalloc(&client->dev, sizeof(*anx6345), GFP_KERNEL);
 	if (!anx6345)
 		return -ENOMEM;
 
-	pdata = &anx6345->pdata;
-
 	mutex_init(&anx6345->lock);
 
-#if IS_ENABLED(CONFIG_OF)
 	anx6345->bridge.of_node = client->dev.of_node;
-#endif
 
 	anx6345->client = client;
 	i2c_set_clientdata(client, anx6345);
 
-	err = anx6345_init_pdata(anx6345);
-	if (err) {
-		DRM_ERROR("Failed to initialize pdata: %d\n", err);
+	dev = &anx6345->client->dev;
+
+	err = drm_of_find_panel_or_bridge(client->dev.of_node, 1, 0,
+					  &anx6345->panel, NULL);
+	if (err == -EPROBE_DEFER)
 		return err;
+
+	if (err)
+		DRM_DEBUG("No panel found\n");
+
+	/* 1.2V digital core power regulator  */
+	anx6345->dvdd12 = devm_regulator_get(dev, "dvdd12");
+	if (IS_ERR(anx6345->dvdd12)) {
+		if (PTR_ERR(anx6345->dvdd12) != -EPROBE_DEFER)
+			DRM_ERROR("Failed to get dvdd12 supply (%ld)\n",
+				  PTR_ERR(anx6345->dvdd12));
+		return PTR_ERR(anx6345->dvdd12);
+	}
+
+	/* 2.5V digital core power regulator  */
+	anx6345->dvdd25 = devm_regulator_get(dev, "dvdd25");
+	if (IS_ERR(anx6345->dvdd25)) {
+		if (PTR_ERR(anx6345->dvdd25) != -EPROBE_DEFER)
+			DRM_ERROR("Failed to get dvdd25 supply (%ld)\n",
+				  PTR_ERR(anx6345->dvdd25));
+		return PTR_ERR(anx6345->dvdd25);
+	}
+
+	/* GPIO for chip reset */
+	anx6345->gpiod_reset = devm_gpiod_get(dev, "reset", GPIOD_OUT_LOW);
+	if (IS_ERR(anx6345->gpiod_reset)) {
+		DRM_ERROR("Reset gpio not found\n");
+		return PTR_ERR(anx6345->gpiod_reset);
 	}
 
 	/* Map slave addresses of ANX6345 */
 	for (i = 0; i < I2C_NUM_ADDRESSES; i++) {
 		if (anx6345_i2c_addresses[i] >> 1 != client->addr)
-			anx6345->i2c_clients[i] = i2c_new_dummy(client->adapter,
+			anx6345->i2c_clients[i] = i2c_new_dummy_device(client->adapter,
 						anx6345_i2c_addresses[i] >> 1);
 		else
 			anx6345->i2c_clients[i] = client;
 
-		if (!anx6345->i2c_clients[i]) {
-			err = -ENOMEM;
+		if (IS_ERR(anx6345->i2c_clients[i])) {
+			err = PTR_ERR(anx6345->i2c_clients[i]);
 			DRM_ERROR("Failed to reserve I2C bus %02x\n",
 				  anx6345_i2c_addresses[i]);
 			goto err_unregister_i2c;
@@ -787,48 +760,15 @@
 
 	/* Look for supported chip ID */
 	anx6345_poweron(anx6345);
+	if (anx6345_get_chip_id(anx6345)) {
+		anx6345->bridge.funcs = &anx6345_bridge_funcs;
+		drm_bridge_add(&anx6345->bridge);
 
-	err = regmap_read(anx6345->map[I2C_IDX_TXCOM], SP_DEVICE_IDL_REG,
-			  &idl);
-	if (err)
-		goto err_poweroff;
-
-	err = regmap_read(anx6345->map[I2C_IDX_TXCOM], SP_DEVICE_IDH_REG,
-			  &idh);
-	if (err)
-		goto err_poweroff;
-
-	anx6345->chipid = (u8)idl | ((u8)idh << 8);
-
-	err = regmap_read(anx6345->map[I2C_IDX_TXCOM], SP_DEVICE_VERSION_REG,
-			  &version);
-	if (err)
-		goto err_poweroff;
-
-	for (i = 0; i < ARRAY_SIZE(anx6345_chipid_list); i++) {
-		if (anx6345->chipid == anx6345_chipid_list[i]) {
-			DRM_INFO("Found ANX%x (ver. %d) eDP Transmitter\n",
-				 anx6345->chipid, version);
-			found = true;
-			break;
-		}
-	}
-
-	if (!found) {
-		DRM_ERROR("ANX%x (ver. %d) not supported by this driver\n",
-			  anx6345->chipid, version);
+		return 0;
+	} else {
+		anx6345_poweroff(anx6345);
 		err = -ENODEV;
-		goto err_poweroff;
 	}
-
-	anx6345->bridge.funcs = &anx6345_bridge_funcs;
-
-	drm_bridge_add(&anx6345->bridge);
-
-	return 0;
-
-err_poweroff:
-	anx6345_poweroff(anx6345);
 
 err_unregister_i2c:
 	unregister_i2c_dummy_clients(anx6345);
@@ -843,6 +783,10 @@
 
 	unregister_i2c_dummy_clients(anx6345);
 
+	kfree(anx6345->edid);
+
+	mutex_destroy(&anx6345->lock);
+
 	return 0;
 }
 
@@ -852,13 +796,11 @@
 };
 MODULE_DEVICE_TABLE(i2c, anx6345_id);
 
-#if IS_ENABLED(CONFIG_OF)
 static const struct of_device_id anx6345_match_table[] = {
 	{ .compatible = "analogix,anx6345", },
 	{ /* sentinel */ },
 };
 MODULE_DEVICE_TABLE(of, anx6345_match_table);
-#endif
 
 static struct i2c_driver anx6345_driver = {
 	.driver = {

--
Gitblit v1.6.2