Skip to content

Instantly share code, notes, and snippets.

if [[ ! -f /tmp/ssh-agent.sh ]]; then
ssh-agent | grep -v echo > /tmp/ssh-agent.sh
fi
source /tmp/ssh-agent.sh%
verbs=(
funktionieren
geben
glauben
gucken
haben
heißen
helfen
herstellen
hören
### Keybase proof
I hereby claim:
* I am clynamen on github.
* I am clynamen (https://keybase.io/clynamen) on keybase.
* I have a public key whose fingerprint is 0C71 2974 E605 D652 E5D7 3B1A 9EC0 0664 E4CC 4459
To claim this, I am signing this object:

Lagrange, version C

The question says:

$ \Re_1 $ is obtained from $ \Re_0 $

using the following transforms:

1. a rotation $ Rot(i, 90) $ with respect to the fixed axes

#!/usr/bin/env python
import rospy
from dynamixel_msgs.msg import JointState
from std_msgs.msg import Float64
GEAR_FACTOR = 6.3
class SuspensionMotorInteface:
def __init__(self, motor_id, direction):
self.motor_id = motor_id
#include <iostream>
#include "opencv2/highgui/highgui.hpp"
#include "opencv2/imgproc/imgproc.hpp"
#include "opencv2/core/core.hpp"
#include "opencv2/features2d/features2d.hpp"
#include "opencv2/nonfree/nonfree.hpp"
using namespace std;
using namespace cv;
#include <iostream>
#include "opencv2/highgui/highgui.hpp"
#include "opencv2/imgproc/imgproc.hpp"
#include "opencv2/core/core.hpp"
using namespace std;
using namespace cv;
int main(int argc, char **argv) {
#include <iostream>
#include "opencv2/highgui/highgui.hpp"
#include "opencv2/imgproc/imgproc.hpp"
#include "opencv2/core/core.hpp"
using namespace std;
using namespace cv;
int main(int argc, char **argv) {
Mat image;
#!/usr/bin/env python
"""copy_forwarder
Usage:
copy_forwader.py <conf_filename> [-v]
Options:
-v --verbose Print debug info during execution
-h --help Print this help
@clynamen
clynamen / gist:cac5b6e9ba5f4f3cd7aa
Created March 24, 2015 19:42
matplotlib-trial2
# coding: utf-8
# In[146]:
get_ipython().magic('matplotlib inline')
from pyrr import Quaternion, Matrix44, Vector3, Vector4
import math
from math import sin, cos
import numpy as np