
ros
文章平均质量分 58
小弧光
这个作者很懒,什么都没留下…
展开
-
从ros parameter server 获取URDF
// get the general robot description, the lwr class will take care of parsing what’s useful to itself std::string urdf_string = getURDF(lwr_nh, “/robot_description”);// Get the URDF XML from the ...原创 2018-09-12 12:47:16 · 411 阅读 · 0 评论 -
Running OMPL as a pre-processor for CHOMP
<launch> <!-- OMPL Plugin for MoveIt! --> <arg name="planning_plugin" value="ompl_interface/OMPLPlanner" /> <!-- The request adapters (plugins) used when planning with OMP...原创 2019-03-28 13:39:04 · 576 阅读 · 2 评论 -
逆解常用公式
原创 2019-03-28 09:26:02 · 1303 阅读 · 0 评论 -
8 reasons why you should use ROS for robotics projects
8 reasons why you should use ROS for robotics projectsYou already know some programming and how to use a terminal, and you want to get into robotics. Or you are making the specs for an entire new ro...原创 2019-03-25 11:14:52 · 291 阅读 · 0 评论 -
python 发送blockly xml到blockly server,并产生python代码
#!/usr/bin/env pythonimport rospyimport subprocessimport socketimport osimport signalimport astHOST = '127.0.0.1'def cleanup_node_tcp_port(port_number): try: output = subprocess.check_...原创 2019-02-12 16:06:42 · 542 阅读 · 0 评论 -
执行blockly的python代码
class SequenceCodeExecutor: def __init__(self): self.blockly_dir = rospy.get_param("~sequence_code_to_execute_path") self.python_file = str(self.blockly_dir) + '/generated_code.py...原创 2019-02-12 15:32:29 · 1826 阅读 · 0 评论 -
获取gauss机械臂的当前状态
//获取当前参数 currentParameter = () =&gt; { let network = new Networking(); let sub = network.listen('/joint_states','sensor_msgs/JointState',(name , data) =&gt; { this.setState({ ...原创 2019-02-12 14:41:19 · 567 阅读 · 0 评论 -
gauss 机械臂示教模式切换
//示教模式切换 teaching = value => { this.setState({ teachStatus: value }); let status; if (value) { status = 1; } else { status = 0; } let network = new...原创 2019-02-12 14:38:05 · 670 阅读 · 0 评论 -
通过rosbridge 修改 gauss 机械臂的末端工具
useActuator = (index) => { let indexNewForm = this.state.newForm[index] let network = new Networking(); let localStorage = new LocalStorage(); // 电磁铁,激光,直流电流(电磁铁...原创 2019-02-12 13:44:34 · 431 阅读 · 5 评论 -
通过rosbridge和roslibjs与 gauss 机械臂通信
let ROSLIB = require('roslib');import intl from 'react-intl-universal';import { isLegal } from './message.type'import { LocalStorage } from './localStorage'import { notification } from 'antd';le...原创 2019-02-12 11:59:42 · 2684 阅读 · 1 评论 -
gdb调试ros node
rosrun --prefix ‘gdb -ex run --args’ [package_name] [node_name]rosrun --prefix ‘gdb -ex run --args’ marm_planning moveit_obstacles_demo记得:catkin_make -DCMAKE_BUILD_TYPE=Debug如果你用roslaunch,在你的lau...原创 2018-10-31 09:27:43 · 1907 阅读 · 0 评论 -
Difference between plans obtained by CHOMP and OMPL
Optimizing planners optimize a cost function that may sometimes lead to surprising results: moving through a thin obstacle might be lower cost than a long, winding trajectory that avoids all collision...原创 2019-03-28 13:39:51 · 430 阅读 · 0 评论