Untitled
unknown
plain_text
10 months ago
35 kB
18
Indexable
# To use this config, the firmware should be compiled for the STM32F446. # When calling "menuconfig", enable "extra low-level configuration setup" # and select the "12MHz crystal" as clock reference # For flashing, write the compiled klipper.bin to memory location 0x08000000 # See docs/Config_Reference.md for a description of parameters. ## Voron Design VORON2 250/300/350mm Spider TMC2209 UART config ## *** THINGS TO CHANGE/CHECK: *** ## Spider version Please round search 'Spider', you need to choose Spider v1.x or v2.x pins define ## MCU paths [mcu] section ## Thermistor types [extruder] and [heater_bed] sections - See 'sensor types' list at end of file ## Z Endstop Switch location [safe_z_home] section ## Homing end position [gcode_macro G32] section ## Z Endstop Switch offset for Z0 [stepper_z] section ## Probe points [quad_gantry_level] section ## Min & Max gantry corner postions [quad_gantry_level] section ## PID tune [extruder] and [heater_bed] sections ## Fine tune E steps [extruder] section [include sensorless.cfg] [include mainsail.cfg] [include btt-filament-sensor.cfg] [resonance_tester] accel_chip: adxl345 probe_points: 150, 150, 20 [adxl345] #cs_pin: rpi:gpiochip1/gpio227 #spi_bus: spidev1.0 cs_pin: EBBCan: PB12 spi_software_sclk_pin: EBBCan: PB10 spi_software_mosi_pin: EBBCan: PB11 spi_software_miso_pin: EBBCan: PB2 axes_map: x,y,z #[mcu rpi] #serial: /tmp/klipper_host_mcu #[mcu] ## Uncomment below if you're using the Raspberry uart0 to communicate with Spider #restart_method: command ## You need to select 'Communication interface' to USB in 'make menuconfig' ## when you compile Klipper for Spider ## Obtain definition by "ls -l /dev/serial/by-id/" then unplug to verify ##-------------------------------------------------------------------- [mcu] serial: /dev/serial/by-id/usb-Klipper_Klipper_firmware_12345-if00 [mcu EBBCan] canbus_uuid:77269772afac [include gcodemacros.cfg] #[include KAMP_Settings.cfg] ## If you want to use the Raspberry uart0 to communicate with Spider, ## you need to select 'Communication interface' to 'Serial (on USART1 PA10/PA9)' ## in 'make menuconfig' when you compile klipper and set the serial as below ##-------------------------------------------------------------------- #serial: /dev/ttyAMA0 ##-------------------------------------------------------------------- [printer] kinematics: corexy # 运动学结构 分为笛卡尔和corexy等等,Voron2.4是corexy max_velocity: 400 # 最大速度 max_accel: 9000 # 最大加速度 最大4000 max_z_velocity: 20 # z轴最大速度 max_z_accel: 300 # z轴最大加速度 #square_corner_velocity: 12.0 # 方形拐角速度,小一点可以有效避免平台重带来的惯性 square_corner_velocity: 5.0 # 方形拐角速度,小一点可以有效避免平台重带来的惯性 ##################################################################### # X/Y步进电机设置 ##################################################################### ######################## X轴设置 ######################## [stepper_x] ## Connected to X-MOT (B Motor) ## SPIDER 3.0 ############################################## #step_pin: PE11 # X轴电机脉冲引脚设置 #dir_pin: !PE10 # X轴电机方向引脚设置 #enable_pin: !PE9 # X轴电机使能引脚设置 ############################################################ step_pin: PF13 # X轴电机脉冲引脚设置 dir_pin: !PF12 # X轴电机方向引脚设置 enable_pin: !PF14 # X轴电机使能引脚设置 rotation_distance: 40 # 主动带轮周长mm(2GT-20T带轮40,2GT-16T带轮32) microsteps: 16 # 电机细分设置 full_steps_per_rotation:200 # 电机单圈所需脉冲数(1.8度电机:200,0.9度电机:400) #endstop_pin: ^PB14 # 限位开关PIN脚设置(X-) endstop_pin: tmc2209_stepper_x:virtual_endstop position_min: 0 homing_positive_dir: true # X轴最小行程--软件限位 ##-------------------------------------------------------------------- ## Uncomment for 350mm build position_endstop: 300 # X轴的机械复位点坐标(如果是350机型,需更改为350) position_max: 300 # X轴最大行程--软件限位(如果是350机型,需更改为350) ##-------------------------------------------------------------------- homing_speed: 20 # 复位速度最大100 60 homing_retract_dist: 0 # 第一次触发复位开关之后的后退距离 5 #homing_positive_dir: true # 复位方向(一般不需要改动) step_pulse_duration:0.000004 ## Make sure to update below for your relevant driver (2208 or 2209) [tmc2209 stepper_x] # 步进电机-x tmc2209驱动 ## spider v3.0 ######################################################## #uart_pin: PE7 # 通讯端口Pin脚定义 ####################################################################### uart_pin: PC4 # 通讯端口Pin脚定义 #sensorless homing #diag_pin:^PB14 SPIDER V3.0 diag_pin:^PG6 driver_SGTHRS: 65 ##--------- interpolate: True # 是否开启256微步插值 run_current: 1.0 # 电机运行电流值 sense_resistor: 0.110 # 驱动采样电阻不要改 stealthchop_threshold: 0 # 静音阀值 200 ## Make sure to update below for your relevant driver (5160) #[tmc5160 stepper_x] #spi_bus: spi4 #cs_pin: PE7 #interpolate: True #diag1_pin: PB14 #run_current: 0.800 #hold_current: 0.500 ##stealthchop_threshold: 0 ######################## y轴设置 ######################## [stepper_y] ## Connected to Y-MOT (A Motor) ## SPIDER 3.0 ############################################## #step_pin: PD8 # Y轴电机脉冲引脚 #dir_pin: !PB12 # 方向设置 #enable_pin: !PD9 # 使能引脚 ############################################################ step_pin: PG0 # Y轴电机脉冲引脚 dir_pin: !PG1 # 方向设置 enable_pin: !PF15 # 使能引脚 rotation_distance: 40 # 主动轮周长mm (2GT-20T为 40mm 16T为 32mm) microsteps: 16 # 细分 full_steps_per_rotation:200 # 单圈脉冲数-对于0.9度步进设置为400 #endstop_pin: ^PB13 # 限位开关接口 #sensorless homing endstop_pin: tmc2209_stepper_y:virtual_endstop ##--------- position_min: 0 # 软限位最小行程 step_pulse_duration:0.000004 ##-------------------------------------------------------------------- ## Uncomment for 350mm build position_endstop: 300 # y轴的机械复位点坐标(如果是350机型,需更改为350) position_max: 300 # y轴最大行程--软件限位(如果是350机型,需更改为350) ##-------------------------------------------------------------------- homing_speed: 20 # 复位速度最大 100 60 homing_retract_dist: 0 # 第一次触发复位开关之后的后退距离 5 homing_positive_dir: true # 复位方向(一般不需要改动) ## Make sure to update below for your relevant driver (2208 or 2209) [tmc2209 stepper_y] # 步进电机-y tmc2209驱动 ## SPIDER 3.0 ############################################## #uart_pin: PE15 # 驱动通信端口 ############################################################ uart_pin: PD11 # 驱动通信端口 #sensorless homing #diag_pin:^PB13 SPIDER V3.0 diag_pin:^PG9 driver_SGTHRS: 59 ##--------- interpolate: True # 微步插值256 run_current: 1.0 # 运行电流mA sense_resistor: 0.110 # 驱动采样电阻不要改 stealthchop_threshold: 0 # 静音阀值 200 ## Make sure to update below for your relevant driver (5160) #[tmc5160 stepper_y] #spi_bus: spi4 #cs_pin: PE15 ##diag1_pin: PB13 #interpolate: True #run_current: 0.8 #hold_current: 0.7 ##stealthchop_threshold: 0 ##################################################################### # Z轴步进电机 ##################################################################### ## In Z-MOT Position ## Z0 步进电机 - 左前 on MOTOR2_1 [stepper_z] # 步进电机-z ## SPIDER 3.0 ############################################## #step_pin: PE6 # Z电机脉冲引脚 #dir_pin: PC13 # 方向设置 #enable_pin: !PE5 # 使能引脚 ############################################################ step_pin: PF11 # Z电机脉冲引脚 dir_pin: !PG3 # 方向设置 enable_pin: !PG5 # 使能引脚 rotation_distance: 4 # 主动轮周长mm (2GT-20T为 40mm 16T为 32mm) # 减速比 microsteps: 16 # 细分 ## In Z- Position #endstop_pin: ^PA0 # 限位开关接口 endstop_pin: probe:z_virtual_endstop ## Z-position of nozzle (in mm) to z-endstop trigger point relative to print surface (Z0) ## (+) value = endstop above Z0, (-) value = endstop below ## Increasing position_endstop brings nozzle closer to the bed ## After you run Z_ENDSTOP_CALIBRATE, position_endstop will be stored at the very end of your config #position_endstop: -0.5 ##-------------------------------------------------------------------- ## Uncomment below for 350mm build position_max: 280 ##-------------------------------------------------------------------- position_min: -5 # 软限位最小行程(配置喷嘴清洁需要-5左右) homing_speed: 50 # 复位速度-最大 20 second_homing_speed: 10 # 二次复位速度-最大 10 homing_retract_dist: 3 # 后撤距离 ## Make sure to update below for your relevant driver (2208 or 2209) [tmc2209 stepper_z] # 步进电机-z tmc2209驱动 ## SPIDER 3.0 ############################################## #uart_pin: PC14 # 驱动通信端口 ############################################################ uart_pin: PC6 # 驱动通信端口 uart_address: 0 interpolate: True # 微步插值256 run_current: 1.0 # 运行电流mA hold_current: 1.0 # 保持电流mA sense_resistor: 0.110 # 驱动采样电阻不要改 stealthchop_threshold: 0 # 静音阀值 200 ## In E2-MOT Position ## Z2 Stepper - Rear Right [stepper_z1] # 步进电机-z2 ## SPIDER 3.0 ############################################## #step_pin: PE2 # Z2电机脉冲引脚 #dir_pin: PE4 # 方向设置 #enable_pin: !PE3 # 使能引脚 ############################################################ step_pin: PG4 # Z2电机脉冲引脚 dir_pin: !PC1 # 方向设置 enable_pin: !PA0 # 使能引脚 rotation_distance: 4 # 主动轮周长mm (2GT-20T为 40mm 16T为 32mm) microsteps: 16 # 细分 ## Make sure to update below for your relevant driver (2208 or 2209) [tmc2209 stepper_z1] # 步进电机-z2 tmc2209驱动 ## SPIDER 3.0 ############################################## #uart_pin: PC15 # 驱动通信端口 ############################################################ uart_pin: PC7 # 驱动通信端口 interpolate: True # 微步插值256 run_current: 1.0 # 运行电流mA hold_current: 1.0 # 保持电流mA sense_resistor: 0.110 # 驱动采样电阻不要改 stealthchop_threshold: 0 # 静音阀值 200 ## In E3-MOT Position ## Z3 步进电机 - 右前 on MOTOR5 [stepper_z2] # 步进电机-z3 ## SPIDER 3.0 ############################################## #step_pin: PD12 # Z3电机脉冲引脚 #dir_pin: PC4 # 方向设置 #enable_pin: !PE8 # 使能引脚 ############################################################ step_pin: PF9 # Z3电机脉冲引脚 dir_pin: !PF10 # 方向设置 enable_pin: !PG2 # 使能引脚 rotation_distance: 4 # 主动轮周长mm (2GT-20T为 40mm 16T为 32mm) microsteps: 16 # 细分 [tmc2209 stepper_z2] # 步进电机-z3 tmc2209驱动 ## SPIDER 3.0 ############################################## #uart_pin: PA15 # 驱动通信端口 ############################################################ uart_pin: PF2 # 驱动通信端口 interpolate: True # 微步插值256 run_current: 1.0 # 运行电流mA hold_current: 1.0 # 保持电流mA sense_resistor: 0.110 # 驱动采样电阻不要改 stealthchop_threshold: 0 # 静音阀值 200 ##################################################################### # 挤出机配置 ##################################################################### ## In E0-MOT Position [extruder] # 挤出机 #step_pin: PD5 # E0电机脉冲引脚 #dir_pin: !PD6 # 方向引脚设置 #enable_pin: !PD4 # 使能引脚设置 step_pin: EBBCan: PD0 dir_pin: !EBBCan: PD1 enable_pin: !EBBCan: PD2 ## Update value below when you perform extruder calibration ## If you ask for 100mm of filament, but in reality it is 98mm: ## rotation_distance = <previous_rotation_distance> * <actual_extrude_distance> / 100 ## 22.6789511 is a good starting point # rotation_distance: 4.343783 # 步进值-Bondtech 5mm 驱动齿轮 CW2 rotation_distance: 47.370528 # Galileo 2 ## Update Gear Ratio depending on your Extruder Type ## Use 50:17 for Afterburner/Clockwork (BMG Gear Ratio) ## Use 80:20 for M4, M3.1 gear_ratio: 9:1 # Galileo 2 #gear_ratio: 50:10 # BMG 传动比 microsteps: 16 # 细分 full_steps_per_rotation: 200 # 单圈脉冲数 (200 为 1.8 度, 400 为 0.9 度) nozzle_diameter: 0.400 # 喷嘴直径 filament_diameter: 1.75 # 耗材直径 max_extrude_only_distance: 500 ## In E0 OUT Position #heater_pin: PB15 # 加热棒引脚 heater_pin: EBBCan: PB13 ## Validate the following thermistor type to make sure it is correct #sensor_type: ATC Semitec 104GT-2 #传感器型号 (NTC 100K beta 3950,ATC Semitec 104GT-2) sensor_type: MAX31865 #sensor_type: EPCOS 100K B57560G104F #sensor_type: Generic 3950 #sensor_pin: PC0 # 传感器接口 sensor_pin: EBBCan: PA4 min_temp: 10 # 最小温度 max_temp: 350 # 最大温度 max_power: 1.0 # 最大功率 min_extrude_temp: 170 # 最小挤出温度 #control = pid # PID喷嘴温度自动校准项(默认被注释) #pid_kp = 26.213 # PID喷嘴温度自动校准项(默认被注释) #pid_ki = 1.304 # PID喷嘴温度自动校准项(默认被注释) #pid_kd = 131.721 # PID喷嘴温度自动校准项(默认被注释) ## Try to keep pressure_advance below 1.0 #pressure_advance: 0.025 # 推进压力-尽量将压力保持在1.0以下 pressure_advance: 0.04 ## Default is 0.040, leave stock pressure_advance_smooth_time: 0.07685 # 平稳推进时间-默认值为0.040 ## In E0-MOT Position ## Make sure to update below for your relevant driver (2208 or 2209) #[tmc2209 extruder] # 挤出机 tmc2209驱动 #uart_pin: PD7 # 驱动通信端口 #uart_pin: EBBCan: PA15 #interpolate: false # 微步插值256 #run_current: 0.5 # 运行电流mA #sense_resistor: 0.110 # 驱动采样电阻不要改 #stealthchop_threshold: 0 # 静音阀值 200 #[tmc2240 extruder] #cs_pin: EBBCan: PA15 spi_software_sclk_pin: EBBCan: PA5 spi_software_mosi_pin: EBBCan: PA7 spi_software_miso_pin: EBBCan: PA6 #driver_TPFD: 0 #run_current: 0.650 #stealthchop_threshold: 0 #[tmc2240 extruder] #cs_pin: EBBCan:PA15 #spi_speed: 500000 #spi_software_sclk_pin: EBBCan:PB10 #spi_software_mosi_pin: EBBCan:PB11 #spi_software_miso_pin: EBBCan:PB2 #run_current: 0.6 #rref: 12000 #stealthchop_threshold: 0 #0 to disable [tmc2209 extruder] uart_pin: EBBCan: PA15 run_current: 0.6 stealthchop_threshold: 0 interpolate: False # The velocity (in mm/s) to set the "stealthChop" threshold to. When # set, "stealthChop" mode will be enabled if the stepper motor # velocity is below this value. The default is 0, which disables # "stealthChop" mode. driver_IHOLDDELAY: 8 #driver_IRUNDELAY: 2 #ebb sb 2240 #driver_TPOWERDOWN: 10 driver_TBL: 3 driver_TOFF: 4 driver_HEND: 3 driver_HSTRT: 4 #driver_FD3: 0 #driver_TPFD: 0 #ebb sb 2240 ##driver_CHM: 0 ##driver_VHIGHFS: 0 ##driver_VHIGHCHM: 0 ##driver_DISS2G: 0 ##driver_DISS2VS: 1 driver_PWM_AUTOSCALE: True driver_PWM_AUTOGRAD: True #driver_PWM_FREQ: 2 ##driver_FREEWHEEL: 0 driver_PWM_GRAD: 12 driver_PWM_OFS: 40 driver_PWM_REG: 15 driver_PWM_LIM: 12 #driver_SGT: 30 #ebb sb 2240 #driver_SEMIN: 2 #ebb sb 2240 #driver_SEUP: 3 #driver_SEMAX: 8 #ebb sb 2240 #driver_SEDN: 2 #driver_SEIMIN: 0 #driver_SFILT: 1 #driver_SG4_ANGLE_OFFSET: 1 #diag0_pin: EBBCan:PB3 #ebb sb 2240 #diag1_pin: # The micro-controller pin attached to one of the DIAG lines of the # TMC2240 chip. Only a single diag pin should be specified. The pin # is "active low" and is thus normally prefaced with "^!". Setting # this creates a "tmc2240_stepper_x:virtual_endstop" virtual pin # which may be used as the stepper's endstop_pin. Doing this enables # "sensorless homing". (Be sure to also set driver_SGT to an # appropriate sensitivity value.) The default is to not enable # sensorless homing. [gcode_macro configure_extruder] gcode: #SET_TMC_FIELD STEPPER=extruder FIELD=pwm_meas_sd_enable VALUE=1 #BTT EBB SB 2240 #SET_TMC_FIELD STEPPER=extruder FIELD=sg4_filt_en VALUE=1 SET_TMC_FIELD STEPPER=extruder FIELD=freewheel VALUE=1 SET_TMC_FIELD STEPPER=extruder FIELD=SG4_THRS VALUE=10 SET_TMC_FIELD STEPPER=extruder FIELD=IHOLD VALUE=0 SET_TMC_FIELD STEPPER=extruder FIELD=THIGH VELOCITY=50 SET_TMC_FIELD STEPPER=extruder FIELD=TCOOLTHRS VALUE=4000 SET_TMC_FIELD STEPPER=extruder FIELD=TPWMTHRS VELOCITY=1 SET_TMC_FIELD STEPPER=extruder FIELD=OVERTEMPPREWARNING_VTH VALUE=2885 # 7.7 * 100 C + 2038 {% set v = (24.7/0.009732)|int %} SET_TMC_FIELD STEPPER=extruder FIELD=OVERVOLTAGE_VTH VALUE={ v } [delayed_gcode configure_extruder_startup] initial_duration: 1 gcode: configure_extruder ##################################################################### # 热床配置 ##################################################################### [heater_bed] ## SSR Pin - In BED OUT position ## SPIDER 3.0 ############################################## #heater_pin: PB4 # 热床接口 ############################################################ heater_pin: PA3 # 热床接口 sensor_type: Generic 3950 # 热床传感器类型 ## SPIDER 3.0 ############################################## #sensor_pin: PC3 # 热床传感器接口v1.x #sensor_pin: PB0 # 热床传感器接口v2.x ############################################################ sensor_pin: PF3 # 热床传感器接口v2.x ## Adjust Max Power so your heater doesn't warp your bed max_power: 0.8 # 热床功率 min_temp: -70 # 最小温度(注意:测量温度超过设定值会触发紧急停止) max_temp: 125 # 最大温度(注意:测量温度超过设定值会触发紧急停止) #control: pid # PID热床温度自动校准项(默认被注释) #pid_kp: 58.437 # PID热床温度自动校准项(默认被注释) #pid_ki: 2.347 # PID热床温度自动校准项(默认被注释) #pid_kd: 363.769 # PID热床温度自动校准项(默认被注释) ##################################################################### # Probe感应探头 ##################################################################### [probe] ## Inductive Probe - If you use this section , please comment the [bltouch] section ## This probe is not used for Z height, only Quad Gantry Leveling ## In Z+ position ## If your probe is NC instead of NO, add change pin to ^PA3 #pin: PA3 # 信号接口 #pin: ^EBBCan: PC13 # Omron Probe pin: ^EBBCan: PB5 # Tap x_offset: 0 # X轴-传感器相对喷嘴偏移量 y_offset: 0 #y_offset: 25.0 # Y轴-传感器相对喷嘴偏移量 #z_offset: 0 # Z轴-传感器相对喷嘴偏移量 speed: 50.0 # 调平速度 samples: 3 # 采样次数 samples_result: median # 取值方式(默认median-中位数) sample_retract_dist: 3.0 # 调平回缩距离 samples_tolerance: 0.01 # 采样公差(注意过小的值可能造成采样次数增加) samples_tolerance_retries: 3 # 超公差重试次数 activate_gcode: {% set PROBE_TEMP = 150 %} {% set MAX_TEMP = PROBE_TEMP + 5 %} {% set ACTUAL_TEMP = printer.extruder.temperature %} {% set TARGET_TEMP = printer.extruder.target %} {% if TARGET_TEMP > PROBE_TEMP %} { action_respond_info('Extruder temperature target of %.1fC is too high, lowering to %.1fC' % (TARGET_TEMP, PROBE_TEMP)) } M109 S{ PROBE_TEMP } {% else %} # Temperature target is already low enough, but nozzle may still be too hot. {% if ACTUAL_TEMP > MAX_TEMP %} { action_respond_info('Extruder temperature %.1fC is still too high, waiting until below %.1fC' % (ACTUAL_TEMP, MAX_TEMP)) } TEMPERATURE_WAIT SENSOR=extruder MAXIMUM={ MAX_TEMP } {% endif %} {% endif %} ##################################################################### # 风扇配置 ##################################################################### ## Hotend Fan - FAN1 [heater_fan hotend_fan] # 喉管冷却风扇 ## Hotend Fan - FAN0 Connector #pin: PB0 # 信号接口v1.x #pin: PA13 # 信号接口v2.x pin: EBBCan: PA0 max_power: 1.0 # 最大转速 kick_start_time: 0.5 # 启动时间(勿动) heater: extruder # 关联的设备:挤出机 heater_temp: 50.0 # 挤出机达到多少度启动风扇 ## If you are experiencing back flow, you can reduce fan_speed fan_speed: 1.0 # 风扇转速 ## Part Cooling Fan - FAN0 [fan] # 模型冷却风扇 ## Print Cooling Fan - FAN1 Connector #pin: PB1 # 信号接口v1.x #pin: PA14 # 信号接口v2.x pin: EBBCan: PA1 max_power: 1.0 # 最大转速 kick_start_time: 0.5 # 启动时间(勿动) ## Depending on your fan, you may need to increase this value ## if your fan will not start. Can change cycle_time (increase) ## if your fan is not able to slow down effectively off_below: 0.10 # 勿动 #[heater_fan controller_fan] # 电器仓风扇 ## Controller fan - FAN2 Connector #pin: PC8 # 信号接口 #kick_start_time: 0.5 # 启动时间(勿动) #heater: heater_bed # 关联的设备:热床 #heater_temp: 45.0 # 热床达到多少度启动风扇 #[duplicate_pin_override] #pins: PC8 [controller_fan controller_fan] ## SPIDER 3.0 ############################################## #pin: PC8 ############################################################ pin: PD12 kick_start_time: 0.500 max_power: 0.4 fan_speed: 1.0 heater: heater_bed #[temperature_fan board_fans] #pin: PC8 #kick_start_time: 0.8 #shutdown_speed: 0 #off_below: 0.1 #max_power: 1.0 #fan_speed: 0.6 #sensor_type: temperature_host #control: pid #min_temp: -40 #max_temp: 85 #max_delta: 5.0 #pid_kp: 1.0 #pid_ki: 0.5 #pid_kd: 2.0 #min_speed: 0.1 #max_speed: 0.6 #target_temp: 38 [fan_generic exhaust_fan] # 打印仓排风扇 ## Exhaust fan - In E2 OUT Positon ## SPIDER 3.0 ############################################## #pin: PB3 # 信号接口 ############################################################ pin: PD13 # 信号接口 max_power: 1.0 # 最大转速 shutdown_speed: 0.0 # 关闭速度(勿动) kick_start_time: 5.0 # 开启时间(勿动) #heater: heater_bed # 关联的设备:热床 #heater_temp: 60 # 热床达到多少度启动风扇 #fan_speed: 1.0 # 风扇转速 ##################################################################### # NEVERMORE V6 ##################################################################### [fan_generic Nevermore] ## Nevermore - FAN5 on Octopus ## Adjust if you use a different board or a different terminal. pin: PD14 [menu __main __control __nevermoreonoff] type: command name: Nevermore {'ON' if printer['fan_generic Nevermore'].speed > 0 else 'OFF'} enable: {'fan_generic Nevermore' in printer} gcode: TOGGLE_NEVERMORE [menu __main __control __filterspeed] type: input enable: {'fan_generic Nevermore' in printer} name: Filter %: {'%3d' % (menu.input*100)}% input: {printer["fan_generic Nevermore"].speed} input_min: 0 input_max: 1 input_step: 0.1 gcode: SET_FAN_SPEED FAN=Nevermore SPEED={menu.input} [delayed_gcode filter_off] gcode: SET_FAN_SPEED FAN=Nevermore SPEED=0 ##################################################################### # LED控制 ##################################################################### [neopixel my_neopixel] # 输入英文的中括号启用这个定义 #pin:PD3 # 主板引脚定义 pin: EBBCan:PD3 chain_count:26 # 灯珠数量 color_order: GRBW # 颜色顺序 initial_RED: 0 # 红色 灯开机默认值最大是1 initial_GREEN: 1 # 绿色 灯开机默认值最大是1 initial_BLUE: 0 # 蓝色 灯开机默认值最大是1 ##################################################################### # 闲置关闭热床 ##################################################################### #[idle_timeout] #timeout: 1800 # 空闲时间超过30分钟则关闭热床 #[safe_z_home] # Z轴限位坐标 #home_xy_position:171,300 # Z原点所在的X、Y坐标(如100,100), 执行。必须提供此参数。 #speed:100 # 喷头移动到安全Z原点的速度,默认值为50 mm/s #z_hop:10 # 归位前提升Z轴的距离(mm),应用于任何归位命令,即使它没有使Z轴归位 #z_hop_speed: 10 # 归位前Z轴提升的速度(mm/s) 默认为20mm/s. #move_to_previous: False # 当设置为true时,xy将重置为z原点后重置为以前的位置,默认为 False. [exclude_object] ##################################################################### # 控制归位和龙门架调平 ##################################################################### [idle_timeout] timeout: 40000 [bed_mesh] speed: 100 horizontal_move_z: 10 mesh_min: 40, 40 mesh_max: 260,260 fade_start: 0.6 fade_end: 10.0 probe_count: 5,5 algorithm: bicubic zero_reference_position: 150,150 [z_tilt] z_positions: -50, 18 150, 348 350, 18 points: 50, 25 150, 225 250, 25 50, 225 150, 25 250, 225 speed: 100 horizontal_move_z: 10 retries: 5 retry_tolerance: 0.2 ##################################################################### # mini12864点阵屏引脚配置(勿动) ##################################################################### [display] # mini12864 LCD Display # mini12864液晶显示器 ## SPIDER 3.0 ############################################## #lcd_type: uc1701 #cs_pin: PC11 #a0_pin: PD2 #rst_pin: PC10 #encoder_pins: ^PC6,^PC7 #click_pin: ^!PA8 #contrast: 63 #spi_bus: spi1 #spi_software_mosi_pin: PA7 #spi_software_miso_pin: PA6 #spi_software_sclk_pin: PA5 ############################################################ lcd_type: uc1701 cs_pin: PE9 a0_pin: PE10 rst_pin: PE12 encoder_pins: ^PB1,^PB2 click_pin: ^!PE7 contrast: 63 #spi_bus: spi1 spi_software_mosi_pin: PA7 spi_software_miso_pin: PA6 spi_software_sclk_pin: PA5 [neopixel fysetc_mini12864] # To control Neopixel RGB in mini12864 display ## SPIDER 3.0 ############################################## #pin: PC12 # 主板引脚定义 ############################################################ pin: PE13 # 主板引脚定义 chain_count: 3 # 灯珠数量 initial_RED: 0.1 # 初始 红色 量 initial_GREEN: 0.5 # 初始 绿色 量 initial_BLUE: 0.0 # 初始 蓝色 量 color_order: RGB # 颜色顺序 # Set RGB values on boot up for each Neopixel. # Index 1 = display, Index 2 and 3 = Knob [delayed_gcode setdisplayneopixel] initial_duration: 1 gcode: SET_LED LED=fysetc_mini12864 RED=1 GREEN=1 BLUE=1 INDEX=1 TRANSMIT=0 SET_LED LED=fysetc_mini12864 RED=1 GREEN=0 BLUE=0 INDEX=2 TRANSMIT=0 SET_LED LED=fysetc_mini12864 RED=1 GREEN=0 BLUE=0 INDEX=3 #-------------------------------------------------------------------- ## Virtual SD Card # 虚拟SD卡 [virtual_sdcard] # 启用虚拟SD卡 path: ~/printer_data/gcodes # 设定octoprint上传目录为虚拟SD卡根目录 # Pause/Resume Functionality [pause_resume] [neopixel my_RGB] # Enter the English brackets to enable this definition ## SPIDER 3.0 ############################################## #pin:PD1 ############################################################ pin:PE15 # Main board pin definition chain_count:18 # Number of beads color_order: GRB # Color order initial_RED:0.2 # red The default value of the lamp power on is 1 at the maximum initial_GREEN: 0.2 # Green The default value of the lamp power on is 1 initial_BLUE: 0.2 # Blue The default value of the light on is 1``` [temperature_sensor mcu] sensor_type: temperature_mcu sensor_mcu: mcu min_temp: 0 max_temp: 100 [temperature_sensor Pi] sensor_type: temperature_host sensor_path:/sys/class/thermal/thermal_zone0/temp min_temp: 0 max_temp: 100 [temperature_sensor EBB_NTC] sensor_type: Generic 3950 sensor_pin: EBBCan: PA2 [temperature_sensor enclosure] sensor_type: Generic 3950 sensor_pin: PF5 ##################################################################### # BTT Klipepr Screen ##################################################################### [virtual_sdcard] path: ~/printer_data/gcodes [display_status] [pause_resume] ##################################################################### # BTT FILAMENT SENSOR ##################################################################### #[filament_switch_sensor switch_sensor] #switch_pin: ^PG12 #pause_on_runout: False #runout_gcode: #PAUSE # [pause_resume] is required in printer.cfg #M117 Filament switch runout #insert_gcode: #M117 Filament switch inserted #[filament_motion_sensor encoder_sensor] #switch_pin: ^PG13 #detection_length: 2.90 # accuracy of motion sensor 2.88mm #extruder: extruder #pause_on_runout: False #runout_gcode: #PAUSE # [pause_resume] is required in printer.cfg #M117 Filament encoder runout #insert_gcode: #M117 Filament encoder inserted ##################################################################### # LED BAR ##################################################################### [output_pin daylight] pin: PB0 pwm: true shutdown_value: 0 value: 0.2 cycle_time: 0.001 #[idle_timeout] #timeout: 1800 #gcode: #SET_TEMPERATURE_FAN_TARGET TEMPERATURE_FAN=board_fans TARGET=38 ## Thermistor Types ## "EPCOS 100K B57560G104F" ## "ATC Semitec 104GT-2" ## "NTC 100K beta 3950" ## "Honeywell 100K 135-104LAG-J01" ## "NTC 100K MGB18-104F39050L32" (Keenovo Heater Pad) ## "AD595" ## "PT100 INA826" #*# <---------------------- SAVE_CONFIG ----------------------> #*# DO NOT EDIT THIS BLOCK OR BELOW. The contents are auto-generated. #*# #*# [heater_bed] #*# control = pid #*# pid_kp = 53.581 #*# pid_ki = 2.101 #*# pid_kd = 341.579 #*# #*# [extruder] #*# control = pid #*# pid_kp = 20.498 #*# pid_ki = 1.775 #*# pid_kd = 59.190 #*# #*# [probe] #*# z_offset = -1.530 #*# #*# [bed_mesh default] #*# version = 1 #*# points = #*# -0.091250, -0.018750, 0.002500, -0.027500, -0.098750 #*# -0.068750, 0.002500, 0.018750, -0.012500, -0.051250 #*# -0.065000, -0.008750, 0.000000, -0.023750, -0.072500 #*# -0.117500, -0.040000, -0.041250, -0.043750, -0.101250 #*# -0.135000, -0.066250, -0.021250, -0.057500, -0.125000 #*# x_count = 5 #*# y_count = 5 #*# mesh_x_pps = 2 #*# mesh_y_pps = 2 #*# algo = bicubic #*# tension = 0.2 #*# min_x = 40.0 #*# max_x = 260.0 #*# min_y = 40.0 #*# max_y = 260.0 #*# #*# [input_shaper] #*# shaper_type_x = mzv #*# shaper_freq_x = 67.2 #*# shaper_type_y = mzv #*# shaper_freq_y = 46.2
Editor is loading...
Leave a Comment