Skip to content

Instantly share code, notes, and snippets.

View ahmdrz's full-sized avatar
💭
I may be slow to respond.

Ahmadreza Zibaei ahmdrz

💭
I may be slow to respond.
View GitHub Profile
@ahmdrz
ahmdrz / insta_downloader.go
Last active August 22, 2022 12:31
Want to download instagram videos ? Why not using telegram ? Share it to a user and receive it on telegram.
// test project main.go
package main
import (
"fmt"
"net/http"
"strconv"
"time"
"net/url"

Keybase proof

I hereby claim:

  • I am ahmdrz on github.
  • I am ahmdrz (https://keybase.io/ahmdrz) on keybase.
  • I have a public key ASAH3-rAevNfyxYlhRVMs-val6CiQPFOQgDyVi5kwreljQo

To claim this, I am signing this object:

query="nature"
if [ $# -eq 1 ]; then
query=$1
fi
base_dir=$HOME/.local/unsplash/
mkdir -p $base_dir
import random
import copy
import matplotlib.pyplot as plt
class GeneticAlgorithm:
def __init__(self):
self.chromosome_length = 50
self.population = []
import rospy
import cv_bridge
import json
from saam_pose_estimation.srv import PoseEstimator
class PoseEstimation:
def __init__(self, service_name='saam_pose_estimation'):
rospy.wait_for_service(service_name)
self.service = rospy.ServiceProxy(service_name, PoseEstimator)
import rospy
import cv_bridge
from saam_object_detection.srv import WhatAmILookingAt
import json
import numpy as np
class PersonDetection:
def __init__(self, service_name='what_am_i_looking_at'):
rospy.wait_for_service(service_name)
import cv2
import message_filters
from cv_bridge import CvBridge, CvBridgeError
from sensor_msgs.msg import Image
class DepthCameraStreamer:
def __init__(self, image_topic="", depth_topic="", scale=1.0):
self.frame = None
self.depth = None
@ahmdrz
ahmdrz / sklearn-knn.py
Created May 20, 2019 04:42
Simple knn in sklearn
from sklearn.neighbors import KNeighborsClassifier
samples = [[0], [1], [2], [3]]
labels = [0, 0, 1, 1]
item_to_predict = [[1.1]]
model = KNeighborsClassifier(n_neighbors=3, metric='euclidean')
model.fit(samples, labels)
predict = model.predict(item_to_predict)
import numpy as np
from sklearn.cluster import KMeans
import matplotlib.pyplot as plt
first_random = -2 * np.random.rand(100, 2)
second_random = 1 + 2 * np.random.rand(50, 2)
dataset = np.concatenate((first_random, second_random))
plt.scatter(dataset[:, 0], dataset[:, 1])
<div class="battery">
<div id="battery_level" class="battery-level"></div>
</div>
<style>
.battery:after {
background-color: #fff;
border: 2px solid #000;
content: "";
display: block;
height: 16px;