I hereby claim:
- I am danielsnider on github.
- I am danielsnider (https://keybase.io/danielsnider) on keybase.
- I have a public key whose fingerprint is BE02 929B BBB9 A128 24C7 D077 4810 4A4F 8520 4D58
To claim this, I am signing this object:
I hereby claim:
To claim this, I am signing this object:
<p align="center"> | |
<img src="https://github.com/danielsnider/ros-rover/blob/master/diagrams/book_cover.png?raw=true" alt="Drawing" height="400px"> | |
</p> |
#!/bin/bash | |
# Get my IP | |
MY_IP=$(hostname -I | grep 192.168.137 | cut -f1 -d' ') | |
exit_status=$? | |
if [ $exit_status -eq 1 ]; then | |
echo "ERROR: you do not have an IP on the robot network (192.168.137.x). Please set one. Aborting..." | |
return 1 | |
fi |
from math import sin, cos, atan2, sqrt, acos, pi | |
import rospy | |
import numpy | |
import tf | |
from sensor_msgs.msg import JointState | |
class UnreachablePositionError(Exception): | |
pass |
from math import sin, cos, atan2, sqrt, acos, pi | |
import rospy | |
import numpy | |
import tf | |
from sensor_msgs.msg import JointState | |
class UnreachablePositionError(Exception): | |
pass |
figure; | |
for n=1:size(img_names,1) | |
clf | |
% Load image | |
img = imread([imgs_path img_names{n}]); | |
insulin = imgaussfilt(double(img(:,:,2)),10); | |
cyto = imgaussfilt(double(img(:,:,1)),1); | |
nuc = imgaussfilt(double(img(:,:,3)),1); | |
rgb = zeros(size(nuc,1),size(nuc,2),3); | |
rgb(:,:,1) = cyto; |
<launch> | |
<env name="ROSCONSOLE_FORMAT" value="[${thread}] [${node}/${function}:${line}]: ${message}"/> | |
<node pkg="tf" type="static_transform_publisher" name="swri_transform" args="0 0 0 1.5708 0 0 /world /map 100" /> | |
<node pkg="mapviz" type="mapviz" name="$(anon mapviz)" required="true" output="log"/> | |
<node pkg="swri_transform_util" type="initialize_origin.py" name="initialize_origin" output="screen"> | |
<param name="local_xy_frame" value="/world"/> | |
<param name="local_xy_origin" value="auto"/> <!-- "auto" setting will set the origin to the first gps fix that it recieves --> |
import XMonad | |
import XMonad.Config.Gnome | |
import qualified XMonad.StackSet as W | |
spawnToWorkspace :: String -> String -> X () | |
spawnToWorkspace program workspace = do | |
spawn program | |
windows $ W.greedyView workspace | |
startup_message off | |
vbell off | |
defscrollback 5000 | |
#backtick 1 60 60 $HOME/.screenrc.acpi # .screenrc.acpi contains 1 line: acpi | awk -F ', ' '{print $2}' | |
hardstatus alwayslastline |
{ | |
"kind":"Listing", | |
"data":{ | |
"modhash":"lwosx1x0c6c85800f1f043f8cc073d7405434319b398d0805b", | |
"children":[ | |
{ | |
"kind":"t3", | |
"data":{ | |
"domain":"imgur.com", | |
"banned_by":null, |