file_path
stringlengths 21
224
| content
stringlengths 0
80.8M
|
---|---|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/launch/spawn_robot.launch | <launch>
<arg name="robot_name" default="/"/> <!-- Change this for namespacing. -->
<arg name="rviz" default="false"/> <!-- Set to true to run rviz in parallel. -->
<arg name="lite" default="false" /> <!-- Set to true if you're using CHAMP lite version. Only useful for microcontrollers. -->
<arg name="ros_control_file" default="$(find stochlite_config)/config/ros_control/ros_control.yaml" /> <!-- Path to ROS Control configurations. Do not touch. -->
<arg name="gazebo_world" default="$(find stochlite_config)/worlds/outdoor.world" /> <!-- Path to Gazebo world you want to load. -->
<arg name="world_init_x" default="0.0" /> <!-- X Initial position of the robot in Gazebo World -->
<arg name="world_init_y" default="0.0" /> <!-- Y Initial position of the robot in Gazebo World -->
<arg name="world_init_heading" default="0.0" /> <!-- Initial heading of the robot in Gazebo World -->
<param name="use_sim_time" value="true" />
<include file="$(find stochlite_config)/launch/bringup.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="gazebo" value="true"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="rviz" value="$(arg rviz)"/>
<arg name="joint_controller_topic" value="joint_group_position_controller/command"/>
<arg name="hardware_connected" value="false"/>
<arg name="publish_foot_contacts" value="false"/>
<arg name="close_loop_odom" value="true"/>
</include>
<include file="$(find champ_gazebo)/launch/spawn_robot.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="ros_control_file" value="$(arg ros_control_file)"/>
<arg name="world_init_x" value="$(arg world_init_x)" />
<arg name="world_init_y" value="$(arg world_init_y)" />
<arg name="world_init_heading" value="$(arg world_init_heading)" />
</include>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/launch/include/gmapping.launch | <launch>
<arg name="frame_prefix" default=""/>
<node pkg="gmapping" type="slam_gmapping" name="slam_gmapping" output="screen">
<param name="base_frame" value="$(arg frame_prefix)base_footprint" />
<param name="odom_frame" value="$(arg frame_prefix)odom" />
<param name="map_frame" value="/$(arg frame_prefix)map" />
<param name="map_update_interval" value="15.0"/>
<param name="maxUrange" value="5.0"/>
<param name="minRange" value="-0.5"/>
<param name="sigma" value="0.05"/>
<param name="kernelSize" value="1"/>
<param name="lstep" value="0.05"/>
<param name="astep" value="0.05"/>
<param name="iterations" value="5"/>
<param name="lsigma" value="0.075"/>
<param name="ogain" value="3.0"/>
<param name="lskip" value="0"/>
<param name="minimumScore" value="100"/>
<param name="srr" value="0.01"/>
<param name="srt" value="0.02"/>
<param name="str" value="0.01"/>
<param name="stt" value="0.02"/>
<param name="linearUpdate" value="0.7"/>
<param name="angularUpdate" value="0.7"/>
<param name="temporalUpdate" value="-0.5"/>
<param name="resampleThreshold" value="0.5"/>
<param name="particles" value="50"/>
<param name="xmin" value="-50.0"/>
<param name="ymin" value="-50.0"/>
<param name="xmax" value="50.0"/>
<param name="ymax" value="50.0"/>
<param name="delta" value="0.05"/>
<param name="llsamplerange" value="0.05"/>
<param name="llsamplestep" value="0.05"/>
<param name="lasamplerange" value="0.005"/>
<param name="lasamplestep" value="0.005"/>
<param name="transform_publish_period" value="0.1"/>
</node>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/launch/include/amcl.launch | <launch>
<arg name="frame_prefix" default=""/>
<node pkg="amcl" type="amcl" name="amcl" output="screen">
<param name="initial_pose_a" value="0.0"/>
<param name="use_map_topic" value="true"/>
<param name="base_frame_id" value="$(arg frame_prefix)base_footprint"/>
<param name="odom_frame_id" value="$(arg frame_prefix)odom"/>
<param name="global_frame_id" value="$(arg frame_prefix)map"/>
<param name="transform_broadcast" value="true"/>
<param name="gui_publish_rate" value="10.0"/> <!-- Maximum rate (Hz) at which scans and paths are published for visualization, -1.0 to disable. -->
<param name="kld_err" value="0.05"/>
<param name="kld_z" value="0.99"/>
<param name="laser_lambda_short" value="0.1"/>
<param name="laser_likelihood_max_dist" value="2.0"/>
<param name="laser_max_beams" value="60"/>
<param name="laser_model_type" value="likelihood_field_prob"/>
<param name="laser_sigma_hit" value="0.2"/>
<param name="laser_z_hit" value="0.5"/>
<param name="laser_z_short" value="0.05"/>
<param name="laser_z_max" value="0.05"/>
<param name="laser_z_rand" value="0.5"/>
<param name="max_particles" value="2000"/>
<param name="min_particles" value="500"/>
<param name="odom_alpha1" value="0.5"/> <!-- Specifies the expected noise in odometry's rotation estimate from the rotational component of the robot's motion. -->
<param name="odom_alpha2" value="0.5"/> <!-- Specifies the expected noise in odometry's rotation estimate from translational component of the robot's motion. -->
<param name="odom_alpha3" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the translational component of the robot's motion. -->
<param name="odom_alpha4" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the rotational component of the robot's motion. -->
<param name="odom_alpha5" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the rotational component of the robot's motion. -->
<param name="odom_model_type" value="omni"/>
<param name="recovery_alpha_slow" value="0.001"/> <!-- Exponential decay rate for the slow average weight filter, used in deciding when to recover by adding random poses. -->
<param name="recovery_alpha_fast" value="0.1"/> <!-- Exponential decay rate for the fast average weight filter, used in deciding when to recover by adding random poses. -->
<param name="resample_interval" value="1"/> <!-- Number of filter updates required before resampling. -->
<param name="transform_tolerance" value="1.25"/> <!-- Default 0.1; time with which to post-date the transform that is published, to indicate that this transform is valid into the future. -->
<param name="update_min_a" value="0.2"/> <!-- Rotational movement required before performing a filter update. 0.1 represents 5.7 degrees -->
<param name="update_min_d" value="0.2"/> <!-- Translational movement required before performing a filter update. -->
</node>
</launch>
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/launch/include/move_base.launch | <launch>
<arg name="frame_prefix" default=""/>
<arg name="robot_name" default=""/>
<node pkg="move_base" type="move_base" respawn="false" name="move_base" output="screen">
<rosparam file="$(find stochlite_config)/config/move_base/costmap_common_params.yaml" command="load" ns="global_costmap" />
<rosparam file="$(find stochlite_config)/config/move_base/costmap_common_params.yaml" command="load" ns="local_costmap" />
<rosparam file="$(find stochlite_config)/config/move_base/local_costmap_params.yaml" command="load" />
<rosparam file="$(find stochlite_config)/config/move_base/global_costmap_params.yaml" command="load" />
<rosparam file="$(find stochlite_config)/config/move_base/base_local_planner_holonomic_params.yaml" command="load" />
<rosparam file="$(find stochlite_config)/config/move_base/move_base_params.yaml" command="load" />
<!-- explicitly define frame ids for movebase -->
<param name="global_costmap/global_frame" value="$(arg frame_prefix)map"/>
<param name="global_costmap/robot_base_frame" value="$(arg frame_prefix)base_footprint"/>
<param name="global_costmap/2d_obstacles_layer/scan/topic" value="$(arg robot_name)scan"/>
<param name="global_costmap/3d_obstacles_layer/depth/topic" value="$(arg robot_name)camera/depth/points"/>
<param name="local_costmap/global_frame" value="$(arg frame_prefix)odom"/>
<param name="local_costmap/robot_base_frame" value="$(arg frame_prefix)base_footprint"/>
<param name="local_costmap/2d_obstacles_layer/scan/topic" value="$(arg robot_name)scan"/>
<param name="local_costmap/3d_obstacles_layer/depth/topic" value="$(arg robot_name)camera/depth/points"/>
</node>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/maps/map.yaml | image: map.pgm
resolution: 0.050000
origin: [-50.000000, -50.000000, 0.000000]
negate: 0
occupied_thresh: 0.65
free_thresh: 0.196
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/include/quadruped_description.h | #ifndef QUADRUPED_DESCRIPTION_H
#define QUADRUPED_DESCRIPTION_H
#include <quadruped_base/quadruped_base.h>
namespace champ
{
namespace URDF
{
void loadFromHeader(champ::QuadrupedBase &base)
{
base.lf.hip.setOrigin(0.16695, 0.0956, -0.0050001, 0.0, 0.0, 0.0);
base.lf.upper_leg.setOrigin(0.0, 0.052019, -0.0, 0.0, 0.0, 0.0);
base.lf.lower_leg.setOrigin(0.0, 0.023481, -0.146, 0.0, 0.0, 0.0);
base.lf.foot.setOrigin(0.0, 0.023481, -0.169, 0.0, 0.0, 0.0);
base.rf.hip.setOrigin(0.16695, -0.0964, -0.0049999, 0.0, 0.0, 0.0);
base.rf.upper_leg.setOrigin(0.0, -0.052019, -0.0, 0.0, 0.0, 0.0);
base.rf.lower_leg.setOrigin(0.0, -0.023481, -0.146, 0.0, 0.0, 0.0);
base.rf.foot.setOrigin(0.0, -0.023481, -0.169, 0.0, 0.0, 0.0);
base.lh.hip.setOrigin(-0.16695, 0.0956, -0.0049999, 0.0, 0.0, 0.0);
base.lh.upper_leg.setOrigin(0.0, 0.052019, -0.0, 0.0, 0.0, 0.0);
base.lh.lower_leg.setOrigin(0.0, 0.023481, -0.146, 0.0, 0.0, 0.0);
base.lh.foot.setOrigin(0.0, 0.023481, -0.169, 0.0, 0.0, 0.0);
base.rh.hip.setOrigin(-0.16695, -0.0964, -0.0050001, 0.0, 0.0, 0.0);
base.rh.upper_leg.setOrigin(0.0, -0.052019, -0.0, 0.0, 0.0, 0.0);
base.rh.lower_leg.setOrigin(0.0, -0.023481, -0.146, 0.0, 0.0, 0.0);
base.rh.foot.setOrigin(0.0, -0.023481, -0.169, 0.0, 0.0, 0.0);
}
}
}
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/include/hardware_config.h | #ifndef HARDWARE_CONFIG_H
#define HARDWARE_CONFIG_H
#define USE_SIMULATION_ACTUATOR
// #define USE_DYNAMIXEL_ACTUATOR
// #define USE_SERVO_ACTUATOR
// #define USE_BRUSHLESS_ACTUATOR
#define USE_SIMULATION_IMU
// #define USE_BNO0809DOF_IMU
#define USE_ROS
// #define USE_ROS_RF
#ifdef USE_ROS_RF
#define ELE_PIN 16
#define AIL_PIN 21
#define RUD_PIN 17
#define THR_PIN 20
#define AUX1_PIN 22
#define AUX2_PIN 23
#define RF_INV_LX false
#define RF_INV_LY false
#define RF_INV_AZ false
#define RF_INV_ROLL true
#define RF_INV_PITCH false
#define RF_INV_YAW false
#endif
#ifdef USE_DYNAMIXEL_ACTUATOR
#define LFH_SERVO_ID 16
#define LFU_SERVO_ID 17
#define LFL_SERVO_ID 18
#define RFH_SERVO_ID 14
#define RFU_SERVO_ID 7
#define RFL_SERVO_ID 4
#define LHH_SERVO_ID 2
#define LHU_SERVO_ID 11
#define LHL_SERVO_ID 12
#define RHH_SERVO_ID 6
#define RHU_SERVO_ID 5
#define RHL_SERVO_ID 8
#define LFH_INV false
#define LFU_INV false
#define LFL_INV true
#define RFH_INV false
#define RFU_INV true
#define RFL_INV false
#define LHH_INV false
#define LHU_INV false
#define LHL_INV true
#define RHH_INV false
#define RHU_INV true
#define RHL_INV false
#endif
#ifdef USE_SERVO_ACTUATOR
#define LFH_PIN 8
#define LFU_PIN 7
#define LFL_PIN 6
#define RFH_PIN 14
#define RFU_PIN 16
#define RFL_PIN 17
#define LHH_PIN 4
#define LHU_PIN 3
#define LHL_PIN 2
#define RHH_PIN 21
#define RHU_PIN 22
#define RHL_PIN 23
#define LFH_OFFSET 0
#define LFU_OFFSET 0
#define LFL_OFFSET 0
#define RFH_OFFSET 0
#define RFU_OFFSET 0
#define RFL_OFFSET 0
#define LHH_OFFSET 0
#define LHU_OFFSET 0
#define LHL_OFFSET 3
#define RHH_OFFSET 0
#define RHU_OFFSET 0
#define RHL_OFFSET 0
#define LFH_INV false
#define LFU_INV false
#define LFL_INV false
#define RFH_INV false
#define RFU_INV true
#define RFL_INV true
#define LHH_INV true
#define LHU_INV false
#define LHL_INV false
#define RHH_INV true
#define RHU_INV true
#define RHL_INV true
#endif
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/include/gait_config.h | #ifndef GAIT_CONFIG_H
#define GAIT_CONFIG_H
#define KNEE_ORIENTATION "><"
#define PANTOGRAPH_LEG false
#define ODOM_SCALER 1.0
#define MAX_LINEAR_VELOCITY_X 0.4
#define MAX_LINEAR_VELOCITY_Y 0.25
#define MAX_ANGULAR_VELOCITY_Z 1.0
#define COM_X_TRANSLATION 0.0
#define SWING_HEIGHT 0.04
#define STANCE_DEPTH 0.0
#define STANCE_DURATION 0.25
#define NOMINAL_HEIGHT 0.23
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/config/links/links.yaml | base: base_link
left_front:
- fl_abd_link
- fl_thigh_link
- fl_shank_link
- fl_toe_link
right_front:
- fr_abd_link
- fr_thigh_link
- fr_shank_link
- fr_toe_link
left_hind:
- bl_abd_link
- bl_thigh_link
- bl_shank_link
- bl_toe_link
right_hind:
- br_abd_link
- br_thigh_link
- br_shank_link
- br_toe_link |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/config/ros_control/ros_control.yaml | "":
joint_states_controller:
type: joint_state_controller/JointStateController
publish_rate: 50
joint_group_position_controller:
type: effort_controllers/JointTrajectoryController
joints:
- fl_abd_joint
- fl_hip_joint
- fl_knee_joint
- fr_abd_joint
- fr_hip_joint
- fr_knee_joint
- bl_abd_joint
- bl_hip_joint
- bl_knee_joint
- br_abd_joint
- br_hip_joint
- br_knee_joint
# constraints:
# goal_time: 0.01
# stopped_velocity_tolerance: 0.01
# stop_trajectory_duration: 0.01
gains:
fl_abd_joint : {p: 100, d: 6, i: 0.2}
fl_hip_joint : {p: 100, d: 6, i: 0.2}
fl_knee_joint : {p: 100, d: 6, i: 0.2}
fr_abd_joint : {p: 100, d: 6, i: 0.2}
fr_hip_joint : {p: 100, d: 6, i: 0.2}
fr_knee_joint : {p: 100, d: 6, i: 0.2}
bl_abd_joint : {p: 100, d: 6, i: 0.2}
bl_hip_joint : {p: 100, d: 6, i: 0.2}
bl_knee_joint : {p: 100, d: 6, i: 0.2}
br_abd_joint : {p: 100, d: 6, i: 0.2}
br_hip_joint : {p: 100, d: 6, i: 0.2}
br_knee_joint : {p: 100, d: 6, i: 0.2}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/config/gait/gait.yaml | knee_orientation : "><"
pantograph_leg : false
odom_scaler: 1.0
max_linear_velocity_x : 0.4
max_linear_velocity_y : 0.25
max_angular_velocity_z : 1.0
com_x_translation : 0.0
swing_height : 0.04
stance_depth : 0.0
stance_duration : 0.25
nominal_height : 0.23 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/config/joints/joints.yaml | left_front:
- fl_abd_joint
- fl_hip_joint
- fl_knee_joint
- fl_toe_joint
right_front:
- fr_abd_joint
- fr_hip_joint
- fr_knee_joint
- fr_toe_joint
left_hind:
- bl_abd_joint
- bl_hip_joint
- bl_knee_joint
- bl_toe_joint
right_hind:
- br_abd_joint
- br_hip_joint
- br_knee_joint
- br_toe_joint |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/config/move_base/costmap_common_params.yaml | obstacle_range: 2.5
raytrace_range: 3.0
footprint: [[-0.25, -0.145], [-0.25, 0.145], [0.25, 0.145], [0.25, -0.145]]
transform_tolerance: 0.5
resolution: 0.05
static_map_layer:
map_topic: map
subscribe_to_updates: true
2d_obstacles_layer:
observation_sources: scan
scan: {data_type: LaserScan,
topic: scan,
marking: true,
clearing: true}
3d_obstacles_layer:
observation_sources: depth
depth: {data_type: PointCloud2,
topic: camera/depth/points,
min_obstacle_height: 0.1,
marking: true,
clearing: true}
inflation_layer:
inflation_radius: 2.0 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/config/move_base/base_local_planner_holonomic_params.yaml | DWAPlannerROS:
#http://wiki.ros.org/dwa_local_planner
min_vel_trans: 0.01
max_vel_trans: 0.5
min_vel_x: -0.025
max_vel_x: 0.5
min_vel_y: 0.0
max_vel_y: 0.0
max_vel_rot: 1.0
min_vel_rot: -1.0
acc_lim_trans: 1.7
acc_lim_x: 1.7
acc_lim_y: 0.0
acc_lim_theta: 3
trans_stopped_vel: 0.1
theta_stopped_vel: 0.1
xy_goal_tolerance: 0.25
yaw_goal_tolerance: 0.34
sim_time: 3.5
sim_granularity: 0.1
vx_samples: 20
vy_samples: 0
vth_samples: 40
path_distance_bias: 34.0
goal_distance_bias: 24.0
occdist_scale: 0.05
forward_point_distance: 0.2
stop_time_buffer: 0.5
scaling_speed: 0.25
max_scaling_factor: 0.2
oscillation_reset_dist: 0.05
use_dwa: true
prune_plan: false
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/config/move_base/move_base_params.yaml | base_global_planner: global_planner/GlobalPlanner
base_local_planner: dwa_local_planner/DWAPlannerROS
shutdown_costmaps: false
controller_frequency: 5.0
controller_patience: 3.0
planner_frequency: 0.5
planner_patience: 5.0
oscillation_timeout: 10.0
oscillation_distance: 0.2
conservative_reset_dist: 0.1 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/config/move_base/global_costmap_params.yaml | global_costmap:
global_frame: map
robot_base_frame: base_footprint
update_frequency: 1.0
publish_frequency: 0.5
static_map: true
cost_scaling_factor: 10.0
plugins:
- {name: static_map_layer, type: "costmap_2d::StaticLayer"}
- {name: inflation_layer, type: "costmap_2d::InflationLayer"}
- {name: 2d_obstacles_layer, type: "costmap_2d::ObstacleLayer"}
- {name: 3d_obstacles_layer, type: "costmap_2d::VoxelLayer"}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stochlite_config/config/move_base/local_costmap_params.yaml | local_costmap:
global_frame: odom
robot_base_frame: base_footprint
update_frequency: 1.0
publish_frequency: 2.0
static_map: false
rolling_window: true
width: 2.5
height: 2.5
cost_scaling_factor: 5
plugins:
- {name: inflation_layer, type: "costmap_2d::InflationLayer"}
- {name: 2d_obstacles_layer, type: "costmap_2d::ObstacleLayer"}
- {name: 3d_obstacles_layer, type: "costmap_2d::VoxelLayer"}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/config.json | {
"urdf_path": "$(find dream_walker)/urdf/dream_walker.urdf",
"links": {
"right_hind": [
"C1_Link",
"C2_Link",
"C3_Link",
"C4_Link"
],
"right_front": [
"A1_Link",
"A2_Link",
"A3_Link",
"A4_Link"
],
"base": "base_link",
"left_hind": [
"D1_Link",
"D2_Link",
"D3_Link",
"D4_Link"
],
"left_front": [
"B1_Link",
"B2_Link",
"B3_Link",
"B4_Link"
]
},
"joints": {
"right_hind": [
"C1_joint",
"C2_joint",
"C3_joint",
"C4_joint"
],
"right_front": [
"A1_joint",
"A2_joint",
"A3_joint",
"A4_joint"
],
"left_hind": [
"D1_joint",
"D2_joint",
"D3_joint",
"D4_joint"
],
"left_front": [
"B1_joint",
"B2_joint",
"B3_joint",
"B4_joint"
]
},
"firmware": {
"transforms": {
"right_hind": {
"hip": [
-0.45849999999999996,
-0.083,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
-0.203,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.44,
0.0,
0.0,
0.0
],
"lower_leg": [
0.0,
-0.075,
-0.32,
0.0,
0.0,
0.0
]
},
"right_front": {
"hip": [
0.45849999999999996,
-0.083,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
-0.203,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.44,
0.0,
0.0,
0.0
],
"lower_leg": [
0.0,
-0.075,
-0.32,
0.0,
0.0,
0.0
]
},
"left_hind": {
"hip": [
-0.45849999999999996,
0.083,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
0.203,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.44,
0.0,
0.0,
0.0
],
"lower_leg": [
0.0,
0.075,
-0.32,
0.0,
0.0,
0.0
]
},
"left_front": {
"hip": [
0.45849999999999996,
0.083,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
0.203,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.44,
0.0,
0.0,
0.0
],
"lower_leg": [
0.0,
0.075,
-0.32,
0.0,
0.0,
0.0
]
}
},
"gait": {
"com_x_translation": 0.0,
"swing_height": 0.1,
"max_linear_vel_y": 0.25,
"max_linear_vel_x": 0.5,
"nominal_height": 0.5,
"knee_orientation": ">>",
"max_angular_vel_z": 1.0,
"stance_duration": 0.25,
"stance_depth": 0.0,
"pantograph_leg": "false",
"odom_scaler": 1.0
}
},
"default_urdf": "False",
"robot_name": "dream_walker"
} |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/CMakeLists.txt | cmake_minimum_required(VERSION 2.8.3)
project(dream_walker_config)
find_package(catkin REQUIRED COMPONENTS)
catkin_package() |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/setup.bash | #!/usr/bin/env bash
ROBOT_CONFIG_DIR=$(builtin cd "`dirname "${BASH_SOURCE[0]}"`" > /dev/null && pwd)
export CHAMP_ROBOT_CONFIG_DIR=$ROBOT_CONFIG_DIR/include
bash -i |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/package.xml | <?xml version="1.0"?>
<package format="2">
<name>dream_walker_config</name>
<version>0.1.0</version>
<description>dream_walker Champ Config Package</description>
<maintainer email="[email protected]">Juan Miguel Jimeno</maintainer>
<author>Juan Miguel Jimeno</author>
<license>BSD</license>
<buildtool_depend>catkin</buildtool_depend>
<exec_depend>roslaunch</exec_depend>
<exec_depend>rviz</exec_depend>
<exec_depend>champ_base</exec_depend>
</package> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/README.md |
## 1. Quick Start
You don't need a physical robot to run the following demos.
### 1.1. Walking demo in RVIZ:
#### 1.1.1. Run the base driver:
roslaunch dream_walker_config bringup.launch rviz:=true
#### 1.1.2. Run the teleop node:
roslaunch champ_teleop teleop.launch
If you want to use a [joystick](https://www.logitechg.com/en-hk/products/gamepads/f710-wireless-gamepad.html) add joy:=true as an argument.
### 1.2. SLAM demo:
#### 1.2.1. Run the Gazebo environment:
roslaunch dream_walker_config gazebo.launch
#### 1.2.2. Run gmapping package and move_base:
roslaunch dream_walker_config slam.launch rviz:=true
To start mapping:
- Click '2D Nav Goal'.
- Click and drag at the position you want the robot to go.

- Save the map by running:
roscd dream_walker_config/maps
rosrun map_server map_saver
### 1.3. Autonomous Navigation:
#### 1.3.1. Run the Gazebo environment:
roslaunch dream_walker_config gazebo.launch
#### 1.3.2. Run amcl and move_base:
roslaunch dream_walker_config navigate.launch rviz:=true
To navigate:
- Click '2D Nav Goal'.
- Click and drag at the position you want the robot to go.

#### 1.4.1 Spawning multiple robots in Gazebo
Run Gazebo and default simulation world:
roslaunch champ_gazebo spawn_world.launch
You can also load your own world file by passing your world's path to 'gazebo_world' argument:
roslaunch champ_gazebo spawn_world.launch gazebo_world:=<path_to_world_file>
Spawning a robot:
roslaunch dream_walker_config spawn_robot.launch robot_name:=<unique_robot_name> world_init_x:=<x_position> world_init_y:=<y_position>
* Every instance of the spawned robot must have a unique robot name to prevent the topics and transforms from clashing.
---
:exclamation: *This is not an official product from the robot's company/author.* |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/launch/bringup.launch | <launch>
<arg name="robot_name" default="/"/> <!-- Change this for namespacing. -->
<arg name="base_frame" default="base_link"/> <!-- Link name of floating base. Do not touch this. -->
<arg name="joints_map_file" default="$(find dream_walker_config)/config/joints/joints.yaml"/> <!--Path to list of joint names. Do not touch this. -->
<arg name="links_map_file" default="$(find dream_walker_config)/config/links/links.yaml"/> <!-- Path to list of link names. Do not touch this. -->
<arg name="gait_config_file" default="$(find dream_walker_config)/config/gait/gait.yaml"/> <!-- Path to gait parameters. Do not touch this. -->
<arg name="description_file" default="$(find dream_walker)/urdf/dream_walker.urdf"/> <!-- Path to URDF file Do not touch this. -->
<arg name="gazebo" default="false" /> <!-- Set to true during simulation. This is auto-set to true from gazebo.launch. -->
<arg name="rviz" default="false"/> <!-- Set to true to run rviz in parallel. -->
<arg name="rviz_ref_frame" default="odom"/> <!-- Default RVIZ reference frame. -->
<arg name="has_imu" default="true" /> <!-- Set to true if you want to visualize robot but there's no IMU. Only useful for microcontrollers. -->
<arg name="lite" default="false" /> <!-- Set to true if you're using CHAMP lite version. Only useful for microcontrollers. -->
<arg name="close_loop_odom" default="false" /> <!-- Set to true if you want to calculate odometry using close loop. This is auto-set to true from gazebo.launch. -->
<arg name="publish_foot_contacts" default="true" /> <!-- Set to true if you want the controller to publish the foot contact states. This is auto-set to false from gazebo.launch. -->
<arg name="publish_joint_control" default="true" /> <!-- Set to true if you want the controller to publish the joint_states topic. This is auto-set to false from gazebo.launch. -->
<arg name="laser" default="sim"/> <!-- Set to the 2D LIDAR you're using. See https://github.com/chvmp/champ/tree/master/champ_bringup/launch/include/laser .-->
<arg name="joint_controller_topic" default="joint_group_position_controller/command" /> <!-- Change to remap command topic for actuator controller (ROS control). -->
<arg name="hardware_connected" default="false" /> <!-- Flag useful to launch hardware connected launch files. This auto disables publishing joint_states. -->
<arg if="$(eval arg('robot_name') == '/')" name="frame_prefix" value="" />
<arg unless="$(eval arg('robot_name') == '/')" name="frame_prefix" value="$(arg robot_name)/" />
<include file="$(find champ_bringup)/launch/bringup.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="base_frame" value="$(arg base_frame)"/>
<arg name="joints_map_file" value="$(arg joints_map_file)"/>
<arg name="links_map_file" value="$(arg links_map_file)"/>
<arg name="gait_config_file" value="$(arg gait_config_file)"/>
<arg name="description_file" value="$(arg description_file)"/>
<arg name="has_imu" value="$(arg has_imu)"/>
<arg name="gazebo" value="$(arg gazebo)"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="laser" value="$(arg laser)"/>
<arg name="rviz" value="$(arg rviz)"/>
<arg name="rviz_ref_frame" value="$(arg frame_prefix)$(arg rviz_ref_frame)"/>
<arg name="joint_controller_topic" value="$(arg joint_controller_topic)" />
<arg name="hardware_connected" value="$(arg hardware_connected)" />
<arg name="publish_foot_contacts" value="$(arg publish_foot_contacts)" />
<arg name="publish_joint_control" value="$(arg publish_joint_control)" />
<arg name="close_loop_odom" value="$(arg close_loop_odom)" />
</include>
<group if="$(arg hardware_connected)">
<node pkg="tf2_ros" type="static_transform_publisher" name="base_link_to_laser" args="0 0 0 0 0 0 $(arg frame_prefix)base_link $(arg frame_prefix)laser" />
<node pkg="tf2_ros" type="static_transform_publisher" name="base_link_to_imu" args="0 0 0 0 0 0 $(arg frame_prefix)base_link $(arg frame_prefix)imu_link" />
<!-- include your hardware launch file here -->
</group>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/launch/navigate.launch | <launch>
<arg name="robot_name" default="/"/>
<arg name="rviz" default="false"/>
<arg if="$(eval arg('robot_name') == '/')" name="frame_prefix" value="" />
<arg unless="$(eval arg('robot_name') == '/')" name="frame_prefix" value="$(arg robot_name)/" />
<group ns="$(arg robot_name)">
<!-- Map server -->
<arg name="map_file" default="$(find dream_walker_config)/maps/map.yaml"/>
<node pkg="map_server" name="map_server" type="map_server" args="$(arg map_file)" >
<param name="frame_id" value="$(arg frame_prefix)map" />
</node>
<!-- AMCL used for localization -->
<include file="$(find dream_walker_config)/launch/include/amcl.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
</include>
<!-- Calls navigation stack -->
<include file="$(find dream_walker_config)/launch/include/move_base.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
<arg name="robot_name" value="$(arg robot_name)"/>
</include>
<node if="$(arg rviz)" name="rviz" pkg="rviz" type="rviz"
args="-d $(find champ_navigation)/rviz/navigate.rviz -f $(arg frame_prefix)map"
output="screen"/>
</group>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/launch/gazebo.launch | <launch>
<arg name="robot_name" default="/"/> <!-- Change this for namespacing. -->
<arg name="rviz" default="false"/> <!-- Set to true to run rviz in parallel. -->
<arg name="lite" default="false" /> <!-- Set to true if you're using CHAMP lite version. Only useful for microcontrollers. -->
<arg name="ros_control_file" default="$(find dream_walker_config)/config/ros_control/ros_control.yaml" /> <!-- Path to ROS Control configurations. Do not touch. -->
<arg name="gazebo_world" default="$(find dream_walker_config)/worlds/outdoor.world" /> <!-- Path to Gazebo world you want to load. -->
<arg name="gui" default="true"/>
<arg name="world_init_x" default="0.0" /> <!-- X Initial position of the robot in Gazebo World -->
<arg name="world_init_y" default="0.0" /> <!-- Y Initial position of the robot in Gazebo World -->
<arg name="world_init_heading" default="0.0" /> <!-- Initial heading of the robot in Gazebo World -->
<param name="use_sim_time" value="true" />
<include file="$(find dream_walker_config)/launch/bringup.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="gazebo" value="true"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="rviz" value="$(arg rviz)"/>
<arg name="joint_controller_topic" value="joint_group_position_controller/command"/>
<arg name="hardware_connected" value="false"/>
<arg name="publish_foot_contacts" value="false"/>
<arg name="close_loop_odom" value="true"/>
</include>
<include file="$(find champ_gazebo)/launch/gazebo.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="ros_control_file" value="$(arg ros_control_file)"/>
<arg name="gazebo_world" value="$(arg gazebo_world)"/>
<arg name="world_init_x" value="$(arg world_init_x)" />
<arg name="world_init_y" value="$(arg world_init_y)" />
<arg name="world_init_heading" value="$(arg world_init_heading)" />
<arg name="gui" value="$(arg gui)" />
</include>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/launch/slam.launch | <launch>
<arg name="robot_name" default="/"/>
<arg name="rviz" default="false"/>
<arg if="$(eval arg('robot_name') == '/')" name="frame_prefix" value="" />
<arg unless="$(eval arg('robot_name') == '/')" name="frame_prefix" value="$(arg robot_name)/" />
<group ns="$(arg robot_name)">
<include file="$(find dream_walker_config)/launch/include/gmapping.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
</include>
<!-- Calls navigation stack packages -->
<include file="$(find dream_walker_config)/launch/include/move_base.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
<arg name="robot_name" value="$(arg robot_name)"/>
</include>
<node if="$(arg rviz)" name="rviz" pkg="rviz" type="rviz"
args="-d $(find champ_navigation)/rviz/navigate.rviz -f $(arg frame_prefix)map"
output="screen"/>
</group>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/launch/spawn_robot.launch | <launch>
<arg name="robot_name" default="/"/> <!-- Change this for namespacing. -->
<arg name="rviz" default="false"/> <!-- Set to true to run rviz in parallel. -->
<arg name="lite" default="false" /> <!-- Set to true if you're using CHAMP lite version. Only useful for microcontrollers. -->
<arg name="ros_control_file" default="$(find dream_walker_config)/config/ros_control/ros_control.yaml" /> <!-- Path to ROS Control configurations. Do not touch. -->
<arg name="gazebo_world" default="$(find dream_walker_config)/worlds/outdoor.world" /> <!-- Path to Gazebo world you want to load. -->
<arg name="world_init_x" default="0.0" /> <!-- X Initial position of the robot in Gazebo World -->
<arg name="world_init_y" default="0.0" /> <!-- Y Initial position of the robot in Gazebo World -->
<arg name="world_init_heading" default="0.0" /> <!-- Initial heading of the robot in Gazebo World -->
<param name="use_sim_time" value="true" />
<include file="$(find dream_walker_config)/launch/bringup.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="gazebo" value="true"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="rviz" value="$(arg rviz)"/>
<arg name="joint_controller_topic" value="joint_group_position_controller/command"/>
<arg name="hardware_connected" value="false"/>
<arg name="publish_foot_contacts" value="false"/>
<arg name="close_loop_odom" value="true"/>
</include>
<include file="$(find champ_gazebo)/launch/spawn_robot.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="ros_control_file" value="$(arg ros_control_file)"/>
<arg name="world_init_x" value="$(arg world_init_x)" />
<arg name="world_init_y" value="$(arg world_init_y)" />
<arg name="world_init_heading" value="$(arg world_init_heading)" />
</include>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/launch/include/gmapping.launch | <launch>
<arg name="frame_prefix" default=""/>
<node pkg="gmapping" type="slam_gmapping" name="slam_gmapping" output="screen">
<param name="base_frame" value="$(arg frame_prefix)base_footprint" />
<param name="odom_frame" value="$(arg frame_prefix)odom" />
<param name="map_frame" value="/$(arg frame_prefix)map" />
<param name="map_update_interval" value="15.0"/>
<param name="maxUrange" value="5.0"/>
<param name="minRange" value="-0.5"/>
<param name="sigma" value="0.05"/>
<param name="kernelSize" value="1"/>
<param name="lstep" value="0.05"/>
<param name="astep" value="0.05"/>
<param name="iterations" value="5"/>
<param name="lsigma" value="0.075"/>
<param name="ogain" value="3.0"/>
<param name="lskip" value="0"/>
<param name="minimumScore" value="100"/>
<param name="srr" value="0.01"/>
<param name="srt" value="0.02"/>
<param name="str" value="0.01"/>
<param name="stt" value="0.02"/>
<param name="linearUpdate" value="0.7"/>
<param name="angularUpdate" value="0.7"/>
<param name="temporalUpdate" value="-0.5"/>
<param name="resampleThreshold" value="0.5"/>
<param name="particles" value="50"/>
<param name="xmin" value="-50.0"/>
<param name="ymin" value="-50.0"/>
<param name="xmax" value="50.0"/>
<param name="ymax" value="50.0"/>
<param name="delta" value="0.05"/>
<param name="llsamplerange" value="0.05"/>
<param name="llsamplestep" value="0.05"/>
<param name="lasamplerange" value="0.005"/>
<param name="lasamplestep" value="0.005"/>
<param name="transform_publish_period" value="0.1"/>
</node>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/launch/include/amcl.launch | <launch>
<arg name="frame_prefix" default=""/>
<node pkg="amcl" type="amcl" name="amcl" output="screen">
<param name="initial_pose_a" value="0.0"/>
<param name="use_map_topic" value="true"/>
<param name="base_frame_id" value="$(arg frame_prefix)base_footprint"/>
<param name="odom_frame_id" value="$(arg frame_prefix)odom"/>
<param name="global_frame_id" value="$(arg frame_prefix)map"/>
<param name="transform_broadcast" value="true"/>
<param name="gui_publish_rate" value="10.0"/> <!-- Maximum rate (Hz) at which scans and paths are published for visualization, -1.0 to disable. -->
<param name="kld_err" value="0.05"/>
<param name="kld_z" value="0.99"/>
<param name="laser_lambda_short" value="0.1"/>
<param name="laser_likelihood_max_dist" value="2.0"/>
<param name="laser_max_beams" value="60"/>
<param name="laser_model_type" value="likelihood_field_prob"/>
<param name="laser_sigma_hit" value="0.2"/>
<param name="laser_z_hit" value="0.5"/>
<param name="laser_z_short" value="0.05"/>
<param name="laser_z_max" value="0.05"/>
<param name="laser_z_rand" value="0.5"/>
<param name="max_particles" value="2000"/>
<param name="min_particles" value="500"/>
<param name="odom_alpha1" value="0.5"/> <!-- Specifies the expected noise in odometry's rotation estimate from the rotational component of the robot's motion. -->
<param name="odom_alpha2" value="0.5"/> <!-- Specifies the expected noise in odometry's rotation estimate from translational component of the robot's motion. -->
<param name="odom_alpha3" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the translational component of the robot's motion. -->
<param name="odom_alpha4" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the rotational component of the robot's motion. -->
<param name="odom_alpha5" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the rotational component of the robot's motion. -->
<param name="odom_model_type" value="omni"/>
<param name="recovery_alpha_slow" value="0.001"/> <!-- Exponential decay rate for the slow average weight filter, used in deciding when to recover by adding random poses. -->
<param name="recovery_alpha_fast" value="0.1"/> <!-- Exponential decay rate for the fast average weight filter, used in deciding when to recover by adding random poses. -->
<param name="resample_interval" value="1"/> <!-- Number of filter updates required before resampling. -->
<param name="transform_tolerance" value="1.25"/> <!-- Default 0.1; time with which to post-date the transform that is published, to indicate that this transform is valid into the future. -->
<param name="update_min_a" value="0.2"/> <!-- Rotational movement required before performing a filter update. 0.1 represents 5.7 degrees -->
<param name="update_min_d" value="0.2"/> <!-- Translational movement required before performing a filter update. -->
</node>
</launch>
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/launch/include/move_base.launch | <launch>
<arg name="frame_prefix" default=""/>
<arg name="robot_name" default=""/>
<node pkg="move_base" type="move_base" respawn="false" name="move_base" output="screen">
<rosparam file="$(find dream_walker_config)/config/move_base/costmap_common_params.yaml" command="load" ns="global_costmap" />
<rosparam file="$(find dream_walker_config)/config/move_base/costmap_common_params.yaml" command="load" ns="local_costmap" />
<rosparam file="$(find dream_walker_config)/config/move_base/local_costmap_params.yaml" command="load" />
<rosparam file="$(find dream_walker_config)/config/move_base/global_costmap_params.yaml" command="load" />
<rosparam file="$(find dream_walker_config)/config/move_base/base_local_planner_holonomic_params.yaml" command="load" />
<rosparam file="$(find dream_walker_config)/config/move_base/move_base_params.yaml" command="load" />
<!-- explicitly define frame ids for movebase -->
<param name="global_costmap/global_frame" value="$(arg frame_prefix)map"/>
<param name="global_costmap/robot_base_frame" value="$(arg frame_prefix)base_footprint"/>
<param name="global_costmap/2d_obstacles_layer/scan/topic" value="$(arg robot_name)scan"/>
<param name="global_costmap/3d_obstacles_layer/depth/topic" value="$(arg robot_name)camera/depth/points"/>
<param name="local_costmap/global_frame" value="$(arg frame_prefix)odom"/>
<param name="local_costmap/robot_base_frame" value="$(arg frame_prefix)base_footprint"/>
<param name="local_costmap/2d_obstacles_layer/scan/topic" value="$(arg robot_name)scan"/>
<param name="local_costmap/3d_obstacles_layer/depth/topic" value="$(arg robot_name)camera/depth/points"/>
</node>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/maps/map.yaml | image: map.pgm
resolution: 0.050000
origin: [-50.000000, -50.000000, 0.000000]
negate: 0
occupied_thresh: 0.65
free_thresh: 0.196
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/include/quadruped_description.h | #ifndef QUADRUPED_DESCRIPTION_H
#define QUADRUPED_DESCRIPTION_H
#include <quadruped_base/quadruped_base.h>
namespace champ
{
namespace URDF
{
void loadFromHeader(champ::QuadrupedBase &base)
{
base.lf.hip.setOrigin(0.4585, 0.083, 0.0, 0.0, 0.0, 0.0);
base.lf.upper_leg.setOrigin(0.0, 0.203, -0.0, 0.0, 0.0, 0.0);
base.lf.lower_leg.setOrigin(0.0, 0.075, -0.32, 0.0, 0.0, 0.0);
base.lf.foot.setOrigin(0.0, 0.0, -0.44, 0.0, 0.0, 0.0);
base.rf.hip.setOrigin(0.4585, -0.083, 0.0, 0.0, 0.0, 0.0);
base.rf.upper_leg.setOrigin(0.0, -0.203, -0.0, 0.0, 0.0, 0.0);
base.rf.lower_leg.setOrigin(0.0, -0.075, -0.32, 0.0, 0.0, 0.0);
base.rf.foot.setOrigin(0.0, 0.0, -0.44, 0.0, 0.0, 0.0);
base.lh.hip.setOrigin(-0.4585, 0.083, 0.0, 0.0, 0.0, 0.0);
base.lh.upper_leg.setOrigin(0.0, 0.203, -0.0, 0.0, 0.0, 0.0);
base.lh.lower_leg.setOrigin(0.0, 0.075, -0.32, 0.0, 0.0, 0.0);
base.lh.foot.setOrigin(0.0, 0.0, -0.44, 0.0, 0.0, 0.0);
base.rh.hip.setOrigin(-0.4585, -0.083, 0.0, 0.0, 0.0, 0.0);
base.rh.upper_leg.setOrigin(0.0, -0.203, -0.0, 0.0, 0.0, 0.0);
base.rh.lower_leg.setOrigin(0.0, -0.075, -0.32, 0.0, 0.0, 0.0);
base.rh.foot.setOrigin(0.0, 0.0, -0.44, 0.0, 0.0, 0.0);
}
}
}
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/include/hardware_config.h | #ifndef HARDWARE_CONFIG_H
#define HARDWARE_CONFIG_H
#define USE_SIMULATION_ACTUATOR
// #define USE_DYNAMIXEL_ACTUATOR
// #define USE_SERVO_ACTUATOR
// #define USE_BRUSHLESS_ACTUATOR
#define USE_SIMULATION_IMU
// #define USE_BNO0809DOF_IMU
#define USE_ROS
// #define USE_ROS_RF
#ifdef USE_ROS_RF
#define ELE_PIN 16
#define AIL_PIN 21
#define RUD_PIN 17
#define THR_PIN 20
#define AUX1_PIN 22
#define AUX2_PIN 23
#define RF_INV_LX false
#define RF_INV_LY false
#define RF_INV_AZ false
#define RF_INV_ROLL true
#define RF_INV_PITCH false
#define RF_INV_YAW false
#endif
#ifdef USE_DYNAMIXEL_ACTUATOR
#define LFH_SERVO_ID 16
#define LFU_SERVO_ID 17
#define LFL_SERVO_ID 18
#define RFH_SERVO_ID 14
#define RFU_SERVO_ID 7
#define RFL_SERVO_ID 4
#define LHH_SERVO_ID 2
#define LHU_SERVO_ID 11
#define LHL_SERVO_ID 12
#define RHH_SERVO_ID 6
#define RHU_SERVO_ID 5
#define RHL_SERVO_ID 8
#define LFH_INV false
#define LFU_INV false
#define LFL_INV true
#define RFH_INV false
#define RFU_INV true
#define RFL_INV false
#define LHH_INV false
#define LHU_INV false
#define LHL_INV true
#define RHH_INV false
#define RHU_INV true
#define RHL_INV false
#endif
#ifdef USE_SERVO_ACTUATOR
#define LFH_PIN 8
#define LFU_PIN 7
#define LFL_PIN 6
#define RFH_PIN 14
#define RFU_PIN 16
#define RFL_PIN 17
#define LHH_PIN 4
#define LHU_PIN 3
#define LHL_PIN 2
#define RHH_PIN 21
#define RHU_PIN 22
#define RHL_PIN 23
#define LFH_OFFSET 0
#define LFU_OFFSET 0
#define LFL_OFFSET 0
#define RFH_OFFSET 0
#define RFU_OFFSET 0
#define RFL_OFFSET 0
#define LHH_OFFSET 0
#define LHU_OFFSET 0
#define LHL_OFFSET 3
#define RHH_OFFSET 0
#define RHU_OFFSET 0
#define RHL_OFFSET 0
#define LFH_INV false
#define LFU_INV false
#define LFL_INV false
#define RFH_INV false
#define RFU_INV true
#define RFL_INV true
#define LHH_INV true
#define LHU_INV false
#define LHL_INV false
#define RHH_INV true
#define RHU_INV true
#define RHL_INV true
#endif
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/include/gait_config.h | #ifndef GAIT_CONFIG_H
#define GAIT_CONFIG_H
#define KNEE_ORIENTATION ">>"
#define PANTOGRAPH_LEG false
#define ODOM_SCALER 1.0
#define MAX_LINEAR_VELOCITY_X 0.5
#define MAX_LINEAR_VELOCITY_Y 0.25
#define MAX_ANGULAR_VELOCITY_Z 1.0
#define COM_X_TRANSLATION 0.0
#define SWING_HEIGHT 0.1
#define STANCE_DEPTH 0.0
#define STANCE_DURATION 0.25
#define NOMINAL_HEIGHT 0.5
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/config/links/links.yaml | base: base_link
left_front:
- B1_Link
- B2_Link
- B3_Link
- B4_Link
right_front:
- A1_Link
- A2_Link
- A3_Link
- A4_Link
left_hind:
- D1_Link
- D2_Link
- D3_Link
- D4_Link
right_hind:
- C1_Link
- C2_Link
- C3_Link
- C4_Link |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/config/ros_control/ros_control.yaml | "":
joint_states_controller:
type: joint_state_controller/JointStateController
publish_rate: 50
joint_group_position_controller:
type: effort_controllers/JointTrajectoryController
joints:
- B1_joint
- B2_joint
- B3_joint
- A1_joint
- A2_joint
- A3_joint
- D1_joint
- D2_joint
- D3_joint
- C1_joint
- C2_joint
- C3_joint
gains:
B1_joint : {p: 180, d: 0.9, i: 20}
B2_joint : {p: 180, d: 0.9, i: 20}
B3_joint : {p: 180, d: 0.9, i: 20}
A1_joint : {p: 180, d: 0.9, i: 20}
A2_joint : {p: 180, d: 0.9, i: 20}
A3_joint : {p: 180, d: 0.9, i: 20}
D1_joint : {p: 180, d: 0.9, i: 20}
D2_joint : {p: 180, d: 0.9, i: 20}
D3_joint : {p: 180, d: 0.9, i: 20}
C1_joint : {p: 180, d: 0.9, i: 20}
C2_joint : {p: 180, d: 0.9, i: 20}
C3_joint : {p: 180, d: 0.9, i: 20}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/config/gait/gait.yaml | knee_orientation : ">>"
pantograph_leg : false
odom_scaler: 1.0
max_linear_velocity_x : 0.5
max_linear_velocity_y : 0.25
max_angular_velocity_z : 1.0
com_x_translation : 0.0
swing_height : 0.1
stance_depth : 0.0
stance_duration : 0.25
nominal_height : 0.5 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/config/joints/joints.yaml | left_front:
- B1_joint
- B2_joint
- B3_joint
- B4_joint
right_front:
- A1_joint
- A2_joint
- A3_joint
- A4_joint
left_hind:
- D1_joint
- D2_joint
- D3_joint
- D4_joint
right_hind:
- C1_joint
- C2_joint
- C3_joint
- C4_joint |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/config/move_base/costmap_common_params.yaml | obstacle_range: 2.5
raytrace_range: 3.0
footprint: [[-0.25, -0.145], [-0.25, 0.145], [0.25, 0.145], [0.25, -0.145]]
transform_tolerance: 0.5
resolution: 0.05
static_map_layer:
map_topic: map
subscribe_to_updates: true
2d_obstacles_layer:
observation_sources: scan
scan: {data_type: LaserScan,
topic: scan,
marking: true,
clearing: true}
3d_obstacles_layer:
observation_sources: depth
depth: {data_type: PointCloud2,
topic: camera/depth/points,
min_obstacle_height: 0.1,
marking: true,
clearing: true}
inflation_layer:
inflation_radius: 2.0 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/config/move_base/base_local_planner_holonomic_params.yaml | DWAPlannerROS:
#http://wiki.ros.org/dwa_local_planner
min_vel_trans: 0.01
max_vel_trans: 0.5
min_vel_x: -0.025
max_vel_x: 0.5
min_vel_y: 0.0
max_vel_y: 0.0
max_vel_rot: 1.0
min_vel_rot: -1.0
acc_lim_trans: 1.7
acc_lim_x: 1.7
acc_lim_y: 0.0
acc_lim_theta: 3
trans_stopped_vel: 0.1
theta_stopped_vel: 0.1
xy_goal_tolerance: 0.25
yaw_goal_tolerance: 0.34
sim_time: 3.5
sim_granularity: 0.1
vx_samples: 20
vy_samples: 0
vth_samples: 40
path_distance_bias: 34.0
goal_distance_bias: 24.0
occdist_scale: 0.05
forward_point_distance: 0.2
stop_time_buffer: 0.5
scaling_speed: 0.25
max_scaling_factor: 0.2
oscillation_reset_dist: 0.05
use_dwa: true
prune_plan: false
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/config/move_base/move_base_params.yaml | base_global_planner: global_planner/GlobalPlanner
base_local_planner: dwa_local_planner/DWAPlannerROS
shutdown_costmaps: false
controller_frequency: 5.0
controller_patience: 3.0
planner_frequency: 0.5
planner_patience: 5.0
oscillation_timeout: 10.0
oscillation_distance: 0.2
conservative_reset_dist: 0.1 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/config/move_base/global_costmap_params.yaml | global_costmap:
global_frame: map
robot_base_frame: base_footprint
update_frequency: 1.0
publish_frequency: 0.5
static_map: true
cost_scaling_factor: 10.0
plugins:
- {name: static_map_layer, type: "costmap_2d::StaticLayer"}
- {name: inflation_layer, type: "costmap_2d::InflationLayer"}
- {name: 2d_obstacles_layer, type: "costmap_2d::ObstacleLayer"}
- {name: 3d_obstacles_layer, type: "costmap_2d::VoxelLayer"}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/dream_walker_config/config/move_base/local_costmap_params.yaml | local_costmap:
global_frame: odom
robot_base_frame: base_footprint
update_frequency: 1.0
publish_frequency: 2.0
static_map: false
rolling_window: true
width: 2.5
height: 2.5
cost_scaling_factor: 5
plugins:
- {name: inflation_layer, type: "costmap_2d::InflationLayer"}
- {name: 2d_obstacles_layer, type: "costmap_2d::ObstacleLayer"}
- {name: 3d_obstacles_layer, type: "costmap_2d::VoxelLayer"}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/config.json | {
"urdf_path": "$(find yobotics_description)/urdf/yobotics.urdf",
"links": {
"right_hind": [
"RR_hip",
"RR_thigh",
"RR_calf",
"RR_foot"
],
"right_front": [
"FR_hip",
"FR_thigh",
"FR_calf",
"FR_foot"
],
"base": "trunk",
"left_hind": [
"RL_hip",
"RL_thigh",
"RL_calf",
"RL_foot"
],
"left_front": [
"FL_hip",
"FL_thigh",
"FL_calf",
"FL_foot"
]
},
"joints": {
"right_hind": [
"RR_hip_joint",
"RR_thigh_joint",
"RR_calf_joint",
"RR_foot_fixed"
],
"right_front": [
"FR_hip_joint",
"FR_thigh_joint",
"FR_calf_joint",
"FR_foot_fixed"
],
"left_hind": [
"RL_hip_joint",
"RL_thigh_joint",
"RL_calf_joint",
"RL_foot_fixed"
],
"left_front": [
"FL_hip_joint",
"FL_thigh_joint",
"FL_calf_joint",
"FL_foot_fixed"
]
},
"firmware": {
"transforms": {
"right_hind": {
"hip": [
-0.19,
-0.049,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
-0.062,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.18,
0,
0,
0
],
"lower_leg": [
0.0,
0.0,
-0.209,
0.0,
0.0,
0.0
]
},
"right_front": {
"hip": [
0.19,
-0.049,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
-0.062,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.18,
0,
0,
0
],
"lower_leg": [
0.0,
0.0,
-0.209,
0.0,
0.0,
0.0
]
},
"left_hind": {
"hip": [
-0.19,
0.049,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
0.062,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.18,
0,
0,
0
],
"lower_leg": [
0.0,
0.0,
-0.209,
0.0,
0.0,
0.0
]
},
"left_front": {
"hip": [
0.19,
0.049,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
0.062,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.18,
0,
0,
0
],
"lower_leg": [
0.0,
0.0,
-0.209,
0.0,
0.0,
0.0
]
}
},
"gait": {
"com_x_translation": -0.03,
"swing_height": 0.04,
"max_linear_vel_y": 0.25,
"max_linear_vel_x": 0.5,
"nominal_height": 0.25,
"knee_orientation": ">>",
"max_angular_vel_z": 1.0,
"stance_duration": 0.25,
"stance_depth": 0.0,
"pantograph_leg": "false",
"odom_scaler": 1.0
}
},
"default_urdf": "False",
"robot_name": "mini_cheetah"
} |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/CMakeLists.txt | cmake_minimum_required(VERSION 2.8.3)
project(mini_cheetah_config)
find_package(catkin REQUIRED COMPONENTS)
catkin_package() |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/setup.bash | #!/usr/bin/env bash
ROBOT_CONFIG_DIR=$(builtin cd "`dirname "${BASH_SOURCE[0]}"`" > /dev/null && pwd)
export CHAMP_ROBOT_CONFIG_DIR=$ROBOT_CONFIG_DIR/include
bash -i |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/package.xml | <?xml version="1.0"?>
<package format="2">
<name>mini_cheetah_config</name>
<version>0.1.0</version>
<description>mini_cheetah Champ Config Package</description>
<maintainer email="[email protected]">Juan Miguel Jimeno</maintainer>
<author>Juan Miguel Jimeno</author>
<license>BSD</license>
<buildtool_depend>catkin</buildtool_depend>
<exec_depend>roslaunch</exec_depend>
<exec_depend>rviz</exec_depend>
<exec_depend>champ_base</exec_depend>
</package> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/README.md |
## 1. Quick Start
You don't need a physical robot to run the following demos.
### 1.1. Walking demo in RVIZ:
#### 1.1.1. Run the base driver:
roslaunch mini_cheetah_config bringup.launch rviz:=true
#### 1.1.2. Run the teleop node:
roslaunch champ_teleop teleop.launch
If you want to use a [joystick](https://www.logitechg.com/en-hk/products/gamepads/f710-wireless-gamepad.html) add joy:=true as an argument.
### 1.2. SLAM demo:
#### 1.2.1. Run the Gazebo environment:
roslaunch mini_cheetah_config gazebo.launch
#### 1.2.2. Run gmapping package and move_base:
roslaunch mini_cheetah_config slam.launch rviz:=true
To start mapping:
- Click '2D Nav Goal'.
- Click and drag at the position you want the robot to go.

- Save the map by running:
roscd mini_cheetah_config/maps
rosrun map_server map_saver
### 1.3. Autonomous Navigation:
#### 1.3.1. Run the Gazebo environment:
roslaunch mini_cheetah_config gazebo.launch
#### 1.3.2. Run amcl and move_base:
roslaunch mini_cheetah_config navigate.launch rviz:=true
To navigate:
- Click '2D Nav Goal'.
- Click and drag at the position you want the robot to go.

#### 1.4.1 Spawning multiple robots in Gazebo
Run Gazebo and default simulation world:
roslaunch champ_gazebo spawn_world.launch
You can also load your own world file by passing your world's path to 'gazebo_world' argument:
roslaunch champ_gazebo spawn_world.launch gazebo_world:=<path_to_world_file>
Spawning a robot:
roslaunch mini_cheetah_config spawn_robot.launch robot_name:=<unique_robot_name> world_init_x:=<x_position> world_init_y:=<y_position>
* Every instance of the spawned robot must have a unique robot name to prevent the topics and transforms from clashing.
---
:exclamation: *This is not an official product from the robot's company/author.* |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/launch/bringup.launch | <launch>
<arg name="robot_name" default="/"/> <!-- Change this for namespacing. -->
<arg name="base_frame" default="trunk"/> <!-- Link name of floating base. Do not touch this. -->
<arg name="joints_map_file" default="$(find mini_cheetah_config)/config/joints/joints.yaml"/> <!--Path to list of joint names. Do not touch this. -->
<arg name="links_map_file" default="$(find mini_cheetah_config)/config/links/links.yaml"/> <!-- Path to list of link names. Do not touch this. -->
<arg name="gait_config_file" default="$(find mini_cheetah_config)/config/gait/gait.yaml"/> <!-- Path to gait parameters. Do not touch this. -->
<arg name="description_file" default="$(find yobotics_description)/urdf/yobotics.urdf"/> <!-- Path to URDF file Do not touch this. -->
<arg name="gazebo" default="false" /> <!-- Set to true during simulation. This is auto-set to true from gazebo.launch. -->
<arg name="rviz" default="false"/> <!-- Set to true to run rviz in parallel. -->
<arg name="rviz_ref_frame" default="odom"/> <!-- Default RVIZ reference frame. -->
<arg name="has_imu" default="true" /> <!-- Set to true if you want to visualize robot but there's no IMU. Only useful for microcontrollers. -->
<arg name="lite" default="false" /> <!-- Set to true if you're using CHAMP lite version. Only useful for microcontrollers. -->
<arg name="close_loop_odom" default="false" /> <!-- Set to true if you want to calculate odometry using close loop. This is auto-set to true from gazebo.launch. -->
<arg name="publish_foot_contacts" default="true" /> <!-- Set to true if you want the controller to publish the foot contact states. This is auto-set to false from gazebo.launch. -->
<arg name="publish_joint_control" default="true" /> <!-- Set to true if you want the controller to publish the joint_states topic. This is auto-set to false from gazebo.launch. -->
<arg name="laser" default="sim"/> <!-- Set to the 2D LIDAR you're using. See https://github.com/chvmp/champ/tree/master/champ_bringup/launch/include/laser .-->
<arg name="joint_controller_topic" default="joint_group_position_controller/command" /> <!-- Change to remap command topic for actuator controller (ROS control). -->
<arg name="hardware_connected" default="false" /> <!-- Flag useful to launch hardware connected launch files. This auto disables publishing joint_states. -->
<arg if="$(eval arg('robot_name') == '/')" name="frame_prefix" value="" />
<arg unless="$(eval arg('robot_name') == '/')" name="frame_prefix" value="$(arg robot_name)/" />
<include file="$(find champ_bringup)/launch/bringup.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="base_frame" value="$(arg base_frame)"/>
<arg name="joints_map_file" value="$(arg joints_map_file)"/>
<arg name="links_map_file" value="$(arg links_map_file)"/>
<arg name="gait_config_file" value="$(arg gait_config_file)"/>
<arg name="description_file" value="$(arg description_file)"/>
<arg name="has_imu" value="$(arg has_imu)"/>
<arg name="gazebo" value="$(arg gazebo)"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="laser" value="$(arg laser)"/>
<arg name="rviz" value="$(arg rviz)"/>
<arg name="rviz_ref_frame" value="$(arg frame_prefix)$(arg rviz_ref_frame)"/>
<arg name="joint_controller_topic" value="$(arg joint_controller_topic)" />
<arg name="hardware_connected" value="$(arg hardware_connected)" />
<arg name="publish_foot_contacts" value="$(arg publish_foot_contacts)" />
<arg name="publish_joint_control" value="$(arg publish_joint_control)" />
<arg name="close_loop_odom" value="$(arg close_loop_odom)" />
</include>
<group if="$(arg hardware_connected)">
<node pkg="tf2_ros" type="static_transform_publisher" name="base_link_to_laser" args="0 0 0 0 0 0 $(arg frame_prefix)trunk $(arg frame_prefix)laser" />
<node pkg="tf2_ros" type="static_transform_publisher" name="base_link_to_imu" args="0 0 0 0 0 0 $(arg frame_prefix)trunk $(arg frame_prefix)imu_link" />
<!-- include your hardware launch file here -->
</group>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/launch/navigate.launch | <launch>
<arg name="robot_name" default="/"/>
<arg name="rviz" default="false"/>
<arg if="$(eval arg('robot_name') == '/')" name="frame_prefix" value="" />
<arg unless="$(eval arg('robot_name') == '/')" name="frame_prefix" value="$(arg robot_name)/" />
<group ns="$(arg robot_name)">
<!-- Map server -->
<arg name="map_file" default="$(find mini_cheetah_config)/maps/map.yaml"/>
<node pkg="map_server" name="map_server" type="map_server" args="$(arg map_file)" >
<param name="frame_id" value="$(arg frame_prefix)map" />
</node>
<!-- AMCL used for localization -->
<include file="$(find mini_cheetah_config)/launch/include/amcl.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
</include>
<!-- Calls navigation stack -->
<include file="$(find mini_cheetah_config)/launch/include/move_base.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
<arg name="robot_name" value="$(arg robot_name)"/>
</include>
<node if="$(arg rviz)" name="rviz" pkg="rviz" type="rviz"
args="-d $(find champ_navigation)/rviz/navigate.rviz -f $(arg frame_prefix)map"
output="screen"/>
</group>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/launch/gazebo.launch | <launch>
<arg name="robot_name" default="/"/> <!-- Change this for namespacing. -->
<arg name="rviz" default="false"/> <!-- Set to true to run rviz in parallel. -->
<arg name="lite" default="false" /> <!-- Set to true if you're using CHAMP lite version. Only useful for microcontrollers. -->
<arg name="ros_control_file" default="$(find mini_cheetah_config)/config/ros_control/ros_control.yaml" /> <!-- Path to ROS Control configurations. Do not touch. -->
<arg name="gazebo_world" default="$(find mini_cheetah_config)/worlds/outdoor.world" /> <!-- Path to Gazebo world you want to load. -->
<arg name="gui" default="true"/>
<arg name="world_init_x" default="0.0" /> <!-- X Initial position of the robot in Gazebo World -->
<arg name="world_init_y" default="0.0" /> <!-- Y Initial position of the robot in Gazebo World -->
<arg name="world_init_heading" default="0.0" /> <!-- Initial heading of the robot in Gazebo World -->
<param name="use_sim_time" value="true" />
<include file="$(find mini_cheetah_config)/launch/bringup.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="gazebo" value="true"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="rviz" value="$(arg rviz)"/>
<arg name="joint_controller_topic" value="joint_group_position_controller/command"/>
<arg name="hardware_connected" value="false"/>
<arg name="publish_foot_contacts" value="false"/>
<arg name="close_loop_odom" value="true"/>
</include>
<include file="$(find champ_gazebo)/launch/gazebo.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="ros_control_file" value="$(arg ros_control_file)"/>
<arg name="gazebo_world" value="$(arg gazebo_world)"/>
<arg name="world_init_x" value="$(arg world_init_x)" />
<arg name="world_init_y" value="$(arg world_init_y)" />
<arg name="world_init_heading" value="$(arg world_init_heading)" />
<arg name="gui" value="$(arg gui)" />
</include>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/launch/slam.launch | <launch>
<arg name="robot_name" default="/"/>
<arg name="rviz" default="false"/>
<arg if="$(eval arg('robot_name') == '/')" name="frame_prefix" value="" />
<arg unless="$(eval arg('robot_name') == '/')" name="frame_prefix" value="$(arg robot_name)/" />
<group ns="$(arg robot_name)">
<include file="$(find mini_cheetah_config)/launch/include/gmapping.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
</include>
<!-- Calls navigation stack packages -->
<include file="$(find mini_cheetah_config)/launch/include/move_base.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
<arg name="robot_name" value="$(arg robot_name)"/>
</include>
<node if="$(arg rviz)" name="rviz" pkg="rviz" type="rviz"
args="-d $(find champ_navigation)/rviz/navigate.rviz -f $(arg frame_prefix)map"
output="screen"/>
</group>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/launch/spawn_robot.launch | <launch>
<arg name="robot_name" default="/"/> <!-- Change this for namespacing. -->
<arg name="rviz" default="false"/> <!-- Set to true to run rviz in parallel. -->
<arg name="lite" default="false" /> <!-- Set to true if you're using CHAMP lite version. Only useful for microcontrollers. -->
<arg name="ros_control_file" default="$(find mini_cheetah_config)/config/ros_control/ros_control.yaml" /> <!-- Path to ROS Control configurations. Do not touch. -->
<arg name="gazebo_world" default="$(find mini_cheetah_config)/worlds/outdoor.world" /> <!-- Path to Gazebo world you want to load. -->
<arg name="world_init_x" default="0.0" /> <!-- X Initial position of the robot in Gazebo World -->
<arg name="world_init_y" default="0.0" /> <!-- Y Initial position of the robot in Gazebo World -->
<arg name="world_init_heading" default="0.0" /> <!-- Initial heading of the robot in Gazebo World -->
<param name="use_sim_time" value="true" />
<include file="$(find mini_cheetah_config)/launch/bringup.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="gazebo" value="true"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="rviz" value="$(arg rviz)"/>
<arg name="joint_controller_topic" value="joint_group_position_controller/command"/>
<arg name="hardware_connected" value="false"/>
<arg name="publish_foot_contacts" value="false"/>
<arg name="close_loop_odom" value="true"/>
</include>
<include file="$(find champ_gazebo)/launch/spawn_robot.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="ros_control_file" value="$(arg ros_control_file)"/>
<arg name="world_init_x" value="$(arg world_init_x)" />
<arg name="world_init_y" value="$(arg world_init_y)" />
<arg name="world_init_heading" value="$(arg world_init_heading)" />
</include>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/launch/include/gmapping.launch | <launch>
<arg name="frame_prefix" default=""/>
<node pkg="gmapping" type="slam_gmapping" name="slam_gmapping" output="screen">
<param name="base_frame" value="$(arg frame_prefix)base_footprint" />
<param name="odom_frame" value="$(arg frame_prefix)odom" />
<param name="map_frame" value="/$(arg frame_prefix)map" />
<param name="map_update_interval" value="15.0"/>
<param name="maxUrange" value="5.0"/>
<param name="minRange" value="-0.5"/>
<param name="sigma" value="0.05"/>
<param name="kernelSize" value="1"/>
<param name="lstep" value="0.05"/>
<param name="astep" value="0.05"/>
<param name="iterations" value="5"/>
<param name="lsigma" value="0.075"/>
<param name="ogain" value="3.0"/>
<param name="lskip" value="0"/>
<param name="minimumScore" value="100"/>
<param name="srr" value="0.01"/>
<param name="srt" value="0.02"/>
<param name="str" value="0.01"/>
<param name="stt" value="0.02"/>
<param name="linearUpdate" value="0.7"/>
<param name="angularUpdate" value="0.7"/>
<param name="temporalUpdate" value="-0.5"/>
<param name="resampleThreshold" value="0.5"/>
<param name="particles" value="50"/>
<param name="xmin" value="-50.0"/>
<param name="ymin" value="-50.0"/>
<param name="xmax" value="50.0"/>
<param name="ymax" value="50.0"/>
<param name="delta" value="0.05"/>
<param name="llsamplerange" value="0.05"/>
<param name="llsamplestep" value="0.05"/>
<param name="lasamplerange" value="0.005"/>
<param name="lasamplestep" value="0.005"/>
<param name="transform_publish_period" value="0.1"/>
</node>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/launch/include/amcl.launch | <launch>
<arg name="frame_prefix" default=""/>
<node pkg="amcl" type="amcl" name="amcl" output="screen">
<param name="initial_pose_a" value="0.0"/>
<param name="use_map_topic" value="true"/>
<param name="base_frame_id" value="$(arg frame_prefix)base_footprint"/>
<param name="odom_frame_id" value="$(arg frame_prefix)odom"/>
<param name="global_frame_id" value="$(arg frame_prefix)map"/>
<param name="transform_broadcast" value="true"/>
<param name="gui_publish_rate" value="10.0"/> <!-- Maximum rate (Hz) at which scans and paths are published for visualization, -1.0 to disable. -->
<param name="kld_err" value="0.05"/>
<param name="kld_z" value="0.99"/>
<param name="laser_lambda_short" value="0.1"/>
<param name="laser_likelihood_max_dist" value="2.0"/>
<param name="laser_max_beams" value="60"/>
<param name="laser_model_type" value="likelihood_field_prob"/>
<param name="laser_sigma_hit" value="0.2"/>
<param name="laser_z_hit" value="0.5"/>
<param name="laser_z_short" value="0.05"/>
<param name="laser_z_max" value="0.05"/>
<param name="laser_z_rand" value="0.5"/>
<param name="max_particles" value="2000"/>
<param name="min_particles" value="500"/>
<param name="odom_alpha1" value="0.5"/> <!-- Specifies the expected noise in odometry's rotation estimate from the rotational component of the robot's motion. -->
<param name="odom_alpha2" value="0.5"/> <!-- Specifies the expected noise in odometry's rotation estimate from translational component of the robot's motion. -->
<param name="odom_alpha3" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the translational component of the robot's motion. -->
<param name="odom_alpha4" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the rotational component of the robot's motion. -->
<param name="odom_alpha5" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the rotational component of the robot's motion. -->
<param name="odom_model_type" value="omni"/>
<param name="recovery_alpha_slow" value="0.001"/> <!-- Exponential decay rate for the slow average weight filter, used in deciding when to recover by adding random poses. -->
<param name="recovery_alpha_fast" value="0.1"/> <!-- Exponential decay rate for the fast average weight filter, used in deciding when to recover by adding random poses. -->
<param name="resample_interval" value="1"/> <!-- Number of filter updates required before resampling. -->
<param name="transform_tolerance" value="1.25"/> <!-- Default 0.1; time with which to post-date the transform that is published, to indicate that this transform is valid into the future. -->
<param name="update_min_a" value="0.2"/> <!-- Rotational movement required before performing a filter update. 0.1 represents 5.7 degrees -->
<param name="update_min_d" value="0.2"/> <!-- Translational movement required before performing a filter update. -->
</node>
</launch>
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/launch/include/move_base.launch | <launch>
<arg name="frame_prefix" default=""/>
<arg name="robot_name" default=""/>
<node pkg="move_base" type="move_base" respawn="false" name="move_base" output="screen">
<rosparam file="$(find mini_cheetah_config)/config/move_base/costmap_common_params.yaml" command="load" ns="global_costmap" />
<rosparam file="$(find mini_cheetah_config)/config/move_base/costmap_common_params.yaml" command="load" ns="local_costmap" />
<rosparam file="$(find mini_cheetah_config)/config/move_base/local_costmap_params.yaml" command="load" />
<rosparam file="$(find mini_cheetah_config)/config/move_base/global_costmap_params.yaml" command="load" />
<rosparam file="$(find mini_cheetah_config)/config/move_base/base_local_planner_holonomic_params.yaml" command="load" />
<rosparam file="$(find mini_cheetah_config)/config/move_base/move_base_params.yaml" command="load" />
<!-- explicitly define frame ids for movebase -->
<param name="global_costmap/global_frame" value="$(arg frame_prefix)map"/>
<param name="global_costmap/robot_base_frame" value="$(arg frame_prefix)base_footprint"/>
<param name="global_costmap/2d_obstacles_layer/scan/topic" value="$(arg robot_name)scan"/>
<param name="global_costmap/3d_obstacles_layer/depth/topic" value="$(arg robot_name)camera/depth/points"/>
<param name="local_costmap/global_frame" value="$(arg frame_prefix)odom"/>
<param name="local_costmap/robot_base_frame" value="$(arg frame_prefix)base_footprint"/>
<param name="local_costmap/2d_obstacles_layer/scan/topic" value="$(arg robot_name)scan"/>
<param name="local_costmap/3d_obstacles_layer/depth/topic" value="$(arg robot_name)camera/depth/points"/>
</node>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/maps/map.yaml | image: map.pgm
resolution: 0.050000
origin: [-50.000000, -50.000000, 0.000000]
negate: 0
occupied_thresh: 0.65
free_thresh: 0.196
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/include/quadruped_description.h | #ifndef QUADRUPED_DESCRIPTION_H
#define QUADRUPED_DESCRIPTION_H
#include <quadruped_base/quadruped_base.h>
namespace champ
{
namespace URDF
{
void loadFromHeader(champ::QuadrupedBase &base)
{
base.lf.hip.setOrigin(0.19, 0.049, 0.0, 0.0, 0.0, 0.0);
base.lf.upper_leg.setOrigin(0.0, 0.062, -0.0, 0.0, 0.0, 0.0);
base.lf.lower_leg.setOrigin(0.0, 0.0, -0.209, 0.0, 0.0, 0.0);
base.lf.foot.setOrigin(0.0, 0.0, -0.18, 0, 0, 0);
base.rf.hip.setOrigin(0.19, -0.049, 0.0, 0.0, 0.0, 0.0);
base.rf.upper_leg.setOrigin(0.0, -0.062, -0.0, 0.0, 0.0, 0.0);
base.rf.lower_leg.setOrigin(0.0, 0.0, -0.209, 0.0, 0.0, 0.0);
base.rf.foot.setOrigin(0.0, 0.0, -0.18, 0, 0, 0);
base.lh.hip.setOrigin(-0.19, 0.049, 0.0, 0.0, 0.0, 0.0);
base.lh.upper_leg.setOrigin(0.0, 0.062, -0.0, 0.0, 0.0, 0.0);
base.lh.lower_leg.setOrigin(0.0, 0.0, -0.209, 0.0, 0.0, 0.0);
base.lh.foot.setOrigin(0.0, 0.0, -0.18, 0, 0, 0);
base.rh.hip.setOrigin(-0.19, -0.049, 0.0, 0.0, 0.0, 0.0);
base.rh.upper_leg.setOrigin(0.0, -0.062, -0.0, 0.0, 0.0, 0.0);
base.rh.lower_leg.setOrigin(0.0, 0.0, -0.209, 0.0, 0.0, 0.0);
base.rh.foot.setOrigin(0.0, 0.0, -0.18, 0, 0, 0);
}
}
}
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/include/hardware_config.h | #ifndef HARDWARE_CONFIG_H
#define HARDWARE_CONFIG_H
#define USE_SIMULATION_ACTUATOR
// #define USE_DYNAMIXEL_ACTUATOR
// #define USE_SERVO_ACTUATOR
// #define USE_BRUSHLESS_ACTUATOR
#define USE_SIMULATION_IMU
// #define USE_BNO0809DOF_IMU
#define USE_ROS
// #define USE_ROS_RF
#ifdef USE_ROS_RF
#define ELE_PIN 16
#define AIL_PIN 21
#define RUD_PIN 17
#define THR_PIN 20
#define AUX1_PIN 22
#define AUX2_PIN 23
#define RF_INV_LX false
#define RF_INV_LY false
#define RF_INV_AZ false
#define RF_INV_ROLL true
#define RF_INV_PITCH false
#define RF_INV_YAW false
#endif
#ifdef USE_DYNAMIXEL_ACTUATOR
#define LFH_SERVO_ID 16
#define LFU_SERVO_ID 17
#define LFL_SERVO_ID 18
#define RFH_SERVO_ID 14
#define RFU_SERVO_ID 7
#define RFL_SERVO_ID 4
#define LHH_SERVO_ID 2
#define LHU_SERVO_ID 11
#define LHL_SERVO_ID 12
#define RHH_SERVO_ID 6
#define RHU_SERVO_ID 5
#define RHL_SERVO_ID 8
#define LFH_INV false
#define LFU_INV false
#define LFL_INV true
#define RFH_INV false
#define RFU_INV true
#define RFL_INV false
#define LHH_INV false
#define LHU_INV false
#define LHL_INV true
#define RHH_INV false
#define RHU_INV true
#define RHL_INV false
#endif
#ifdef USE_SERVO_ACTUATOR
#define LFH_PIN 8
#define LFU_PIN 7
#define LFL_PIN 6
#define RFH_PIN 14
#define RFU_PIN 16
#define RFL_PIN 17
#define LHH_PIN 4
#define LHU_PIN 3
#define LHL_PIN 2
#define RHH_PIN 21
#define RHU_PIN 22
#define RHL_PIN 23
#define LFH_OFFSET 0
#define LFU_OFFSET 0
#define LFL_OFFSET 0
#define RFH_OFFSET 0
#define RFU_OFFSET 0
#define RFL_OFFSET 0
#define LHH_OFFSET 0
#define LHU_OFFSET 0
#define LHL_OFFSET 3
#define RHH_OFFSET 0
#define RHU_OFFSET 0
#define RHL_OFFSET 0
#define LFH_INV false
#define LFU_INV false
#define LFL_INV false
#define RFH_INV false
#define RFU_INV true
#define RFL_INV true
#define LHH_INV true
#define LHU_INV false
#define LHL_INV false
#define RHH_INV true
#define RHU_INV true
#define RHL_INV true
#endif
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/include/gait_config.h | #ifndef GAIT_CONFIG_H
#define GAIT_CONFIG_H
#define KNEE_ORIENTATION ">>"
#define PANTOGRAPH_LEG false
#define ODOM_SCALER 1.0
#define MAX_LINEAR_VELOCITY_X 0.5
#define MAX_LINEAR_VELOCITY_Y 0.25
#define MAX_ANGULAR_VELOCITY_Z 1.0
#define COM_X_TRANSLATION -0.03
#define SWING_HEIGHT 0.04
#define STANCE_DEPTH 0.0
#define STANCE_DURATION 0.25
#define NOMINAL_HEIGHT 0.25
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/config/links/links.yaml | base: trunk
left_front:
- FL_hip
- FL_thigh
- FL_calf
- FL_foot
right_front:
- FR_hip
- FR_thigh
- FR_calf
- FR_foot
left_hind:
- RL_hip
- RL_thigh
- RL_calf
- RL_foot
right_hind:
- RR_hip
- RR_thigh
- RR_calf
- RR_foot |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/config/ros_control/ros_control.yaml | "":
joint_states_controller:
type: joint_state_controller/JointStateController
publish_rate: 50
joint_group_position_controller:
type: effort_controllers/JointTrajectoryController
joints:
- FL_hip_joint
- FL_thigh_joint
- FL_calf_joint
- FR_hip_joint
- FR_thigh_joint
- FR_calf_joint
- RL_hip_joint
- RL_thigh_joint
- RL_calf_joint
- RR_hip_joint
- RR_thigh_joint
- RR_calf_joint
gains:
FL_hip_joint : {p: 180, d: 6, i: 20}
FL_thigh_joint : {p: 180, d: 6, i: 20}
FL_calf_joint : {p: 180, d: 6, i: 20}
FR_hip_joint : {p: 180, d: 6, i: 20}
FR_thigh_joint : {p: 180, d: 6, i: 20}
FR_calf_joint : {p: 180, d: 6, i: 20}
RL_hip_joint : {p: 180, d: 6, i: 20}
RL_thigh_joint : {p: 180, d: 6, i: 20}
RL_calf_joint : {p: 180, d: 6, i: 20}
RR_hip_joint : {p: 180, d: 6, i: 20}
RR_thigh_joint : {p: 180, d: 6, i: 20}
RR_calf_joint : {p: 180, d: 6, i: 20}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/config/gait/gait.yaml | knee_orientation : ">>"
pantograph_leg : false
odom_scaler: 0.9
max_linear_velocity_x : 0.5
max_linear_velocity_y : 0.25
max_angular_velocity_z : 1.0
com_x_translation : 0.0
swing_height : 0.05
stance_depth : 0.0
stance_duration : 0.3
nominal_height : 0.3 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/config/joints/joints.yaml | left_front:
- FL_hip_joint
- FL_thigh_joint
- FL_calf_joint
- FL_foot_fixed
right_front:
- FR_hip_joint
- FR_thigh_joint
- FR_calf_joint
- FR_foot_fixed
left_hind:
- RL_hip_joint
- RL_thigh_joint
- RL_calf_joint
- RL_foot_fixed
right_hind:
- RR_hip_joint
- RR_thigh_joint
- RR_calf_joint
- RR_foot_fixed |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/config/move_base/costmap_common_params.yaml | obstacle_range: 2.5
raytrace_range: 3.0
footprint: [[-0.25, -0.145], [-0.25, 0.145], [0.25, 0.145], [0.25, -0.145]]
transform_tolerance: 0.5
resolution: 0.05
static_map_layer:
map_topic: map
subscribe_to_updates: true
2d_obstacles_layer:
observation_sources: scan
scan: {data_type: LaserScan,
topic: scan,
marking: true,
clearing: true}
3d_obstacles_layer:
observation_sources: depth
depth: {data_type: PointCloud2,
topic: camera/depth/points,
min_obstacle_height: 0.1,
marking: true,
clearing: true}
inflation_layer:
inflation_radius: 2.0 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/config/move_base/base_local_planner_holonomic_params.yaml | DWAPlannerROS:
#http://wiki.ros.org/dwa_local_planner
min_vel_trans: 0.01
max_vel_trans: 0.5
min_vel_x: -0.025
max_vel_x: 0.5
min_vel_y: 0.0
max_vel_y: 0.0
max_vel_rot: 1.0
min_vel_rot: -1.0
acc_lim_trans: 3.0
acc_lim_x: 3.0
acc_lim_y: 0.0
acc_lim_theta: 5.0
trans_stopped_vel: 0.1
theta_stopped_vel: 0.1
xy_goal_tolerance: 0.25
yaw_goal_tolerance: 0.34
sim_time: 3.5
sim_granularity: 0.1
vx_samples: 20
vy_samples: 0
vth_samples: 40
path_distance_bias: 34.0
goal_distance_bias: 24.0
occdist_scale: 0.05
forward_point_distance: 0.2
stop_time_buffer: 0.5
scaling_speed: 0.25
max_scaling_factor: 0.2
oscillation_reset_dist: 0.05
use_dwa: true
prune_plan: false
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/config/move_base/move_base_params.yaml | base_global_planner: global_planner/GlobalPlanner
base_local_planner: dwa_local_planner/DWAPlannerROS
shutdown_costmaps: false
controller_frequency: 5.0
controller_patience: 3.0
planner_frequency: 0.5
planner_patience: 5.0
oscillation_timeout: 10.0
oscillation_distance: 0.2
conservative_reset_dist: 0.1 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/config/move_base/global_costmap_params.yaml | global_costmap:
global_frame: map
robot_base_frame: base_footprint
update_frequency: 1.0
publish_frequency: 0.5
static_map: true
cost_scaling_factor: 10.0
plugins:
- {name: static_map_layer, type: "costmap_2d::StaticLayer"}
- {name: inflation_layer, type: "costmap_2d::InflationLayer"}
- {name: 2d_obstacles_layer, type: "costmap_2d::ObstacleLayer"}
- {name: 3d_obstacles_layer, type: "costmap_2d::VoxelLayer"}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/mini_cheetah_config/config/move_base/local_costmap_params.yaml | local_costmap:
global_frame: odom
robot_base_frame: base_footprint
update_frequency: 1.0
publish_frequency: 2.0
static_map: false
rolling_window: true
width: 2.5
height: 2.5
cost_scaling_factor: 5
plugins:
- {name: inflation_layer, type: "costmap_2d::InflationLayer"}
- {name: 2d_obstacles_layer, type: "costmap_2d::ObstacleLayer"}
- {name: 3d_obstacles_layer, type: "costmap_2d::VoxelLayer"}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/config.json | {
"urdf_path": "$(find aliengo_description)/xacro/aliengo.champ.urdf",
"links": {
"right_hind": [
"RR_hip",
"RR_thigh",
"RR_calf",
"RR_foot"
],
"right_front": [
"FR_hip",
"FR_thigh",
"FR_calf",
"FR_foot"
],
"base": "base",
"left_hind": [
"RL_hip",
"RL_thigh",
"RL_calf",
"RL_foot"
],
"left_front": [
"FL_hip",
"FL_thigh",
"FL_calf",
"FL_foot"
]
},
"joints": {
"right_hind": [
"RR_hip_joint",
"RR_thigh_joint",
"RR_calf_joint",
"RR_foot_fixed"
],
"right_front": [
"FR_hip_joint",
"FR_thigh_joint",
"FR_calf_joint",
"FR_foot_fixed"
],
"left_hind": [
"RL_hip_joint",
"RL_thigh_joint",
"RL_calf_joint",
"RL_foot_fixed"
],
"left_front": [
"FL_hip_joint",
"FL_thigh_joint",
"FL_calf_joint",
"FL_foot_fixed"
]
},
"firmware": {
"transforms": {
"right_hind": {
"hip": [
-0.2399,
-0.051,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
-0.083,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.25,
0.0,
0.0,
0.0
],
"lower_leg": [
0.0,
0.0,
-0.25,
0.0,
0.0,
0.0
]
},
"right_front": {
"hip": [
0.2399,
-0.051,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
0.083,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.25,
0.0,
0.0,
0.0
],
"lower_leg": [
0.0,
0.0,
-0.25,
0.0,
0.0,
0.0
]
},
"left_hind": {
"hip": [
-0.2399,
0.051,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
0.083,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.25,
0.0,
0.0,
0.0
],
"lower_leg": [
0.0,
0.0,
-0.25,
0.0,
0.0,
0.0
]
},
"left_front": {
"hip": [
0.2399,
0.051,
0.0,
0.0,
0.0,
0.0
],
"upper_leg": [
0.0,
-0.083,
-0.0,
0.0,
0.0,
0.0
],
"foot": [
0.0,
0.0,
-0.25,
0.0,
0.0,
0.0
],
"lower_leg": [
0.0,
0.0,
-0.25,
0.0,
0.0,
0.0
]
}
},
"gait": {
"max_linear_vel_y": 0.25,
"max_linear_vel_x": 1.5,
"nominal_height": 0.35,
"stance_depth": 0.0,
"swing_height": 0.06,
"knee_orientation": ">>",
"odom_scaler": 0.9,
"stance_duration": 0.35,
"pantograph_leg": "false",
"com_x_translation": -0.05,
"max_angular_vel_z": 1.0
}
},
"default_urdf": "False",
"robot_name": "aliengo"
} |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/CMakeLists.txt | cmake_minimum_required(VERSION 2.8.3)
project(aliengo_config)
find_package(catkin REQUIRED COMPONENTS)
catkin_package() |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/setup.bash | #!/usr/bin/env bash
ROBOT_CONFIG_DIR=$(builtin cd "`dirname "${BASH_SOURCE[0]}"`" > /dev/null && pwd)
export CHAMP_ROBOT_CONFIG_DIR=$ROBOT_CONFIG_DIR/include
bash -i |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/package.xml | <?xml version="1.0"?>
<package format="2">
<name>aliengo_config</name>
<version>0.1.0</version>
<description>aliengo Champ Config Package</description>
<maintainer email="[email protected]">Juan Miguel Jimeno</maintainer>
<author>Juan Miguel Jimeno</author>
<license>BSD</license>
<buildtool_depend>catkin</buildtool_depend>
<exec_depend>roslaunch</exec_depend>
<exec_depend>rviz</exec_depend>
<exec_depend>champ_base</exec_depend>
</package> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/README.md |
## 1. Quick Start
You don't need a physical robot to run the following demos.
### 1.1. Walking demo in RVIZ:
#### 1.1.1. Run the base driver:
roslaunch aliengo_config bringup.launch rviz:=true
#### 1.1.2. Run the teleop node:
roslaunch champ_teleop teleop.launch
If you want to use a [joystick](https://www.logitechg.com/en-hk/products/gamepads/f710-wireless-gamepad.html) add joy:=true as an argument.
### 1.2. SLAM demo:
#### 1.2.1. Run the Gazebo environment:
roslaunch aliengo_config gazebo.launch
#### 1.2.2. Run gmapping package and move_base:
roslaunch aliengo_config slam.launch rviz:=true
To start mapping:
- Click '2D Nav Goal'.
- Click and drag at the position you want the robot to go.

- Save the map by running:
roscd aliengo_config/maps
rosrun map_server map_saver
### 1.3. Autonomous Navigation:
#### 1.3.1. Run the Gazebo environment:
roslaunch aliengo_config gazebo.launch
#### 1.3.2. Run amcl and move_base:
roslaunch aliengo_config navigate.launch rviz:=true
To navigate:
- Click '2D Nav Goal'.
- Click and drag at the position you want the robot to go.

#### 1.4.1 Spawning multiple robots in Gazebo
Run Gazebo and default simulation world:
roslaunch champ_gazebo spawn_world.launch
You can also load your own world file by passing your world's path to 'gazebo_world' argument:
roslaunch champ_gazebo spawn_world.launch gazebo_world:=<path_to_world_file>
Spawning a robot:
roslaunch aliengo_config spawn_robot.launch robot_name:=<unique_robot_name> world_init_x:=<x_position> world_init_y:=<y_position>
* Every instance of the spawned robot must have a unique robot name to prevent the topics and transforms from clashing.
---
:exclamation: *This is not an official product from the robot's company/author.* |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/launch/bringup.launch | <launch>
<arg name="robot_name" default="/"/> <!-- Change this for namespacing. -->
<arg name="base_frame" default="base"/> <!-- Link name of floating base. Do not touch this. -->
<arg name="joints_map_file" default="$(find aliengo_config)/config/joints/joints.yaml"/> <!--Path to list of joint names. Do not touch this. -->
<arg name="links_map_file" default="$(find aliengo_config)/config/links/links.yaml"/> <!-- Path to list of link names. Do not touch this. -->
<arg name="gait_config_file" default="$(find aliengo_config)/config/gait/gait.yaml"/> <!-- Path to gait parameters. Do not touch this. -->
<arg name="description_file" default="$(find aliengo_description)/xacro/aliengo.champ.urdf"/> <!-- Path to URDF file Do not touch this. -->
<arg name="gazebo" default="false" /> <!-- Set to true during simulation. This is auto-set to true from gazebo.launch. -->
<arg name="rviz" default="false"/> <!-- Set to true to run rviz in parallel. -->
<arg name="rviz_ref_frame" default="odom"/> <!-- Default RVIZ reference frame. -->
<arg name="has_imu" default="true" /> <!-- Set to true if you want to visualize robot but there's no IMU. Only useful for microcontrollers. -->
<arg name="lite" default="false" /> <!-- Set to true if you're using CHAMP lite version. Only useful for microcontrollers. -->
<arg name="close_loop_odom" default="false" /> <!-- Set to true if you want to calculate odometry using close loop. This is auto-set to true from gazebo.launch. -->
<arg name="publish_foot_contacts" default="true" /> <!-- Set to true if you want the controller to publish the foot contact states. This is auto-set to false from gazebo.launch. -->
<arg name="publish_joint_control" default="true" /> <!-- Set to true if you want the controller to publish the joint_states topic. This is auto-set to false from gazebo.launch. -->
<arg name="laser" default="sim"/> <!-- Set to the 2D LIDAR you're using. See https://github.com/chvmp/champ/tree/master/champ_bringup/launch/include/laser .-->
<arg name="joint_controller_topic" default="joint_group_position_controller/command" /> <!-- Change to remap command topic for actuator controller (ROS control). -->
<arg name="hardware_connected" default="false" /> <!-- Flag useful to launch hardware connected launch files. This auto disables publishing joint_states. -->
<arg if="$(eval arg('robot_name') == '/')" name="frame_prefix" value="" />
<arg unless="$(eval arg('robot_name') == '/')" name="frame_prefix" value="$(arg robot_name)/" />
<include file="$(find champ_bringup)/launch/bringup.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="base_frame" value="$(arg base_frame)"/>
<arg name="joints_map_file" value="$(arg joints_map_file)"/>
<arg name="links_map_file" value="$(arg links_map_file)"/>
<arg name="gait_config_file" value="$(arg gait_config_file)"/>
<arg name="description_file" value="$(arg description_file)"/>
<arg name="has_imu" value="$(arg has_imu)"/>
<arg name="gazebo" value="$(arg gazebo)"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="laser" value="$(arg laser)"/>
<arg name="rviz" value="$(arg rviz)"/>
<arg name="rviz_ref_frame" value="$(arg frame_prefix)$(arg rviz_ref_frame)"/>
<arg name="joint_controller_topic" value="$(arg joint_controller_topic)" />
<arg name="hardware_connected" value="$(arg hardware_connected)" />
<arg name="publish_foot_contacts" value="$(arg publish_foot_contacts)" />
<arg name="publish_joint_control" value="$(arg publish_joint_control)" />
<arg name="close_loop_odom" value="$(arg close_loop_odom)" />
</include>
<group if="$(arg hardware_connected)">
<node pkg="tf2_ros" type="static_transform_publisher" name="base_link_to_laser" args="0 0 0 0 0 0 $(arg frame_prefix)base $(arg frame_prefix)laser" />
<node pkg="tf2_ros" type="static_transform_publisher" name="base_link_to_imu" args="0 0 0 0 0 0 $(arg frame_prefix)base $(arg frame_prefix)imu_link" />
<!-- include your hardware launch file here -->
</group>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/launch/navigate.launch | <launch>
<arg name="robot_name" default="/"/>
<arg name="rviz" default="false"/>
<arg if="$(eval arg('robot_name') == '/')" name="frame_prefix" value="" />
<arg unless="$(eval arg('robot_name') == '/')" name="frame_prefix" value="$(arg robot_name)/" />
<group ns="$(arg robot_name)">
<!-- Map server -->
<arg name="map_file" default="$(find aliengo_config)/maps/map.yaml"/>
<node pkg="map_server" name="map_server" type="map_server" args="$(arg map_file)" >
<param name="frame_id" value="$(arg frame_prefix)map" />
</node>
<!-- AMCL used for localization -->
<include file="$(find aliengo_config)/launch/include/amcl.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
</include>
<!-- Calls navigation stack -->
<include file="$(find aliengo_config)/launch/include/move_base.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
<arg name="robot_name" value="$(arg robot_name)"/>
</include>
<node if="$(arg rviz)" name="rviz" pkg="rviz" type="rviz"
args="-d $(find champ_navigation)/rviz/navigate.rviz -f $(arg frame_prefix)map"
output="screen"/>
</group>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/launch/gazebo.launch | <launch>
<arg name="robot_name" default="/"/> <!-- Change this for namespacing. -->
<arg name="rviz" default="false"/> <!-- Set to true to run rviz in parallel. -->
<arg name="lite" default="false" /> <!-- Set to true if you're using CHAMP lite version. Only useful for microcontrollers. -->
<arg name="ros_control_file" default="$(find aliengo_config)/config/ros_control/ros_control.yaml" /> <!-- Path to ROS Control configurations. Do not touch. -->
<arg name="gazebo_world" default="$(find aliengo_config)/worlds/outdoor.world" /> <!-- Path to Gazebo world you want to load. -->
<arg name="gui" default="true"/>
<arg name="world_init_x" default="0.0" /> <!-- X Initial position of the robot in Gazebo World -->
<arg name="world_init_y" default="0.0" /> <!-- Y Initial position of the robot in Gazebo World -->
<arg name="world_init_heading" default="0.0" /> <!-- Initial heading of the robot in Gazebo World -->
<param name="use_sim_time" value="true" />
<include file="$(find aliengo_config)/launch/bringup.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="gazebo" value="true"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="rviz" value="$(arg rviz)"/>
<arg name="joint_controller_topic" value="joint_group_position_controller/command"/>
<arg name="hardware_connected" value="false"/>
<arg name="publish_foot_contacts" value="false"/>
<arg name="close_loop_odom" value="true"/>
</include>
<include file="$(find champ_gazebo)/launch/gazebo.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="ros_control_file" value="$(arg ros_control_file)"/>
<arg name="gazebo_world" value="$(arg gazebo_world)"/>
<arg name="world_init_x" value="$(arg world_init_x)" />
<arg name="world_init_y" value="$(arg world_init_y)" />
<arg name="world_init_heading" value="$(arg world_init_heading)" />
<arg name="gui" value="$(arg gui)" />
</include>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/launch/slam.launch | <launch>
<arg name="robot_name" default="/"/>
<arg name="rviz" default="false"/>
<arg if="$(eval arg('robot_name') == '/')" name="frame_prefix" value="" />
<arg unless="$(eval arg('robot_name') == '/')" name="frame_prefix" value="$(arg robot_name)/" />
<group ns="$(arg robot_name)">
<include file="$(find aliengo_config)/launch/include/gmapping.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
</include>
<!-- Calls navigation stack packages -->
<include file="$(find aliengo_config)/launch/include/move_base.launch">
<arg name="frame_prefix" value="$(arg frame_prefix)"/>
<arg name="robot_name" value="$(arg robot_name)"/>
</include>
<node if="$(arg rviz)" name="rviz" pkg="rviz" type="rviz"
args="-d $(find champ_navigation)/rviz/navigate.rviz -f $(arg frame_prefix)map"
output="screen"/>
</group>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/launch/spawn_robot.launch | <launch>
<arg name="robot_name" default="/"/> <!-- Change this for namespacing. -->
<arg name="rviz" default="false"/> <!-- Set to true to run rviz in parallel. -->
<arg name="lite" default="false" /> <!-- Set to true if you're using CHAMP lite version. Only useful for microcontrollers. -->
<arg name="ros_control_file" default="$(find aliengo_config)/config/ros_control/ros_control.yaml" /> <!-- Path to ROS Control configurations. Do not touch. -->
<arg name="gazebo_world" default="$(find aliengo_config)/worlds/outdoor.world" /> <!-- Path to Gazebo world you want to load. -->
<arg name="world_init_x" default="0.0" /> <!-- X Initial position of the robot in Gazebo World -->
<arg name="world_init_y" default="0.0" /> <!-- Y Initial position of the robot in Gazebo World -->
<arg name="world_init_heading" default="0.0" /> <!-- Initial heading of the robot in Gazebo World -->
<param name="use_sim_time" value="true" />
<include file="$(find aliengo_config)/launch/bringup.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="gazebo" value="true"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="rviz" value="$(arg rviz)"/>
<arg name="joint_controller_topic" value="joint_group_position_controller/command"/>
<arg name="hardware_connected" value="false"/>
<arg name="publish_foot_contacts" value="false"/>
<arg name="close_loop_odom" value="true"/>
</include>
<include file="$(find champ_gazebo)/launch/spawn_robot.launch">
<arg name="robot_name" value="$(arg robot_name)"/>
<arg name="lite" value="$(arg lite)"/>
<arg name="ros_control_file" value="$(arg ros_control_file)"/>
<arg name="world_init_x" value="$(arg world_init_x)" />
<arg name="world_init_y" value="$(arg world_init_y)" />
<arg name="world_init_heading" value="$(arg world_init_heading)" />
</include>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/launch/include/gmapping.launch | <launch>
<arg name="frame_prefix" default=""/>
<node pkg="gmapping" type="slam_gmapping" name="slam_gmapping" output="screen">
<param name="base_frame" value="$(arg frame_prefix)base_footprint" />
<param name="odom_frame" value="$(arg frame_prefix)odom" />
<param name="map_frame" value="/$(arg frame_prefix)map" />
<param name="map_update_interval" value="15.0"/>
<param name="maxUrange" value="5.0"/>
<param name="minRange" value="-0.5"/>
<param name="sigma" value="0.05"/>
<param name="kernelSize" value="1"/>
<param name="lstep" value="0.05"/>
<param name="astep" value="0.05"/>
<param name="iterations" value="5"/>
<param name="lsigma" value="0.075"/>
<param name="ogain" value="3.0"/>
<param name="lskip" value="0"/>
<param name="minimumScore" value="100"/>
<param name="srr" value="0.01"/>
<param name="srt" value="0.02"/>
<param name="str" value="0.01"/>
<param name="stt" value="0.02"/>
<param name="linearUpdate" value="0.7"/>
<param name="angularUpdate" value="0.7"/>
<param name="temporalUpdate" value="-0.5"/>
<param name="resampleThreshold" value="0.5"/>
<param name="particles" value="50"/>
<param name="xmin" value="-50.0"/>
<param name="ymin" value="-50.0"/>
<param name="xmax" value="50.0"/>
<param name="ymax" value="50.0"/>
<param name="delta" value="0.05"/>
<param name="llsamplerange" value="0.05"/>
<param name="llsamplestep" value="0.05"/>
<param name="lasamplerange" value="0.005"/>
<param name="lasamplestep" value="0.005"/>
<param name="transform_publish_period" value="0.1"/>
</node>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/launch/include/amcl.launch | <launch>
<arg name="frame_prefix" default=""/>
<node pkg="amcl" type="amcl" name="amcl" output="screen">
<param name="initial_pose_a" value="0.0"/>
<param name="use_map_topic" value="true"/>
<param name="base_frame_id" value="$(arg frame_prefix)base_footprint"/>
<param name="odom_frame_id" value="$(arg frame_prefix)odom"/>
<param name="global_frame_id" value="$(arg frame_prefix)map"/>
<param name="transform_broadcast" value="true"/>
<param name="gui_publish_rate" value="10.0"/> <!-- Maximum rate (Hz) at which scans and paths are published for visualization, -1.0 to disable. -->
<param name="kld_err" value="0.05"/>
<param name="kld_z" value="0.99"/>
<param name="laser_lambda_short" value="0.1"/>
<param name="laser_likelihood_max_dist" value="2.0"/>
<param name="laser_max_beams" value="60"/>
<param name="laser_model_type" value="likelihood_field_prob"/>
<param name="laser_sigma_hit" value="0.2"/>
<param name="laser_z_hit" value="0.5"/>
<param name="laser_z_short" value="0.05"/>
<param name="laser_z_max" value="0.05"/>
<param name="laser_z_rand" value="0.5"/>
<param name="max_particles" value="2000"/>
<param name="min_particles" value="500"/>
<param name="odom_alpha1" value="0.5"/> <!-- Specifies the expected noise in odometry's rotation estimate from the rotational component of the robot's motion. -->
<param name="odom_alpha2" value="0.5"/> <!-- Specifies the expected noise in odometry's rotation estimate from translational component of the robot's motion. -->
<param name="odom_alpha3" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the translational component of the robot's motion. -->
<param name="odom_alpha4" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the rotational component of the robot's motion. -->
<param name="odom_alpha5" value="0.5"/> <!-- Specifies the expected noise in odometry's translation estimate from the rotational component of the robot's motion. -->
<param name="odom_model_type" value="omni"/>
<param name="recovery_alpha_slow" value="0.001"/> <!-- Exponential decay rate for the slow average weight filter, used in deciding when to recover by adding random poses. -->
<param name="recovery_alpha_fast" value="0.1"/> <!-- Exponential decay rate for the fast average weight filter, used in deciding when to recover by adding random poses. -->
<param name="resample_interval" value="1"/> <!-- Number of filter updates required before resampling. -->
<param name="transform_tolerance" value="1.25"/> <!-- Default 0.1; time with which to post-date the transform that is published, to indicate that this transform is valid into the future. -->
<param name="update_min_a" value="0.2"/> <!-- Rotational movement required before performing a filter update. 0.1 represents 5.7 degrees -->
<param name="update_min_d" value="0.2"/> <!-- Translational movement required before performing a filter update. -->
</node>
</launch>
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/launch/include/move_base.launch | <launch>
<arg name="frame_prefix" default=""/>
<arg name="robot_name" default=""/>
<node pkg="move_base" type="move_base" respawn="false" name="move_base" output="screen">
<rosparam file="$(find aliengo_config)/config/move_base/costmap_common_params.yaml" command="load" ns="global_costmap" />
<rosparam file="$(find aliengo_config)/config/move_base/costmap_common_params.yaml" command="load" ns="local_costmap" />
<rosparam file="$(find aliengo_config)/config/move_base/local_costmap_params.yaml" command="load" />
<rosparam file="$(find aliengo_config)/config/move_base/global_costmap_params.yaml" command="load" />
<rosparam file="$(find aliengo_config)/config/move_base/base_local_planner_holonomic_params.yaml" command="load" />
<rosparam file="$(find aliengo_config)/config/move_base/move_base_params.yaml" command="load" />
<!-- explicitly define frame ids for movebase -->
<param name="global_costmap/global_frame" value="$(arg frame_prefix)map"/>
<param name="global_costmap/robot_base_frame" value="$(arg frame_prefix)base_footprint"/>
<param name="global_costmap/2d_obstacles_layer/scan/topic" value="$(arg robot_name)scan"/>
<param name="global_costmap/3d_obstacles_layer/depth/topic" value="$(arg robot_name)camera/depth/points"/>
<param name="local_costmap/global_frame" value="$(arg frame_prefix)odom"/>
<param name="local_costmap/robot_base_frame" value="$(arg frame_prefix)base_footprint"/>
<param name="local_costmap/2d_obstacles_layer/scan/topic" value="$(arg robot_name)scan"/>
<param name="local_costmap/3d_obstacles_layer/depth/topic" value="$(arg robot_name)camera/depth/points"/>
</node>
</launch> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/maps/map.yaml | image: map.pgm
resolution: 0.050000
origin: [-50.000000, -50.000000, 0.000000]
negate: 0
occupied_thresh: 0.65
free_thresh: 0.196
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/include/quadruped_description.h | #ifndef QUADRUPED_DESCRIPTION_H
#define QUADRUPED_DESCRIPTION_H
#include <quadruped_base/quadruped_base.h>
namespace champ
{
namespace URDF
{
void loadFromHeader(champ::QuadrupedBase &base)
{
base.lf.hip.setOrigin(0.2399, 0.051, 0.0, 0.0, 0.0, 0.0);
base.lf.upper_leg.setOrigin(0.0, -0.083, -0.0, 0.0, 0.0, 0.0);
base.lf.lower_leg.setOrigin(0.0, 0.0, -0.25, 0.0, 0.0, 0.0);
base.lf.foot.setOrigin(0.0, 0.0, -0.25, 0.0, 0.0, 0.0);
base.rf.hip.setOrigin(0.2399, -0.051, 0.0, 0.0, 0.0, 0.0);
base.rf.upper_leg.setOrigin(0.0, 0.083, -0.0, 0.0, 0.0, 0.0);
base.rf.lower_leg.setOrigin(0.0, 0.0, -0.25, 0.0, 0.0, 0.0);
base.rf.foot.setOrigin(0.0, 0.0, -0.25, 0.0, 0.0, 0.0);
base.lh.hip.setOrigin(-0.2399, 0.051, 0.0, 0.0, 0.0, 0.0);
base.lh.upper_leg.setOrigin(0.0, 0.083, -0.0, 0.0, 0.0, 0.0);
base.lh.lower_leg.setOrigin(0.0, 0.0, -0.25, 0.0, 0.0, 0.0);
base.lh.foot.setOrigin(0.0, 0.0, -0.25, 0.0, 0.0, 0.0);
base.rh.hip.setOrigin(-0.2399, -0.051, 0.0, 0.0, 0.0, 0.0);
base.rh.upper_leg.setOrigin(0.0, -0.083, -0.0, 0.0, 0.0, 0.0);
base.rh.lower_leg.setOrigin(0.0, 0.0, -0.25, 0.0, 0.0, 0.0);
base.rh.foot.setOrigin(0.0, 0.0, -0.25, 0.0, 0.0, 0.0);
}
}
}
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/include/hardware_config.h | #ifndef HARDWARE_CONFIG_H
#define HARDWARE_CONFIG_H
#define USE_SIMULATION_ACTUATOR
// #define USE_DYNAMIXEL_ACTUATOR
// #define USE_SERVO_ACTUATOR
// #define USE_BRUSHLESS_ACTUATOR
#define USE_SIMULATION_IMU
// #define USE_BNO0809DOF_IMU
#define USE_ROS
// #define USE_ROS_RF
#ifdef USE_ROS_RF
#define ELE_PIN 16
#define AIL_PIN 21
#define RUD_PIN 17
#define THR_PIN 20
#define AUX1_PIN 22
#define AUX2_PIN 23
#define RF_INV_LX false
#define RF_INV_LY false
#define RF_INV_AZ false
#define RF_INV_ROLL true
#define RF_INV_PITCH false
#define RF_INV_YAW false
#endif
#ifdef USE_DYNAMIXEL_ACTUATOR
#define LFH_SERVO_ID 16
#define LFU_SERVO_ID 17
#define LFL_SERVO_ID 18
#define RFH_SERVO_ID 14
#define RFU_SERVO_ID 7
#define RFL_SERVO_ID 4
#define LHH_SERVO_ID 2
#define LHU_SERVO_ID 11
#define LHL_SERVO_ID 12
#define RHH_SERVO_ID 6
#define RHU_SERVO_ID 5
#define RHL_SERVO_ID 8
#define LFH_INV false
#define LFU_INV false
#define LFL_INV true
#define RFH_INV false
#define RFU_INV true
#define RFL_INV false
#define LHH_INV false
#define LHU_INV false
#define LHL_INV true
#define RHH_INV false
#define RHU_INV true
#define RHL_INV false
#endif
#ifdef USE_SERVO_ACTUATOR
#define LFH_PIN 8
#define LFU_PIN 7
#define LFL_PIN 6
#define RFH_PIN 14
#define RFU_PIN 16
#define RFL_PIN 17
#define LHH_PIN 4
#define LHU_PIN 3
#define LHL_PIN 2
#define RHH_PIN 21
#define RHU_PIN 22
#define RHL_PIN 23
#define LFH_OFFSET 0
#define LFU_OFFSET 0
#define LFL_OFFSET 0
#define RFH_OFFSET 0
#define RFU_OFFSET 0
#define RFL_OFFSET 0
#define LHH_OFFSET 0
#define LHU_OFFSET 0
#define LHL_OFFSET 3
#define RHH_OFFSET 0
#define RHU_OFFSET 0
#define RHL_OFFSET 0
#define LFH_INV false
#define LFU_INV false
#define LFL_INV false
#define RFH_INV false
#define RFU_INV true
#define RFL_INV true
#define LHH_INV true
#define LHU_INV false
#define LHL_INV false
#define RHH_INV true
#define RHU_INV true
#define RHL_INV true
#endif
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/include/gait_config.h | #ifndef GAIT_CONFIG_H
#define GAIT_CONFIG_H
#define KNEE_ORIENTATION ">>"
#define PANTOGRAPH_LEG false
#define ODOM_SCALER 1.0
#define MAX_LINEAR_VELOCITY_X 0.5
#define MAX_LINEAR_VELOCITY_Y 0.25
#define MAX_ANGULAR_VELOCITY_Z 1.0
#define COM_X_TRANSLATION 0.0
#define SWING_HEIGHT 0.04
#define STANCE_DEPTH 0.0
#define STANCE_DURATION 0.25
#define NOMINAL_HEIGHT 0.2
#endif |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/config/links/links.yaml | base: base
left_front:
- FL_hip
- FL_thigh
- FL_calf
- FL_foot
right_front:
- FR_hip
- FR_thigh
- FR_calf
- FR_foot
left_hind:
- RL_hip
- RL_thigh
- RL_calf
- RL_foot
right_hind:
- RR_hip
- RR_thigh
- RR_calf
- RR_foot |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/config/ros_control/ros_control.yaml | "":
joint_states_controller:
type: joint_state_controller/JointStateController
publish_rate: 200
joint_group_position_controller:
type: effort_controllers/JointTrajectoryController
joints:
- FL_hip_joint
- FL_thigh_joint
- FL_calf_joint
- FR_hip_joint
- FR_thigh_joint
- FR_calf_joint
- RL_hip_joint
- RL_thigh_joint
- RL_calf_joint
- RR_hip_joint
- RR_thigh_joint
- RR_calf_joint
gains:
FR_hip_joint : {p: 200, i: 0, d: 15}
FR_thigh_joint : {p: 200, i: 0, d: 15}
FR_calf_joint : {p: 200, i: 0, d: 15}
FL_hip_joint : {p: 200, i: 0, d: 15}
FL_thigh_joint : {p: 200, i: 0, d: 15}
FL_calf_joint : {p: 200, i: 0, d: 15}
RL_hip_joint : {p: 200, i: 0, d: 15}
RL_thigh_joint : {p: 200, i: 0, d: 15}
RL_calf_joint : {p: 200, i: 0, d: 15}
RR_hip_joint : {p: 200, i: 0, d: 15}
RR_thigh_joint : {p: 200, i: 0, d: 15}
RR_calf_joint : {p: 200, i: 0, d: 15}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/config/gait/gait.yaml | knee_orientation : ">>"
pantograph_leg : false
odom_scaler: 0.9
max_linear_velocity_x : 1.5
max_linear_velocity_y : 0.25
max_angular_velocity_z : 1.0
com_x_translation : -0.05
swing_height : 0.06
stance_depth : 0.0
stance_duration : 0.4
nominal_height : 0.35 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/config/joints/joints.yaml | left_front:
- FL_hip_joint
- FL_thigh_joint
- FL_calf_joint
- FL_foot_fixed
right_front:
- FR_hip_joint
- FR_thigh_joint
- FR_calf_joint
- FR_foot_fixed
left_hind:
- RL_hip_joint
- RL_thigh_joint
- RL_calf_joint
- RL_foot_fixed
right_hind:
- RR_hip_joint
- RR_thigh_joint
- RR_calf_joint
- RR_foot_fixed |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/config/move_base/costmap_common_params.yaml | obstacle_range: 2.5
raytrace_range: 3.0
footprint: [[-0.25, -0.145], [-0.25, 0.145], [0.25, 0.145], [0.25, -0.145]]
transform_tolerance: 0.5
resolution: 0.05
static_map_layer:
map_topic: map
subscribe_to_updates: true
2d_obstacles_layer:
observation_sources: scan
scan: {data_type: LaserScan,
topic: scan,
marking: true,
clearing: true}
3d_obstacles_layer:
observation_sources: depth
depth: {data_type: PointCloud2,
topic: camera/depth/points,
min_obstacle_height: 0.1,
marking: true,
clearing: true}
inflation_layer:
inflation_radius: 2.0 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/config/move_base/base_local_planner_holonomic_params.yaml | DWAPlannerROS:
#http://wiki.ros.org/dwa_local_planner
min_vel_trans: 0.01
max_vel_trans: 0.5
min_vel_x: -0.025
max_vel_x: 0.5
min_vel_y: 0.0
max_vel_y: 0.0
max_vel_rot: 1.0
min_vel_rot: -1.0
acc_lim_trans: 2.5
acc_lim_x: 2.5
acc_lim_y: 0.0
acc_lim_theta: 6
trans_stopped_vel: 0.1
theta_stopped_vel: 0.1
xy_goal_tolerance: 0.25
yaw_goal_tolerance: 0.34
sim_time: 3.5
sim_granularity: 0.1
vx_samples: 20
vy_samples: 0
vth_samples: 40
path_distance_bias: 34.0
goal_distance_bias: 24.0
occdist_scale: 0.05
forward_point_distance: 0.2
stop_time_buffer: 0.5
scaling_speed: 0.25
max_scaling_factor: 0.2
oscillation_reset_dist: 0.05
use_dwa: true
prune_plan: false
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/config/move_base/move_base_params.yaml | base_global_planner: global_planner/GlobalPlanner
base_local_planner: dwa_local_planner/DWAPlannerROS
shutdown_costmaps: false
controller_frequency: 5.0
controller_patience: 3.0
planner_frequency: 0.5
planner_patience: 5.0
oscillation_timeout: 10.0
oscillation_distance: 0.2
conservative_reset_dist: 0.1 |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/config/move_base/global_costmap_params.yaml | global_costmap:
global_frame: map
robot_base_frame: base_footprint
update_frequency: 1.0
publish_frequency: 0.5
static_map: true
cost_scaling_factor: 10.0
plugins:
- {name: static_map_layer, type: "costmap_2d::StaticLayer"}
- {name: inflation_layer, type: "costmap_2d::InflationLayer"}
- {name: 2d_obstacles_layer, type: "costmap_2d::ObstacleLayer"}
- {name: 3d_obstacles_layer, type: "costmap_2d::VoxelLayer"}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/aliengo_config/config/move_base/local_costmap_params.yaml | local_costmap:
global_frame: odom
robot_base_frame: base_footprint
update_frequency: 1.0
publish_frequency: 2.0
static_map: false
rolling_window: true
width: 2.5
height: 2.5
cost_scaling_factor: 5
plugins:
- {name: inflation_layer, type: "costmap_2d::InflationLayer"}
- {name: 2d_obstacles_layer, type: "costmap_2d::ObstacleLayer"}
- {name: 3d_obstacles_layer, type: "costmap_2d::VoxelLayer"}
|
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stanford_pupper_config/config.json | {
"robot_name": "stanford_pupper",
"default_urdf": "False",
"urdf_path": "$(find stanford_pupper)/urdf/standford_pupper.urdf",
"links": {
"base": "base_link",
"left_front": [
"LF_HIP",
"LF_THIGH",
"LF_THIGH_FOOT",
"LF_TOE"
],
"right_front": [
"RF_HIP",
"RF_THIGH",
"RF_THIGH_FOOT",
"RF_TOE"
],
"left_hind": [
"LH_HIP",
"LH_THIGH",
"LH_THIGH_FOOT",
"LH_TOE"
],
"right_hind": [
"RH_HIP",
"RH_THIGH",
"RH_THIGH_FOOT",
"RH_TOE"
]
},
"joints": {
"left_front": [
"LF_HIP_JOINT",
"LF_THIGH_JOINT",
"LF_THIGH_FOOT_JOINT",
"LF_TOE_JOINT"
],
"right_front": [
"RF_HIP_JOINT",
"RF_THIGH_JOINT",
"RF_THIGH_FOOT_JOINT",
"RF_TOE_JOINT"
],
"left_hind": [
"LH_HIP_JOINT",
"LH_THIGH_JOINT",
"LH_THIGH_FOOT_JOINT",
"LH_TOE_JOINT"
],
"right_hind": [
"RH_HIP_JOINT",
"RH_THIGH_JOINT",
"RH_THIGH_FOOT_JOINT",
"RH_TOE_JOINT"
]
},
"firmware": {
"transforms": {
"left_front": {
"hip": [
0.0705,
0.04,
0.02425,
0.0,
0.0,
0.0
],
"upper_leg": [
0.02735,
0.029523,
-0.0012724,
0.0,
0.0,
-1.5708
],
"lower_leg": [
-0.00516,
-0.10458,
-0.065536,
-0.043072,
0.0,
1.5708
],
"foot": [
0.097,
-0.0055,
-0.064,
0.0,
0.0,
0.0
]
},
"right_front": {
"hip": [
0.0705,
-0.04,
0.02425,
0.0,
0.0,
0.0
],
"upper_leg": [
0.02735,
-0.029523,
-0.0012724,
0.0,
0.0,
-1.5708
],
"lower_leg": [
0.00516,
-0.10458,
-0.065536,
-0.043072,
0.0,
1.5708
],
"foot": [
0.097,
0.0054,
-0.064,
0.0,
0.0,
0.0
]
},
"left_hind": {
"hip": [
-0.1299,
0.04,
0.02425,
0.0,
0.0,
0.0
],
"upper_leg": [
0.02775,
0.029523,
-0.0012724,
0.0,
0.0,
-1.5708
],
"lower_leg": [
-0.0054498,
-0.10458,
-0.065524,
-0.043072,
0.0,
1.5708
],
"foot": [
0.097,
-0.0055,
-0.064,
0.0,
0.0,
0.0
]
},
"right_hind": {
"hip": [
-0.0705,
-0.04,
0.02425,
0.0,
0.0,
0.0
],
"upper_leg": [
-0.17265,
-0.029523,
-0.0012724,
0.0,
0.0,
-1.5708
],
"lower_leg": [
0.0054098,
-0.10458,
-0.065525,
-0.043072,
0.0,
1.5708
],
"foot": [
0.097,
0.0054,
-0.064,
0.0,
0.0,
0.0
]
}
},
"gait": {
"knee_orientation": ">>",
"odom_scaler": 1.0,
"max_linear_vel_x": 0.5,
"max_linear_vel_y": 0.25,
"max_angular_vel_z": 1.0,
"stance_duration": 0.25,
"com_x_translation": 0.0,
"swing_height": 0.01,
"stance_depth": 0.0,
"nominal_height": 0.15,
"pantograph_leg": "false"
}
}
} |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stanford_pupper_config/CMakeLists.txt | cmake_minimum_required(VERSION 2.8.3)
project(stanford_pupper_config)
find_package(catkin REQUIRED COMPONENTS)
catkin_package() |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stanford_pupper_config/setup.bash | #!/usr/bin/env bash
ROBOT_CONFIG_DIR=$(builtin cd "`dirname "${BASH_SOURCE[0]}"`" > /dev/null && pwd)
export CHAMP_ROBOT_CONFIG_DIR=$ROBOT_CONFIG_DIR/include
bash -i |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stanford_pupper_config/package.xml | <?xml version="1.0"?>
<package format="2">
<name>stanford_pupper_config</name>
<version>0.1.0</version>
<description>stanford_pupper Champ Config Package</description>
<maintainer email="[email protected]">Juan Miguel Jimeno</maintainer>
<author>Juan Miguel Jimeno</author>
<license>BSD</license>
<buildtool_depend>catkin</buildtool_depend>
<exec_depend>roslaunch</exec_depend>
<exec_depend>rviz</exec_depend>
<exec_depend>champ_base</exec_depend>
</package> |
renanmb/Omniverse_legged_robotics/CHAMP-stuff/configs/stanford_pupper_config/README.md |
## 1. Quick Start
You don't need a physical robot to run the following demos.
### 1.1. Walking demo in RVIZ:
#### 1.1.1. Run the base driver:
roslaunch stanford_pupper_config bringup.launch rviz:=true
#### 1.1.2. Run the teleop node:
roslaunch champ_teleop teleop.launch
If you want to use a [joystick](https://www.logitechg.com/en-hk/products/gamepads/f710-wireless-gamepad.html) add joy:=true as an argument.
### 1.2. SLAM demo:
#### 1.2.1. Run the Gazebo environment:
roslaunch stanford_pupper_config gazebo.launch
#### 1.2.2. Run gmapping package and move_base:
roslaunch stanford_pupper_config slam.launch rviz:=true
To start mapping:
- Click '2D Nav Goal'.
- Click and drag at the position you want the robot to go.

- Save the map by running:
roscd stanford_pupper_config/maps
rosrun map_server map_saver
### 1.3. Autonomous Navigation:
#### 1.3.1. Run the Gazebo environment:
roslaunch stanford_pupper_config gazebo.launch
#### 1.3.2. Run amcl and move_base:
roslaunch stanford_pupper_config navigate.launch rviz:=true
To navigate:
- Click '2D Nav Goal'.
- Click and drag at the position you want the robot to go.

#### 1.4.1 Spawning multiple robots in Gazebo
Run Gazebo and default simulation world:
roslaunch champ_gazebo spawn_world.launch
You can also load your own world file by passing your world's path to 'gazebo_world' argument:
roslaunch champ_gazebo spawn_world.launch gazebo_world:=<path_to_world_file>
Spawning a robot:
roslaunch stanford_pupper_config spawn_robot.launch robot_name:=<unique_robot_name> world_init_x:=<x_position> world_init_y:=<y_position>
* Every instance of the spawned robot must have a unique robot name to prevent the topics and transforms from clashing.
---
:exclamation: *This is not an official product from the robot's company/author.* |
Subsets and Splits
No community queries yet
The top public SQL queries from the community will appear here once available.