This file contains 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
# Install wstool and rosdep. | |
sudo apt-get update | |
sudo apt-get install -y python-wstool python-rosdep ninja-build | |
# Create a new workspace in 'catkin_ws'. | |
mkdir cartographer_ws | |
cd cartographer_ws | |
wstool init src | |
# Merge the cartographer_ros.rosinstall file and fetch code for dependencies. |
This file contains 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/python | |
import rospy | |
import actionlib | |
from nav_msgs.msg import Path, Odometry | |
from geometry_msgs.msg import PoseStamped, Pose | |
from tf.transformations import quaternion_from_euler | |
from math import pow, atan2, sqrt | |
from mbf_msgs.msg import (ExePathAction, ExePathFeedback, ExePathGoal, ExePathResult) |
This file contains 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
int32 channel | |
bool state | |
--- | |
bool success |
This file contains 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/python | |
import rospy | |
from nav_msgs.msg import Path | |
from geometry_msgs.msg import PoseStamped | |
from tf.transformations import quaternion_from_euler | |
from std_msgs.msg import Float64 | |
got_path = False |
This file contains 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 python | |
import rospy | |
import tf | |
import math | |
from nav_msgs.msg import Odometry | |
from tf.transformations import euler_from_quaternion, quaternion_from_euler, quaternion_multiply | |
from geometry_msgs.msg import Transform, Quaternion, QuaternionStamped, Pose, Point | |
from sensor_msgs.msg import NavSatFix, NavSatStatus, TimeReference |
This file contains 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
#include <WProgram.h> | |
#include "ros.h" | |
#include "ros/time.h" | |
#include <math.h> | |
#include "geometry_msgs/Twist.h" | |
//header file for publishing velocities for odom | |
// Steer angle sensor | |
int steer_angle_val; |
This file contains 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
#! /bin/bash | |
# test if OpenCV already installed for python | |
function test_opencv_installed() | |
{ | |
RC=0 | |
python3 -c "import cv2" > /dev/null 2>&1 || RC=$? | |
if [ $RC -eq 0 ] ; | |
then |
This file contains 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
#include <Servo.h> | |
// Base Controller Input | |
#define cmdPin 2 | |
// Servo Output | |
#define servoPin 5 | |
// Transmission Neutral Safe Position | |
#define transCenter 1550 | |
This file contains 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
FROM ros:indigo-ros-base | |
# install ros tutorials packages | |
RUN apt-get update && apt-get install -y \ | |
ros-indigo-ros-tutorials \ | |
ros-indigo-common-tutorials \ | |
&& rm -rf /var/lib/apt/lists/ |