Skip to content

Instantly share code, notes, and snippets.

View Exchizz's full-sized avatar

Mathias Neerup Exchizz

View GitHub Profile
import zmq
import time
port = "1337"
context = zmq.Context()
socket = context.socket(zmq.PUB)
socket.bind("tcp://*:%s" % port)
while True:
/*
* IRremote: IRsendDemo - demonstrates sending IR codes with IRsend
* An IR LED must be connected to Arduino PWM pin 3.
* Version 0.1 July, 2009
* Copyright 2009 Ken Shirriff
* http://arcfn.com
*/
#include <IRremote.h>
biggi() { if [ $# -eq 0 ]; then echo "No arguments specified. Usage:\nbiggi test.md"; return 1; fi
tmpfile=$( mktemp -t transferXXX ); curl --progress-bar --form uploadedfile=@$1 "http://u.biggi.dk/index.php?action=uploadfile" >> $tmpfile; cat $tmpfile | grep -oP '(?<=href=")http://.*?(?=">)' ; rm -f $tmpfile; }
@Exchizz
Exchizz / main.m
Created September 29, 2016 15:44
clear; clc;
x1 = 100;
y1 = 0;
theta = 0;
matrix1 = transform(x1,y1,deg2rad(theta));
x2 = 0;
y2 = 200;
theta = 0;
matrix2 = transform(x2, y2,deg2rad(theta));
#!/usr/bin/python
from requests import Request, Session, post,get
import base64, email, hmac, hashlib, urllib
integration_key = ""
host = ""
secret = ""
add_custom_target(run
COMMAND ./parser
DEPENDS run
WORKING_DIRECTORY ${CMAKE_PROJECT_DIR}
)
#!/usr/bin/env python
import sys
import rospy
from caros_control_msgs.srv import SerialDeviceMoveLin
from caros_control_msgs.srv import SerialDeviceMovePtp
from caros_common_msgs.msg import Q
from geometry_msgs.msg import Transform
from geometry_msgs.msg import Vector3
/*
Stepper Motor Control - speed control
This program drives a unipolar or bipolar stepper motor.
The motor is attached to digital pins 8 - 11 of the Arduino.
A potentiometer is connected to analog input 0.
The motor will rotate in a clockwise direction. The higher the potentiometer value,
the faster the motor speed. Because setSpeed() sets the delay between steps,
ansible-playbook deploy.yml -i hosts -u mneerup -k -b -T 30 --ask-become-pass
SSH password:
SUDO password[defaults to SSH password]:
[DEPRECATION WARNING]: The use of 'include' for tasks has been deprecated. Use 'import_tasks' for static inclusions or 'include_tasks' for dynamic inclusions. This feature will be removed in a future release. Deprecation
warnings can be disabled by setting deprecation_warnings=False in ansible.cfg.
[DEPRECATION WARNING]: include is kept for backwards compatibility but usage is discouraged. The module documentation details page may explain more about this rationale.. This feature will be removed in a future release.
Deprecation warnings can be disabled by setting deprecation_warnings=False in ansible.cfg.
____________
< PLAY [all] >
------------
@Exchizz
Exchizz / BoligScraper
Created January 14, 2018 20:54
Project "Please notify me when a new apartment is for sale"
#!/usr/bin/python
from urllib2 import urlopen
from jsondiff import diff
from bs4 import BeautifulSoup
from json import load,dump
from os import path
# Specify the url
quote_page = 'https://www.boligdeal.dk/odense-andelsbolig/odensec'