This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
#Developed by PJ Mara, property of Autonodyne LLC | |
#include <ros/ros.h> | |
#include <std_msgs/String.h> | |
#include <sensor_msgs/PointCloud2.h> | |
#include <sensor_msgs/PointCloud.h> | |
#include <sensor_msgs/point_cloud_conversion.h> | |
#include <sensor_msgs/NavSatFix.h> | |
#include <mavros_msgs/GlobalPositionTarget.h> | |
#include <geometry_msgs/Polygon.h> | |
#include <nav_msgs/GridCells.h> |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
#!/usr/bin/env python2 | |
import rospy | |
import tf | |
import math | |
from nav_msgs.msg import Odometry, OccupancyGrid | |
from std_msgs.msg import Header, Bool | |
from nav_msgs.srv import GetPlan, GetMap, GetPlanRequest, GetPlanResponse |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
#!/usr/bin/env python2 | |
import rospy | |
import math | |
from nav_msgs.msg import Odometry | |
from geometry_msgs.msg import PoseStamped | |
from geometry_msgs.msg import Twist | |
from tf.transformations import euler_from_quaternion | |
class Lab2: |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
import random | |
import copy | |
import time | |
class myNode: | |
def __init__(self, name): | |
self.connection_count = 0 | |
self.connections = [] | |
self.name = name |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
def specialFunc(ref, threshold): | |
returnList = [] | |
refDict = {0: 0} | |
for i in range(0, len(ref)): | |
test = ref[i] | |
if test in refDict: | |
refDict[test] = refDict[test] + 1 | |
else: | |
refDict[test] = 1 |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
//Your code here |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
import javafx.scene.transform.Affine; | |
import javafx.application.Platform; | |
// call another script that will create the robot object and return it. | |
def myRobot = ScriptingEngine.gitScriptRun( | |
"https://gist.github.com/fd1602bce81ca9096db3f28648b3d312.git", // git location of the library | |
"LoadIMUServer.groovy" , // file to load | |
// Pass the name of the device. This needs to match what was written to the device in Arduino | |
["IMU-Team21"] | |
) |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
import com.neuronrobotics.sdk.addons.gamepad.IJInputEventListener; | |
import com.neuronrobotics.sdk.addons.gamepad.BowlerJInputDevice; | |
import net.java.games.input.Component; | |
import net.java.games.input.Event; | |
import net.java.games.input.Controller; | |
import net.java.games.input.ControllerEnvironment; | |
import org.apache.commons.io.IOUtils; | |
import com.neuronrobotics.sdk.dyio.DyIO; | |
import com.neuronrobotics.sdk.ui.ConnectionDialog; | |
import com.neuronrobotics.bowlerstudio.physics.*; |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
// here in lies my theory of making the greatest function ever...doglegshouldermove | |
public int WalkMotion (int input, int min, int max) { | |
int target = (max-min/2); //sets target to middle by default, can change later | |
if (target < max) { | |
target = target + 1 //sets target 1 above current thing | |
Thread.sleep(120/input) //sets wait time | |
pan.getChannel().setCachedValue(target); //sets value to servo |
This file contains hidden or bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
import com.neuronrobotics.sdk.addons.gamepad.IJInputEventListener; | |
import com.neuronrobotics.sdk.addons.gamepad.BowlerJInputDevice; | |
import net.java.games.input.Component; | |
import net.java.games.input.Event; | |
import net.java.games.input.Controller; | |
import net.java.games.input.ControllerEnvironment; | |
import org.apache.commons.io.IOUtils; | |
import com.neuronrobotics.sdk.dyio.DyIO; | |
import com.neuronrobotics.sdk.ui.ConnectionDialog; | |
import com.neuronrobotics.bowlerstudio.physics.*; |
NewerOlder